ardupilot/libraries
Andrew Tridgell 7cc11e6856 AP_GPS: fixed handling of loss of GPS yaw
when the GPS yaw data doesn't pass the internal tests of validity for
400ms we need to stop telling the EKF that we have valid yaw
2021-05-04 10:37:15 +10:00
..
AC_AttitudeControl AC_PosControl: Calculate heading 2021-04-27 17:13:55 +09:00
AC_Autorotation AC_Autorotation: Add copter vehicle type to flight log metadata 2021-02-08 22:09:49 -05:00
AC_AutoTune AC_AutoTune: remove start method and always init position controller 2021-05-03 20:23:27 -04:00
AC_Avoidance AC_Avoidance: Privatize Logging 2021-05-01 19:21:17 +10:00
AC_Fence AC_Fence: Correct Rover metadata 2021-04-27 09:31:09 +09:00
AC_InputManager
AC_PID AC_PID: log SRate in pid info and expose slew rate 2021-04-15 06:57:16 +10:00
AC_PrecLand AC_PrecLand: use enum-class for Type, make enum private 2021-04-14 18:04:26 +10:00
AC_Sprayer
AC_WPNav AC_WPNav: remove unused function 2021-05-03 20:10:39 -04:00
AP_AccelCal AP_AccelCal: rename from review feedback 2021-01-21 13:09:21 +11:00
AP_ADC
AP_ADSB AP_ADSB: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: move handling of last-seen-SYSID_MYGCS up to GCS base class 2021-04-07 17:54:21 +10:00
AP_AHRS AP_AHRS: remove duplicate log metadata fields 2021-04-27 16:38:40 +10:00
AP_Airspeed AP_Airspeed: added ASP5033 driver 2021-03-28 07:50:34 +11:00
AP_Arming AP_Arming: add MPPT PacketDigital driver 2021-04-28 19:22:53 -07:00
AP_Avoidance AP_Avoidance: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_Baro AP_Baro: work around bad WHOAMI read on DPS310 2021-03-31 13:26:52 +11:00
AP_BattMonitor AP_BattMonitor: prepare MPPT driver for AP_Periph 2021-04-28 19:22:53 -07:00
AP_Beacon AP_Beacon: added const 2020-11-11 16:14:22 -08:00
AP_BLHeli AP_BLHeli: index bi-dir dshot channels through the motor map 2021-04-21 17:18:53 +10:00
AP_BoardConfig AP_BoardConfig: added get_heater_duty_cycle() 2021-02-09 11:32:19 +11:00
AP_Button AP_Button: log auxillary function invocations 2021-04-29 13:00:40 +10:00
AP_Camera AP_Camera: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_CANManager AP_CANManager: add MPPT PacketDigital driver 2021-04-28 19:22:53 -07:00
AP_Common AP_Common: fixed null termination bug in ExpandingString 2021-04-21 07:12:55 +10:00
AP_Compass AP_Compass: fixed the IST8308 on CubeBlack 2021-04-20 10:42:54 +10:00
AP_DAL AP_DAL: remove separate calls to get delta-times for vel and ang 2021-03-13 11:29:29 +11:00
AP_Declination
AP_Devo_Telem
AP_EFI AP_EFI: use enum class for protocol 2021-03-30 21:40:35 +11:00
AP_ESC_Telem AP_ESC_Telem: Fix copy & paste typo 2021-02-24 12:49:05 +11:00
AP_ExternalAHRS AP_ExternalAHRS: remove message when EAHRS_TYPE is None 2021-04-14 14:46:03 +10:00
AP_Filesystem AP_Filesystem: fix build on macOS 2021-04-21 11:33:52 +10:00
AP_FlashStorage AP_FlashStorage: support STM32G4 2021-03-23 12:01:20 +11:00
AP_Follow
AP_Frsky_Telem AP_Frsky_Telem: change for AP::terrain as a pointer 2021-04-07 20:56:01 +10:00
AP_Generator AP_Generator: Simplify boolean expression 2021-02-23 10:30:05 +11:00
AP_GPS AP_GPS: fixed handling of loss of GPS yaw 2021-05-04 10:37:15 +10:00
AP_Gripper
AP_GyroFFT AP_GyroFFT: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_HAL AP_HAL: update hardware definitions for navigator r3 2021-04-07 15:08:18 -04:00
AP_HAL_ChibiOS HAL_ChibiOS: default SDMMC clock to 12.5MHz max on H7 2021-05-02 13:04:42 +10:00
AP_HAL_Empty AP_HAL_Empty: removed assert calls 2021-03-25 14:03:40 +11:00
AP_HAL_Linux HAL_Linux: added --defaults option to Linux HAL 2021-04-13 09:36:52 +10:00
AP_HAL_SITL AP_HAL_SITL: Add uart specification and array 2021-04-28 17:08:12 +10:00
AP_Hott_Telem AP_Hott_Telem: use GPS single-char representation of fix type 2021-02-18 08:59:23 +11:00
AP_ICEngine AP_ICEngine: make it obvious that update_idle_gov does nothing if disabled 2021-02-18 09:45:30 +11:00
AP_InertialNav
AP_InertialSensor AP_InertialSensor: move GYR & ACC logging functions to Logging.cpp 2021-05-01 14:15:58 +10:00
AP_InternalError AP_InternalError: added invalid_arguments failure 2021-04-03 12:07:59 +09:00
AP_IOMCU AP_IOMCU: ChibiOS 20.3.x build fix 2021-03-23 12:01:20 +11:00
AP_IRLock
AP_JSButton
AP_KDECAN AP_KDECAN: map ESC id to servo channel and passthrough pwm 2021-04-20 09:13:30 +10:00
AP_L1_Control AP_L1_Control: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_Landing AP_Landing: Autoenable fence if required when landing was aborted 2021-03-05 14:52:46 +11:00
AP_LandingGear AP_LandingGear: Simplify boolean expression 2021-02-23 10:30:05 +11:00
AP_LeakDetector AP_LeakDetector: update leak pin for navigator r3 2021-04-07 15:08:18 -04:00
AP_Logger AP_Logger: minimal fix for allowing log listing while logging 2021-05-01 19:21:48 +10:00
AP_LTM_Telem AP_LTM_Telem: get airspeed sensor from singleton not AHRS object 2020-12-07 15:57:28 -08:00
AP_Math AP_Math: added helper for16bit float conversions 2021-04-28 19:22:53 -07:00
AP_Menu
AP_Mission AP_Mission: log auxillary function invocations 2021-04-29 13:00:40 +10:00
AP_Module AP_Module: fix example 2021-03-03 18:07:38 +11:00
AP_Motors AP_Motors: tailsitter: slew outputs and output throttle directly 2021-04-27 09:37:32 +10:00
AP_Mount AP_Mount: remove separate calls to get delta-times for vel and ang 2021-03-13 11:29:29 +11:00
AP_MSP AP_MSP: removed date/time from MSP 2021-02-13 19:24:48 +11:00
AP_NavEKF AP_NavEKF: Change misnomer (NFC) 2021-03-19 17:49:27 +11:00
AP_NavEKF2 AP_NavEKF2: Change misnomer (NFC) 2021-03-19 17:49:27 +11:00
AP_NavEKF3 AP_NavEKF3: simplify taking of GPS measurements 2021-03-23 15:11:33 +11:00
AP_Navigation
AP_NMEA_Output AP_NMEA: fix example 2021-03-03 18:07:38 +11:00
AP_Notify AP_Notify: correct parameter documentation 2021-04-30 13:50:47 +10:00
AP_OLC AP_OLC: fixed build of OSD on SITL 2020-11-12 14:22:44 -08:00
AP_OpticalFlow AP_OpticalFlow: TYPE param becomes enable flag 2021-04-30 19:06:14 -04:00
AP_OSD AP_OSD: fix disable value for terrain alt warning 2021-05-04 10:13:56 +10:00
AP_Parachute AP_Parachute: move sink rate check to new method 2020-10-06 16:14:59 +11:00
AP_Param AP_Param: allow save_sync without send 2021-04-21 07:12:55 +10:00
AP_PiccoloCAN AP_PiccoloCAN: Update timeout values to use 64-bit calls 2020-10-28 18:25:45 +11:00
AP_Proximity AP_Proximity: remove mavlink boundary clearing conditions 2021-05-02 20:03:56 -04:00
AP_Radio
AP_Rally
AP_RAMTRON
AP_RangeFinder AP_RangeFinder: add get_temp and implement for NMEA driver 2021-04-20 09:17:48 +10:00
AP_RCMapper
AP_RCProtocol AP_RCProtocol: move AP_VideoTX to AP_VideoTX 2021-02-23 11:43:32 +11:00
AP_RCTelemetry AP_RCTelemetry: prioritize pitmode changes over power changes 2021-04-12 16:22:36 +10:00
AP_Relay AP_Relay: Added support to Relay pins on BBBMini 2020-07-06 17:35:27 -07:00
AP_RobotisServo
AP_ROMFS AP_ROMFS: added crc check in ROMFS decompression 2021-02-23 20:20:07 +11:00
AP_RPM AP_RPM: add explicit RPM_TYPE_SITL 2021-03-02 15:41:44 +11:00
AP_RSSI AP_RSSI: handle init ordering with MSP 2020-11-17 10:01:54 +11:00
AP_RTC AP_RTC: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_SBusOut
AP_Scheduler AP_Scheduler: fix example 2021-03-03 18:07:38 +11:00
AP_Scripting AP_Scripting: add do_aux_function binding and example 2021-05-04 09:05:56 +10:00
AP_SerialLED
AP_SerialManager AP_SerialManager: add support for the SmartAudio protocol 2021-02-17 18:23:33 +11:00
AP_ServoRelayEvents
AP_SmartRTL AP_SmartRTL: peek_point method peeks at next point 2021-04-03 12:07:59 +09:00
AP_Soaring AP_Soaring: Ensure minimum cruise times are respected when RC switch position is changed. 2021-04-12 18:38:10 +10:00
AP_SpdHgtControl
AP_Stats AP_Stats: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_TECS AP_TECS: Clarify TECS_THR_DAMP and TECS_LAND_TDAMP descriptions. 2021-03-03 18:05:22 +11:00
AP_TempCalibration AP_TempCalibration: Remove pointer check before delete 2021-02-04 09:01:19 +11:00
AP_TemperatureSensor AP_TemperatureSensor: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_Terrain Ap_Terrain: make AP::terrain return a pointer 2021-04-07 20:56:01 +10:00
AP_ToshibaCAN AP_ToshibaCAN: use new CANIface drivers and CANManager 2020-08-19 17:31:09 +10:00
AP_Tuning AP_Tuning: use AUX_PWM_TRIGGER_LOW and AUX_PWM_TRIGGER_HIGH 2021-02-10 18:48:06 +11:00
AP_UAVCAN AP_UAVCAN: Add ardupilot.gnss.Status 2021-03-12 09:39:55 +11:00
AP_Vehicle AP_Vehicle: fixed SD card slowdown with early mounts 2021-05-01 12:32:23 +10:00
AP_VideoTX AP_VideoTX: increase stack for smart audio thread 2021-04-20 10:39:16 +10:00
AP_VisualOdom AP_VisualOdom: fix T265 criteria for aligning to AHRS 2021-02-10 18:37:45 +11:00
AP_Volz_Protocol AP_Volz_Protocol scaling bugfix 2020-12-08 15:03:26 +11:00
AP_WheelEncoder AP_WheelEncoder: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_Winch AP_Winch: correct Daiwa line lengtha and speed scaling 2020-09-09 11:56:00 +09:00
AP_WindVane AP_Windvane: set true to apparent if no speed sensor 2021-04-28 15:16:35 +10:00
APM_Control APM_Control: G limit all turn rates 2021-05-03 19:22:16 -04:00
AR_WPNav AP_WPNav: read turn G acceleration from Atitude control 2021-05-03 19:22:16 -04:00
doc
Filter Filter: Slewlimiter use different filtering for external reporting 2021-04-15 06:57:16 +10:00
GCS_MAVLink GCS_MAVLink: log auxillary function invocations 2021-04-29 13:00:40 +10:00
PID
RC_Channel RC_Channel: add SCRIPTING aux fun trigger source 2021-05-04 09:05:56 +10:00
SITL SITL: add direct actuated wing to sailboat sim 2021-04-28 08:22:47 +01:00
SRV_Channel SRV_Channel: documenting new SERVOx_FUNCTION values 2021-05-03 19:19:05 -04:00
StorageManager StorageManager: Add missing const in member functions 2021-02-03 18:45:14 +11:00