..
AC_AttitudeControl
AC_AttControl: bug fix to angle_boost reporting
9 years ago
AC_Fence
Global: rename min and max macros to uppercase
9 years ago
AC_InputManager
AC_InputManager: Initial class creation
9 years ago
AC_PID
AC_PID: fixed example build warning
9 years ago
AC_PrecLand
AC_PrecLand: add missing parameter description
9 years ago
AC_Sprayer
Global: rename min and max macros to uppercase
9 years ago
AC_WPNav
AC_WPNav: call renamed functions in AC_AttitudeControl
9 years ago
APM_Control
APM_Control: stop using Progmem.h
9 years ago
APM_OBC
APM_OBC: use millis/micros/panic functions
9 years ago
AP_ADC
Global: don't link with AP_Progmem
9 years ago
AP_ADSB
AP_ADSB: added guided mode handling
9 years ago
AP_AHRS
AHRS_NavEKF: resolve compiler warning re signed vs unsigned comparison
9 years ago
AP_AccelCal
AP_AccelCal: use union instead of reference
9 years ago
AP_Airspeed
AP_Airspeed: fix example build
9 years ago
AP_Arming
AP_Arming: add param for accel error threshold
9 years ago
AP_Baro
AP_Baro: fix example build
9 years ago
AP_BattMonitor
AP_BattMonitor: add is_powering_off
9 years ago
AP_BoardConfig
AP_BoardConfig: fix invalid Range meta data
9 years ago
AP_Buffer
…
AP_Camera
AP_Camera: Camera options for better camera control
9 years ago
AP_Common
Global: don't link with AP_Progmem
9 years ago
AP_Compass
AP_Compass: fix example build
9 years ago
AP_Declination
Global: don't link with AP_Progmem
9 years ago
AP_EPM
AP_EPM: use millis/micros/panic functions
9 years ago
AP_Frsky_Telem
AP_FrSkyTelem: use millis/micros/panic functions
9 years ago
AP_GPS
AP_GPS: Fix param docs that had incorrect spaces
9 years ago
AP_HAL
AP_HAL: added get_custom_defaults_file() to Util
9 years ago
AP_HAL_AVR
HAL_AVR: fixed branch URL for AVR
9 years ago
AP_HAL_Empty
HAL_Empty: use 5V voltage for HAL_EMPTY
9 years ago
AP_HAL_FLYMAPLE
AP_HAL_FLYMAPLE: fix example build
9 years ago
AP_HAL_Linux
AP_HAL_Linux: add yuyv_to_grey() and crop_8bpp() to VideoIn
9 years ago
AP_HAL_PX4
HAL_PX4: debug code for FRAM corruption
9 years ago
AP_HAL_QURT
HAL_QURT: fixed README formatting
9 years ago
AP_HAL_SITL
HAL_SITL: prevent abort on select with -1 fd
9 years ago
AP_HAL_VRBRAIN
AP_HAL_VRBRAIN: add empty optical flow
9 years ago
AP_IRLock
AP_IRLock: use millis/micros/panic functions
9 years ago
AP_InertialNav
AP_InertialNav: Typo correction in comment
9 years ago
AP_InertialSensor
AP_InertialSensor: add PXFmini support
9 years ago
AP_L1_Control
AP_L1_Control: fix invalid Range meta data
9 years ago
AP_LandingGear
Remove use of PROGMEM
9 years ago
AP_Limits
Replace prog_char and prog_char_t with char
9 years ago
AP_Math
AP_Math: removed matrix3 parameter support
9 years ago
AP_Menu
AP_Menu: stop using Progmem.h
9 years ago
AP_Mission
AP_Mission: support VTOL_TAKEOFF and VTOL_LAND
9 years ago
AP_Motors
AP_Motors: added quadplane frame type
9 years ago
AP_Mount
AP_Mount_Servo: remove out of date comment
9 years ago
AP_NavEKF
AP_NavEKF: don't allocate EKF1 unless it will leave 4k free memory
9 years ago
AP_NavEKF2
AP_NavEKF2: Improve non-GPS in-flight attitude accuracy
9 years ago
AP_Navigation
…
AP_Notify
AP_Notify: Use display with bbbmini
9 years ago
AP_OpticalFlow
AP_OpticalFlow: fix example build
9 years ago
AP_Parachute
Global: don't link with AP_Progmem
9 years ago
AP_Param
AP_Param: fixed flymaple build
9 years ago
AP_RCMapper
Remove use of PROGMEM
9 years ago
AP_RPM
AP_RPM: Move timeout check into synthetic quality check.
9 years ago
AP_RSSI
Remove use of PROGMEM
9 years ago
AP_Rally
AP_Rally: use millis/micros/panic functions
9 years ago
AP_RangeFinder
AP_RangeFinder: fix example build
9 years ago
AP_Relay
AP_Relay: don't default to using two PWMs as relays on FMUv4
9 years ago
AP_Scheduler
AP_Scheduler: prevent a startup crash in autotest for Rover
9 years ago
AP_SerialManager
AP_SerialManager: remove checks for HAL_BOARD_APM2 and HAL_BOARD_APM1
9 years ago
AP_ServoRelayEvents
AP_ServoRelayEvents: use millis/micros/panic functions
9 years ago
AP_SpdHgtControl
AP_SpdHgtControl: added new path_propportion var
9 years ago
AP_TECS
AP_TECS: changed land_spdwgt to be sliding scale
9 years ago
AP_Terrain
AP_Terrain: libraries_Text_revision
9 years ago
AP_Vehicle
AP_Vehicle: standardize inclusion of libaries headers
10 years ago
DataFlash
DataFlash: remove unused callbacks, unimplemented functions
9 years ago
Filter
Global: don't link with AP_Progmem
9 years ago
GCS_Console
Global: don't link with AP_Progmem
9 years ago
GCS_MAVLink
GCS_MAVLink: regenerate headers
9 years ago
PID
Global: don't link with AP_Progmem
9 years ago
RC_Channel
RC_Channel: added pwm_to_angle_dz_trim()
9 years ago
SITL
SITL: first version of FlightAxis SITL support
9 years ago
StorageManager
StorageManager: fix example build
9 years ago
doc
…