ardupilot/libraries
Andrew Tridgell 20ebb2500b AP_NavEKF2: ensure that both AMSL and relative alt are correct after a reset
this forces the EKF origin to the GPS alt on a height datum reset if
we have GPS lock. If we don't do this then the reported AMSL alt will
drift over time away from the GPS alt when we reset while on the
ground
2019-07-07 19:20:32 +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 AP_OAPathPlanner: report errors to caller 2019-07-07 06:46:26 +09:00
AC_Fence AC_Fence: add get_boundary_update_ms 2019-06-11 13:13:22 +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_WPNav: remove brake 2019-06-13 09:02:46 +09:00
AP_AccelCal AP_AccelCal: use mavlink define for field length 2018-10-16 10:11:28 +11:00
AP_ADC AP_ADC: remove keywords.txt 2019-02-17 22:19:08 +11:00
AP_ADSB AP_ADSB: Include needed AP_Baro.h 2019-06-27 14:56:21 +10:00
AP_AdvancedFailsafe AP_Advanced_Failsafe: Reduce scope of AP_Baro.h 2019-06-27 14:56:21 +10:00
AP_AHRS AP_AHRS: only use enabled IMUs in DCM 2019-07-07 19:03:01 +10:00
AP_Airspeed AP_Airspeed: use send_to_active_channels for airspeed_autocal 2019-06-29 16:04:26 +10:00
AP_Arming AP_Arming: remove stray comment on removed parameter 2019-07-02 10:03:41 +10: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: add battery pin config for CubeOrange 2019-06-28 14:18:11 +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_Camera: fixup includes 2019-04-05 20:12:53 +11:00
AP_Common AP_Common: add AP_ExpandingGeneric to reduce code size 2019-06-20 15:09:23 +09:00
AP_Compass AP_Compass: fix example by instantiating serial_manager 2019-07-01 19:11:03 +10:00
AP_Declination AP_Declination: added get_earth_field_ga() interface 2019-06-03 12:21:29 +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: Don't statically allocate the statustext_queue 2019-06-26 11:59:41 +10:00
AP_GPS AP_GPS: fixed u-blox F9 auto configuration 2019-07-05 13:31:40 +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: enable GPIO scripting on the Disco 2019-07-06 09:02:54 +10:00
AP_HAL_ChibiOS HAL_ChibiOS: cope with calling delay_microseconds_boost() multiple times 2019-07-07 19:03:01 +10:00
AP_HAL_Empty HAL_Empty: added empty flash driver 2019-04-11 13:22:53 +10:00
AP_HAL_Linux HAL_Linux: implement HAL_GPIO_SCRIPT support 2019-07-06 09:02:54 +10:00
AP_HAL_SITL AP_HAL_SITL: add missing include for AP_BoardConfig.h 2019-07-04 13:57:40 +10:00
AP_ICEngine AP_ICEngine: Add missing header guard 2019-05-20 23:50:23 +01:00
AP_InertialNav AP_InertialNav: Remove undeeded includes 2019-06-27 14:56:21 +10:00
AP_InertialSensor AP_InertialSensor: disable kill IMUs with HAL_MINIMIZE_FEATURES 2019-07-07 19:03:01 +10:00
AP_InternalError AP_InternalError: move include of BoardConfig to cpp 2019-07-04 13:57:40 +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_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 AP_GPS.h include, use a ref to the singleton 2019-06-18 10:02:05 +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 logging of EKF packets out to EKF 2019-07-06 19:05:51 +10:00
AP_Math AP_Math: add tests for Vector2 2019-06-13 19:36:49 +10:00
AP_Menu
AP_Mission AP_Mission: fixed valgrind error on writing mission items 2019-06-24 18:19:14 +08:00
AP_Module AP_Module: update example baro include 2019-06-27 14:56:21 +10:00
AP_Motors AP_Motors: fixed col max and min for dual heli 2019-07-06 08:57:18 +10:00
AP_Mount AP_Mount: don't use disabled IMUs in solo gimbal code 2019-07-07 19:03:01 +10:00
AP_NavEKF AP_NavEKF: added gps_quality_good EKF flag 2018-07-14 17:49:52 +10:00
AP_NavEKF2 AP_NavEKF2: ensure that both AMSL and relative alt are correct after a reset 2019-07-07 19:20:32 +10:00
AP_NavEKF3 AP_NavEKF3: don't use disabled gyros in opticalflow takeoff detection 2019-07-07 19:03:01 +10:00
AP_Navigation AP_L1_Control: update_waypoint gets dist_min argument 2018-04-05 12:14:59 +09:00
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 comments explaining tonealarm tone format 2019-07-03 17:05:06 +10:00
AP_OpticalFlow AP_OpticalFlow: Correct CX-OF Data Format Sequence 2019-05-29 10:22:51 +09:00
AP_OSD AP_OSD: Include needed AP_Baro.h 2019-06-27 14:56:21 +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: move copy_locations to backend 2019-06-11 13:13:22 +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_RAMTRON AP_RAMTRON: removed unusued AP_Common/Semaphore.h 2019-05-15 15:33:48 +10:00
AP_RangeFinder AP_Rangefinder: fix compilation for Bebop 2019-06-14 18:56:05 -07:00
AP_RCMapper AP_RCMapper: Mark sub specific parameters as sub only for docs 2018-07-17 12:08:27 +10:00
AP_RCProtocol AP_RCProtocol: fixed a overflow in SRXL decoder 2019-07-06 08:53:44 +10:00
AP_Relay AP_Relay: add AP::relay() to get relay singleton 2019-07-03 23:59:24 -07:00
AP_RobotisServo AP_RobotisServo: fix includes place and order 2019-03-26 10:27:54 +11:00
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_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_SBusOut AP_SBusOut: fix includes place and order 2019-03-26 10:27:54 +11:00
AP_Scheduler AP_Scheduler: include internal error count in PM log message 2019-06-12 10:05:59 +10:00
AP_Scripting AP_Scripting: Tighten range checks on library calls 2019-07-06 09:01:13 -07:00
AP_SerialManager AP_SerialManger: add windvane serial type 2019-06-03 10:48:19 +09:00
AP_ServoRelayEvents AP_ServoRelayEvents: use Relay singleton 2019-07-03 23:59:24 -07:00
AP_SmartRTL AP_SmartRTL: Bitmask is now a template 2019-04-16 15:12:07 +10:00
AP_Soaring AP_Soaring: remove definition of 'N' macro in favour of scoped variable 2019-06-27 14:40:44 +10: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: Include needed AP_Baro.h 2019-06-27 14:56:21 +10:00
AP_TempCalibration AP_TempCalibration: Include needed AP_Baro.h 2019-06-27 14:56:21 +10:00
AP_TemperatureSensor AP_TemperatureSensor: remove pointless constructor 2018-05-17 15:37:14 +10:00
AP_Terrain AP_Terrain: Remove unneeded includes 2019-06-27 14:56:21 +10:00
AP_ToshibaCAN AP_ToshibaCAN: removed unusued AP_Common/Semaphore.h 2019-05-15 15:33:48 +10:00
AP_Tuning AP_Tuning: Reduce header scope 2019-06-27 14:56:21 +10:00
AP_UAVCAN AP_UAVCAN: fixed build error of F4 boards with CAN 2019-06-05 18:54:40 +10:00
AP_Vehicle AP_Vehicle: added iofirmware vehicle type 2019-03-15 14:38:57 +11:00
AP_VisualOdom AP_VisualOdom: Remove uneeded include 2019-06-27 14:56:21 +10: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_Winch: undefine PASS_TO_BACKEND convenience function 2018-08-17 21:14:57 +09:00
AP_WindVane AP_Windvane: fix NMEA vehicle to earth frame 2019-06-08 09:48:03 +09:00
APM_Control APM_Control: added decay_I() function 2019-07-07 18:16:47 +10:00
AR_WPNav AR_WPNav: stop vehicle if OA processing fails 2019-07-07 06:46:26 +09:00
doc
Filter Filter: Allow all filter frequencies to be 16bit. 2019-06-06 17:09:17 +10:00
GCS_MAVLink GCS_Param: correct sending of parameters of length 16 2019-07-06 18:06:17 +10:00
PID GLOBAL: rename DataFlash_Class to AP_Logger 2019-01-18 18:08:20 +11:00
RC_Channel RC_Channel: disable kill IMU with HAL_MINIMIZE_FEATURES 2019-07-07 19:03:01 +10:00
SITL SITL: fixed pitch constraint on fixed wing takeoff 2019-07-05 20:12:22 +10:00
SRV_Channel SRV_Channel: allow DO_SET_SERVO commands while rc pass-thru 2019-06-13 09:51:21 +09:00
StorageManager StorageManager: allow for 15k storage 2018-06-24 08:26:28 +10:00