ardupilot/libraries
2019-06-11 10:28:45 +10:00
..
AC_AttitudeControl Plane: limit yaw error in bodyframe roll control 2019-04-30 08:51:24 +10:00
AC_AutoTune AC_AutoTune: add public reset method 2019-05-07 09:23:50 +10:00
AC_Avoidance AC_Avoid: restructure logic of adjust_velocity_circle_fence 2019-06-08 09:35:36 +09:00
AC_Fence AC_Fence: simplify fence loading 2019-05-30 16:03:58 +09:00
AC_InputManager
AC_PID AC_PID: correct examples with override keyword 2019-04-30 09:29:59 +10:00
AC_PrecLand
AC_Sprayer
AC_WPNav AC_WPNav: use singleton for getting AC_Avoid instance 2019-06-06 11:47:22 +10:00
AP_AccelCal
AP_ADC
AP_ADSB
AP_AdvancedFailsafe
AP_AHRS AP_AHRS: take EAS2TAS directly from Baro (rather than via airspeed) 2019-06-06 12:44:36 +10:00
AP_Airspeed AP_AirSpeed: take EAS2TAS directory from baro; use for all backends 2019-06-06 12:44:36 +10:00
AP_Arming AP_Arming: make proximity sensor checks common 2019-06-04 08:45:34 +09:00
AP_Avoidance AP_Avoidance: removed unusued AP_Common/Semaphore.h 2019-05-15 15:33:48 +10:00
AP_Baro AP_Baro: support new sensor config setup 2019-05-30 15:39:57 +10:00
AP_BattMonitor AP_BattMonitor: Remove param ignore flags 2019-06-11 10:28:45 +10:00
AP_Beacon AP_Beacon: do not include fence closing/duplicate point in polygon boundary 2019-05-29 15:34:02 +10:00
AP_BLHeli AP_BLHeli: Update to support newer targets and protocols 2019-05-25 09:37:56 +10:00
AP_BoardConfig AP_BoardConfig: fix build for CubeBlack 2019-04-25 14:15:27 -07:00
AP_Buffer
AP_Button AP_Button: use send_to_active_channels() 2019-06-06 12:41:48 +10:00
AP_Camera
AP_Common AP_Common: Location.cpp: add sanity checks 2019-05-29 09:04:37 +09:00
AP_Compass AP_Compass: use new get_earth_field_ga() API 2019-06-03 12:21:29 +10:00
AP_Declination AP_Declination: added get_earth_field_ga() interface 2019-06-03 12:21:29 +10:00
AP_Devo_Telem
AP_FlashStorage AP_FlashStorage: fixed build error with -O0 2019-05-15 15:33:48 +10:00
AP_Follow AP_Follow: correct parameter descriptions 2019-05-13 15:34:01 +10:00
AP_Frsky_Telem
AP_GPS AP_GPS: fix missing-declaration warning in example 2019-06-04 10:25:15 +10:00
AP_Gripper
AP_HAL AP_HAL: fix RCOutput, RCOutput2 and RCInputToRCOutput examples to prevent the failure of reading and writing channels. 2019-06-11 10:27:44 +10:00
AP_HAL_ChibiOS HAL_ChibiOS: move the power control changes to be only CubeBlack 2019-06-09 16:56:14 +10:00
AP_HAL_Empty HAL_Empty: added empty flash driver 2019-04-11 13:22:53 +10:00
AP_HAL_Linux AP_HAL_Linux: add required override keyword on configure_parity 2019-05-27 09:55:18 -07:00
AP_HAL_SITL AP_HAL_SITL: attempt to dump stack trace as part of segv handler 2019-06-07 22:03:41 +10:00
AP_ICEngine AP_ICEngine: Add missing header guard 2019-05-20 23:50:23 +01:00
AP_InertialNav
AP_InertialSensor AP_InertialSensor: Post-filter logging takes precedence over sensor-rate logging. 2019-06-06 17:09:17 +10:00
AP_InternalError AP_InternalError: removed unused internal error 2019-06-06 16:35:22 +10:00
AP_IOMCU AP_IOMCU_FW: autodetect active high/low on heater control pin 2019-06-08 14:31:01 +10:00
AP_IRLock AP_IRLock: removed unusued AP_Common/Semaphore.h 2019-05-15 15:33:48 +10:00
AP_JSButton
AP_KDECAN
AP_L1_Control
AP_Landing AP_Landing: Fix shadowing with deepstall 2019-05-13 15:46:38 +10:00
AP_LandingGear AP_LandingGear: minor format fix 2019-05-11 08:49:40 +09:00
AP_LeakDetector AP_LeakDetector: add missing override keywords 2019-05-15 21:05:20 +10:00
AP_Logger AP_Logger: removed internal error for logging without sem 2019-06-06 16:35:22 +10:00
AP_Math AP_Math: add speed unit converstion defs 2019-06-03 10:48:19 +09:00
AP_Menu
AP_Mission AP_Mission: break out a convert_MISSION_ITEM_to_MISSION_ITEM_INT method 2019-05-22 08:53:45 +10:00
AP_Module
AP_Motors AP_Motors: Added Octo I frame 2019-06-04 09:49:44 +09:00
AP_Mount
AP_NavEKF
AP_NavEKF2 AP_NavEKF2: default EK2_MAG_EF_LIM to 50 2019-06-08 20:24:58 +10:00
AP_NavEKF3 AP_NavEKF3: take EAS2TAS from AHRS rather than airspeed 2019-06-06 12:44:36 +10:00
AP_Navigation
AP_NMEA_Output AP_NMEA_Output: new library for writing NMEA to serial ports 2019-05-21 09:41:15 +10:00
AP_Notify AP_Notify: add mutex against maniplating sf windows from different threads 2019-05-21 09:21:56 +10:00
AP_OpticalFlow AP_OpticalFlow: Correct CX-OF Data Format Sequence 2019-05-29 10:22:51 +09:00
AP_OSD AP_OSD: take ahrs and baro semaphores 2019-05-30 08:33:12 +10:00
AP_Parachute AP_Parachute: Added time check for sink rate to avoid glitches 2019-04-30 10:04:58 +10:00
AP_Param AP_Param: Remove non functional AP_Param ignore flags 2019-06-11 10:28:45 +10:00
AP_Proximity AP_Proximity: remove dangling update_instance declaration 2019-06-04 19:36:57 +09:00
AP_Radio
AP_Rally AP_Rally: adjust to allow for uploading via the mission item protocol 2019-05-22 08:53:45 +10:00
AP_RAMTRON AP_RAMTRON: removed unusued AP_Common/Semaphore.h 2019-05-15 15:33:48 +10:00
AP_RangeFinder AP_RangeFinder: remove dangling update_instance declaration 2019-06-04 19:36:57 +09:00
AP_RCMapper
AP_RCProtocol AP_RCProtocol: fix missing-declaration warning in example 2019-06-04 10:25:15 +10:00
AP_Relay AP_Relay: Add singleton 2019-04-26 08:07:19 +10:00
AP_RobotisServo
AP_ROMFS AP_ROMFS: Add missing header guard 2019-05-20 23:50:23 +01:00
AP_RPM AP_RPM: remove dangling update_instance declaration 2019-06-04 19:36:57 +09:00
AP_RSSI
AP_RTC
AP_SBusOut
AP_Scheduler AP_Scheduler: use task -3 for wait_for_sample() 2019-05-17 09:00:22 +10:00
AP_Scripting AP_Scripting: Fix up some warnings 2019-05-11 18:25:43 -07:00
AP_SerialManager AP_SerialManger: add windvane serial type 2019-06-03 10:48:19 +09:00
AP_ServoRelayEvents
AP_SmartRTL AP_SmartRTL: Bitmask is now a template 2019-04-16 15:12:07 +10:00
AP_Soaring
AP_SpdHgtControl
AP_Stats
AP_TECS
AP_TempCalibration
AP_TemperatureSensor
AP_Terrain AP_Terrain: Add singleton 2019-04-26 08:07:19 +10:00
AP_ToshibaCAN AP_ToshibaCAN: removed unusued AP_Common/Semaphore.h 2019-05-15 15:33:48 +10:00
AP_Tuning
AP_UAVCAN AP_UAVCAN: fixed build error of F4 boards with CAN 2019-06-05 18:54:40 +10:00
AP_Vehicle
AP_VisualOdom
AP_Volz_Protocol
AP_WheelEncoder
AP_Winch
AP_WindVane AP_Windvane: fix NMEA vehicle to earth frame 2019-06-08 09:48:03 +09:00
APM_Control AR_AttitudeControl: set-throttle-out-stop considered same as running speed controller 2019-06-08 09:35:36 +09:00
AR_WPNav AR_WPNav: add is_destination_valid accessor 2019-05-29 09:40:05 +09:00
doc
Filter Filter: Allow all filter frequencies to be 16bit. 2019-06-06 17:09:17 +10:00
GCS_MAVLink GCS_MAVLink: correct is_streaming check and update of is-streaming mask 2019-06-11 09:26:10 +10:00
PID
RC_Channel RC_Channel: handle AUX_FUNC::ARMDISARM 2019-05-30 07:37:30 +09:00
SITL SITL: Sailboat: write rpm and airspeed for windvane backends 2019-05-28 08:35:58 +09:00
SRV_Channel SRV_Channel: Bitmask is now a template 2019-04-16 15:12:07 +10:00
StorageManager