Ardupilot2/libraries
Andrew Tridgell 4f243aca02 AP_TECS: prevent rapid changing of pitch limits on landing approach
when on landing approach we estimate time to flare based on two noisy
numbers, the vertical speed and height above ground. With noisy
rangefinders this can change rapidly, which resulted in the pitch
limit changing rapidly, leading to a porpoising movement

this limits the rate of change, and also prevents it coming down once
it has nosed up due to pending flare on approach
2019-08-01 11:28:22 +10:00
..
AC_AttitudeControl AC_PosControl: support update to PID object 2019-07-25 17:38:15 +09:00
AC_AutoTune AC_AutoTune: support for upgrade to PID object 2019-07-25 17:38:15 +09:00
AC_Avoidance AP_OADijkstra: redo visgraphs if polyfence is changed 2019-07-15 13:45:10 +09:00
AC_Fence AC_Fence: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AC_InputManager
AC_PID AC_HELI_PID: support for upgrade to PID object 2019-07-25 17:38:15 +09:00
AC_PrecLand AC_PrecLand: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AC_Sprayer AC_Sprayer: clean headers 2019-02-19 09:16:26 +11:00
AC_WPNav AC_WPNav: take references to inav's position rather than a copy 2019-07-12 21:56:06 +09:00
AP_AccelCal AP_AccelCal: remove wrapper around send_text 2019-07-30 10:06:42 +10:00
AP_ADC AP_ADC: remove keywords.txt 2019-02-17 22:19:08 +11:00
AP_ADSB AP_ADSB: resolve gcs::send_text compiler warning 2019-07-30 09:02:39 +09:00
AP_AdvancedFailsafe AP_Advanced_Failsafe: Reduce scope of AP_Baro.h 2019-06-27 14:56:21 +10:00
AP_AHRS AP_AHRS: rangefinder no longer takes SerialManager in constructor 2019-07-16 09:29:48 +10:00
AP_Airspeed AP_Airspeed: support both 5inH2O and 10inH2O versions of DLVR sensor 2019-07-19 21:39:30 -07:00
AP_Arming AP_Arming: Add rangefinder checks 2019-07-30 10:42:16 +10:00
AP_Avoidance AP_Avoidance: stop copying adsb vehicle onto stack in src_id_for_adsb_vehicle 2019-07-16 10:30:55 +10:00
AP_Baro AP_Baro: use sensor_config_error on baro cal failure 2019-07-31 14:30:49 +10:00
AP_BattMonitor AP_BattMonitor: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AP_Beacon AP_Beacon: Common modbus crc method 2019-07-12 15:33:21 +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_CAN: fix bad get_slcan_serial method 2019-07-31 17:24:13 +10:00
AP_Buffer
AP_Button AP_Button: use send_to_active_channels() 2019-06-06 12:41:48 +10:00
AP_Camera AP_Camera: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AP_Common AP_Common: add AP_ExpandingGeneric to reduce code size 2019-06-20 15:09:23 +09:00
AP_Compass AP_Compass: Refactor battery current backend 2019-07-14 00:28:00 -07: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_FrSkyTelem: Refactor battery current interface 2019-07-14 00:28:00 -07:00
AP_GPS AP_GPS: ensure we have full timestamp before setting RTC clock 2019-07-31 20:13:55 +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: added logging of hardware fault information in watchdog 2019-07-19 16:02:41 +10:00
AP_HAL_ChibiOS HAL_ChibiOS: added commented out baro on SPI5 for fmuv5 2019-07-29 10:09:08 +10:00
AP_HAL_Empty HAL_Empty: added uartH 2019-07-12 17:01:21 +10:00
AP_HAL_Linux AP_HAL_Linux: UARTDriver remove unused field and tabs 2019-07-21 21:52:42 -07:00
AP_HAL_SITL HAL_SITL: enable airsim SITL backend 2019-07-17 07:26:50 +10:00
AP_ICEngine AP_ICEngine: Add missing header guard 2019-05-20 23:50:23 +01:00
AP_InertialNav AP_InertialNav: Remove unneeded methods 2019-07-16 12:11:42 +09:00
AP_InertialSensor AP_InertialSensor: special check for CubeBlack to force INS_USE3=1 2019-07-31 12:53:57 +10:00
AP_InternalError AP_InternalError: move include of BoardConfig to cpp 2019-07-04 13:57:40 +10:00
AP_IOMCU AP_IOMCU: remove autodetection of heater pin polarity, instead hardcode it 2019-07-25 17:05:41 +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 Global: rename desired to target in PID info 2019-07-25 17:38:15 +09: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: log baro health 2019-07-31 12:53:57 +10:00
AP_Math AP_Math: add WARN_IF_UNUSED to bool methods 2019-07-26 09:26:02 +09:00
AP_Menu
AP_Mission AP_Mission: Refactor read_cmd_from_storage for clarity 2019-07-31 09:13:43 +10:00
AP_Module AP_Module: update example baro include 2019-06-27 14:56:21 +10:00
AP_Motors AP_Motors: fixed typo in MotorsMatrixTS update for FF 2019-07-25 17:38:15 +09:00
AP_Mount AP_Mount: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AP_NavEKF AP_NavEKF: added gps_quality_good EKF flag 2018-07-14 17:49:52 +10:00
AP_NavEKF2 AP_NavEKF2: fixed baro innovation gate when on ground with AIDING_NONE 2019-07-30 08:23:21 +10:00
AP_NavEKF3 AP_NavEKF3: fixed baro innovation gate when on ground with AIDING_NONE 2019-07-30 08:23:21 +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: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AP_OpticalFlow AP_OpticalFlow: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AP_OSD AP_OSD_Screen: fix param descriptions 2019-07-20 14:23:55 +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: flush() after converting parameters 2019-07-30 10:42:16 +10:00
AP_Proximity AP_Proximity: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10: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: added a 1.5 delay to probe of LW20 I2C 2019-07-30 13:32:36 +10:00
AP_RCMapper AP_RCMapper: Fix sub only documentation on channels 2019-07-23 09:29:48 +10:00
AP_RCProtocol AP_RCProtocol: IBUS remove unused field 2019-07-22 09:12:57 +09: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: resolve gcs::send_text compiler warning 2019-07-30 09:02:39 +09: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: Cope with new AP_GPS::first_unconfigured_gps 2019-07-30 10:12:43 +10:00
AP_SerialManager AP_SerialManager: added uartH support 2019-07-12 17:01:21 +10:00
AP_ServoRelayEvents AP_ServoRelayEvents: use Relay singleton 2019-07-03 23:59:24 -07:00
AP_SmartRTL AP_SmartRTL: rangefinder no longer takes SerialManager in constructor 2019-07-16 09:29:48 +10:00
AP_Soaring AP_Soaring: move include of logger to .cpp file 2019-07-09 10:57:20 +10:00
AP_SpdHgtControl AP_SpdHgtControl: remove unused includes 2019-07-09 10:57:20 +10:00
AP_Stats AP_Stats: Improve reset documentation (NFC) 2019-02-28 09:20:10 +09:00
AP_TECS AP_TECS: prevent rapid changing of pitch limits on landing approach 2019-08-01 11:28:22 +10:00
AP_TempCalibration AP_TempCalibration: Include needed AP_Baro.h 2019-06-27 14:56:21 +10:00
AP_TemperatureSensor
AP_Terrain AP_Terrain: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AP_ToshibaCAN AP_ToshibaCAN: removed unusued AP_Common/Semaphore.h 2019-05-15 15:33:48 +10:00
AP_Tuning AP_Tuning: tidy includes 2019-07-09 10:57:20 +10:00
AP_UAVCAN AP_UAVCAN: remove singleton interface from slcan_router 2019-07-08 12:18:29 +10:00
AP_Vehicle AP_Vehicle: added iofirmware vehicle type 2019-03-15 14:38:57 +11:00
AP_VisualOdom AP_VisualOdom: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AP_Volz_Protocol AP_Volz_Protocol: fixed build warnings 2018-10-17 12:54:22 +11:00
AP_WheelEncoder AP_WheelEncoder: support for upgrade to PID object 2019-07-25 17:38:15 +09:00
AP_Winch AP_Winch: support for upgrade to PID object 2019-07-25 17:38:15 +09:00
AP_WindVane AP_Windvane: fix NMEA vehicle to earth frame 2019-06-08 09:48:03 +09:00
APM_Control APM_Control: support for upgrade to PID object 2019-07-25 17:38:15 +09: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_MAVLink: resolve gcs::send_text compiler warning 2019-07-30 09:02:39 +09:00
PID Global: rename desired to target in PID info 2019-07-25 17:38:15 +09:00
RC_Channel RC_Channel: resolve gcs::send_text compiler warning 2019-07-30 09:02:39 +09:00
SITL Tools: update parameter files after PID upgrade 2019-07-25 17:38:15 +09: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