ardupilot/libraries
ChristopherOlson cca58e393a AP_Motors:Heli_RSC - add support for rotor speed governor with droop speed control 2019-06-03 07:53:01 +09: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: call Polygon_outside directly; avoids losing first point 2019-05-29 15:34:02 +10: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_PrecLand: add floating point specifier on constant 2019-04-05 23:04:17 -07:00
AC_Sprayer AC_Sprayer: clean headers 2019-02-19 09:16:26 +11:00
AC_WPNav AC_Circle: improve target heading 2019-05-07 13:54:31 +09:00
APM_Control AR_AttitudeControl: use speed_control_active in get_desired_speed_accel_limited 2019-05-10 06:55:35 +09:00
AP_ADC AP_ADC: remove keywords.txt 2019-02-17 22:19:08 +11:00
AP_ADSB ADSB: rename dataflash to logger and fix @values whitespace 2019-03-28 14:19:01 -07:00
AP_AHRS AP_AHRS: support NMEA output 2019-05-21 09:41:15 +10:00
AP_AccelCal AP_AccelCal: use mavlink define for field length 2018-10-16 10:11:28 +11:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: GCS_MAVLink takes care of mavlink capabilities 2019-02-19 13:14:52 +11:00
AP_Airspeed AP_Airspeed: removed unusued AP_Common/Semaphore.h 2019-05-15 15:33:48 +10:00
AP_Arming AP_Arming: move arm status statustext messages back into vehicles 2019-05-30 07:37:30 +09:00
AP_Avoidance AP_Avoidance: removed unusued AP_Common/Semaphore.h 2019-05-15 15:33:48 +10:00
AP_BLHeli AP_BLHeli: Update to support newer targets and protocols 2019-05-25 09:37:56 +10:00
AP_Baro AP_Baro: support new sensor config setup 2019-05-30 15:39:57 +10:00
AP_BattMonitor AP_BattMonitor: removed unusued AP_Common/Semaphore.h 2019-05-15 15:33:48 +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_BoardConfig AP_BoardConfig: fix build for CubeBlack 2019-04-25 14:15:27 -07:00
AP_Buffer
AP_Button AP_Button: Add missing header guard 2019-05-20 23:50:23 +01:00
AP_Camera AP_Camera: fixup includes 2019-04-05 20:12:53 +11:00
AP_Common AP_Common: Location.cpp: add sanity checks 2019-05-29 09:04:37 +09:00
AP_Compass AP_Compass: removed old mRoControlZeroF7 config 2019-05-30 15:39:57 +10:00
AP_Declination AP_Declination: added generator doc 2019-04-09 10:12:14 +10:00
AP_Devo_Telem AP_Devo_Telem: add floating point constant designators 2019-04-05 23:04:17 -07:00
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_Frsky_Telem: move get_bearing_cd to Location and rename to get_bearing_to 2019-04-06 09:10:28 +11:00
AP_GPS AP_GPS_UBLOX: add support for TIMEGPS message. used to get gps week 2019-05-29 09:48:17 +10:00
AP_Gripper AP_Gripper: unify singleton naming to _singleton and get_singleton() 2019-02-10 19:09:58 -07:00
AP_HAL AP_HAL: removed board type for mRoControlZeroF7 2019-05-30 15:39:57 +10:00
AP_HAL_ChibiOS HAL_ChibiOS: convert mini-pix 2019-05-30 15:39:57 +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: change NMEA output to use new macro 2019-05-21 09:41:15 +10:00
AP_ICEngine AP_ICEngine: Add missing header guard 2019-05-20 23:50:23 +01:00
AP_IOMCU AP_IOMCU: remove 2s delay on boot and skip crc check on watchdog 2019-05-03 13:44:56 +10:00
AP_IRLock AP_IRLock: removed unusued AP_Common/Semaphore.h 2019-05-15 15:33:48 +10:00
AP_InertialNav AP_InertialNav: fix gcc8 warning 2019-04-02 19:00:02 +11:00
AP_InertialSensor AP_InertialSensor: removed old mRoControlZeroF7 config 2019-05-30 15:39:57 +10:00
AP_InternalError AP_InternalError: add internal error for out-of-range bitmask ops 2019-05-28 09:43:17 +10:00
AP_JSButton
AP_KDECAN AP_KDECAN: Fix includes 2019-04-05 20:12:53 +11:00
AP_L1_Control AP_L1_Control: use get_distance_NE instead of location_diff 2019-04-08 08:00:52 -07:00
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: move LOG_ARM_DISARM_MSG in 2019-05-30 07:37:30 +09:00
AP_Math AP_Math: add pitch-7 to rotation tests 2019-05-29 17:12:32 +10: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:Heli_RSC - add support for rotor speed governor with droop speed control 2019-06-03 07:53:01 +09:00
AP_Mount AP_Mount: Remove unneeded headers 2019-04-05 20:12:53 +11:00
AP_NMEA_Output AP_NMEA_Output: new library for writing NMEA to serial ports 2019-05-21 09:41:15 +10:00
AP_NavEKF
AP_NavEKF2 AP_NavEKF2: support higher optical flow updates rates 2019-05-11 16:23:57 +09:00
AP_NavEKF3 AP_NavEKF3: Fix GPS < 3D empty PreArm: msg-as EKF2 2019-05-20 16:57:57 +10:00
AP_Navigation
AP_Notify AP_Notify: add mutex against maniplating sf windows from different threads 2019-05-21 09:21:56 +10:00
AP_OSD AP_OSD: take ahrs and baro semaphores 2019-05-30 08:33:12 +10:00
AP_OpticalFlow AP_OpticalFlow: Correct CX-OF Data Format Sequence 2019-05-29 10:22:51 +09: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: avoid allocating 0 bytes if no defaults 2019-05-14 08:02:54 +10:00
AP_Proximity AP_Proximity: increase angular resoluion to mavlink packet OBSTACLE_DISTANCE 2019-05-29 18:22:53 -07:00
AP_RAMTRON AP_RAMTRON: removed unusued AP_Common/Semaphore.h 2019-05-15 15:33:48 +10:00
AP_RCMapper
AP_RCProtocol AP_RCProtocol: Change to shared CRC16 method 2019-04-09 12:50:17 +10:00
AP_ROMFS AP_ROMFS: Add missing header guard 2019-05-20 23:50:23 +01:00
AP_RPM AP_RPM: add AP::rpm() call for singleton 2019-03-16 10:33:01 +09:00
AP_RSSI AP_RSSI: make type enum class, remove default clause in type switch 2019-04-09 09:31:47 +10:00
AP_RTC AP_RTC: added a millisecond jitter correction function 2018-12-31 09:56:04 +09:00
AP_Radio AP_Radio: correct singleton naming, and thus SkyViper build 2019-02-20 19:02:41 +11:00
AP_Rally AP_Rally: adjust to allow for uploading via the mission item protocol 2019-05-22 08:53:45 +10:00
AP_RangeFinder AP_RangeFinder: TFMiniPlus: enforce minimum version 1.7.6 2019-05-24 01:47:04 -07:00
AP_Relay AP_Relay: Add singleton 2019-04-26 08:07:19 +10:00
AP_RobotisServo AP_RobotisServo: fix includes place and order 2019-03-26 10:27:54 +11:00
AP_SBusOut AP_SBusOut: fix includes place and order 2019-03-26 10:27:54 +11:00
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_SerialManager: support NMEA output 2019-05-21 09:41:15 +10:00
AP_ServoRelayEvents
AP_SmartRTL AP_SmartRTL: Bitmask is now a template 2019-04-16 15:12:07 +10:00
AP_Soaring AP_Soaring: use get_distance_NE instead of location_diff 2019-04-08 08:00:52 -07:00
AP_SpdHgtControl GLOBAL: rename DataFlash_Class to AP_Logger 2019-01-18 18:08:20 +11:00
AP_Stats AP_Stats: Improve reset documentation (NFC) 2019-02-28 09:20:10 +09:00
AP_TECS AP_TECS: fixed a bug in changes from rate-limited to non-limited airspeed 2019-04-01 12:14:25 +11:00
AP_TempCalibration AP_TempCalibration: add floating-point-constant designators 2019-04-05 23:04:17 -07:00
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 GLOBAL: use AP::logger() and strip redundant Log_ from methods 2019-01-18 18:08:20 +11:00
AP_UAVCAN AP_UAVCAN:add hex flow sensor message 2019-05-15 16:01:53 +09:00
AP_Vehicle AP_Vehicle: added iofirmware vehicle type 2019-03-15 14:38:57 +11:00
AP_VisualOdom AP_VisualOdom: Remove unused include 2019-04-05 20:12:53 +11:00
AP_Volz_Protocol AP_Volz_Protocol: fixed build warnings 2018-10-17 12:54:22 +11:00
AP_WheelEncoder AP_WheelEncoder: move wheelEncoder logging to library 2019-02-06 10:41:59 +09:00
AP_Winch
AP_WindVane AP_WindVane: add modern devices rev p cal 2019-05-28 08:35:58 +09:00
AR_WPNav AR_WPNav: add is_destination_valid accessor 2019-05-29 09:40:05 +09:00
Filter Filter: add missing override keyword 2019-02-20 19:23:54 +11:00
GCS_MAVLink GCS_MAVLink: allow Copter to disallow mavlink disarm 2019-05-30 07:37:30 +09:00
PID GLOBAL: rename DataFlash_Class to AP_Logger 2019-01-18 18:08:20 +11:00
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
doc