ardupilot/libraries
Andrew Tridgell 529bfe8fcd AP_GPS: fixed issue with GPS selection for moving baseline
when you have a moving baseline pair of ublox GPS modules and the
rover GPS does not have full fixed RTK lock on the base GPS then we
should not use it as our primary GPS as it's position and velocity can
be badly affected by the attempts of the GPS to gain a fixed lock.

This was observed in a flight with two F9P GPS, where the GPS velocity
data from the rover GPS went way off when it lost full RTK lock. It's
status stayed at 4, so it was selected as the primary GPS
2020-05-27 10:59:46 +10:00
..
AC_AttitudeControl AC_AttitudeControl: remove unused macro 2020-04-27 09:39:46 +09:00
AC_Autorotation AC_Autorotation: convert to new get_rpm() API 2020-03-12 08:36:40 +11:00
AC_AutoTune AC_AutoTune: add ATDE log message documentation 2020-04-12 08:36:48 +10:00
AC_Avoidance AC_Avoidance: rename APMrover2 to Rover 2020-04-14 09:50:34 +09:00
AC_Fence AC_Fence: create and use INTERNAL_ERROR macro so we get line numbers 2020-04-30 13:21:36 +10:00
AC_InputManager AC_InputManager: tradheli-Fix parameter metadata errors 2020-01-13 12:41:30 -05:00
AC_PID AC_PID: added AC_PI controller 2019-11-02 16:31:04 +11:00
AC_PrecLand AC_PrecLand: POS param range of 5m and 1cm increment 2020-02-01 08:46:03 +09:00
AC_Sprayer AC_Sprayer: Change the tab code to whitespace 2020-04-27 09:28:51 +09:00
AC_WPNav AC_Circle: add is_active 2020-04-27 09:39:46 +09:00
AP_AccelCal AP_AccelCal: adjust for new vehicle base class 2019-10-08 11:26:04 +11:00
AP_ADC
AP_ADSB AP_ADSB: add missing break statement 2020-01-15 13:55:42 +11:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: correct WP_GPS_LOSS param documentation block 2020-02-19 15:09:16 +11:00
AP_AHRS AP_AHRS: writeBodyFrameOdom accepts delay 2020-05-15 10:07:52 +09:00
AP_Airspeed AP_Airspeed: Rearrange state to save memory 2020-05-06 18:15:08 +10:00
AP_Arming AP_Arming: allow FFT to report failure reason. allow FFT check to be disabled. 2020-05-24 07:43:34 +10:00
AP_Avoidance AP_Avoidance: make all semaphores recursive 2020-01-19 20:19:30 +11:00
AP_Baro AP-Baro: fix init without baro 2020-05-26 10:04:22 +10:00
AP_BattMonitor AP_BattMonitor: NeoDesign battery driver 2020-04-28 10:39:57 +10:00
AP_Beacon AP_Beacon: Change the tab code to whitespace 2020-04-27 09:32:56 +09:00
AP_BLHeli AP_BLHeli: read more efficiently from telemetry UART 2020-05-26 15:59:11 +10:00
AP_BoardConfig AP_BoardConfig: invalidate param count when changing param tree structure 2020-04-29 07:36:55 +10:00
AP_Button AP_Button: add crude debouncing and get_button_state function 2020-03-19 14:59:34 -07:00
AP_Camera AP_Camera: use new UARTDriver discard_input method 2020-05-26 09:20:32 +10:00
AP_Common AP_Common: create and use INTERNAL_ERROR macro so we get line numbers 2020-04-30 13:21:36 +10:00
AP_Compass AP_Compass: revert change to RM3100 scale factor and increase scale limit 2020-05-24 15:06:15 +10:00
AP_Declination AP_Declination: re-generate mag tables 2019-12-24 11:33:10 +11:00
AP_Devo_Telem
AP_EFI AP_EFI: use new UARTDriver discard_input method 2020-05-26 09:20:32 +10:00
AP_ESC_Telem AP_ESC_Telem: wrapper for ESCs with feedback 2020-02-12 11:58:34 +09:00
AP_Filesystem AP_Filesystem: correct comparison of signed/unsigned 2020-05-04 12:06:30 +10:00
AP_FlashStorage AP_FlashStorage: create and use INTERNAL_ERROR macro so we get line numbers 2020-04-30 13:21:36 +10:00
AP_Follow AP_Follow: rename APMrover2 to Rover 2020-04-14 09:50:34 +09:00
AP_Frsky_Telem AP_Frsky_Telem: removed time constraint to allow SITL regression testing 2020-05-26 10:02:12 +10:00
AP_GPS AP_GPS: fixed issue with GPS selection for moving baseline 2020-05-27 10:59:46 +10:00
AP_Gripper AP_Gripper: Change the tab code to whitespace 2020-04-27 09:29:02 +09:00
AP_GyroFFT AP_GyroFFT: filter energy, harmonic and amplitude fit. Make a better guess at harmonic matching 2020-05-24 07:43:34 +10:00
AP_HAL AP_HAL: BetterStream add a read(uint8_t*buffer, uint16_t count method 2020-05-26 15:59:11 +10:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: override read(buffer,count) method to be more efficient 2020-05-26 15:59:11 +10:00
AP_HAL_Empty AP_HAL_Empty: add discard_input method on UARTDriver 2020-05-26 09:20:32 +10:00
AP_HAL_Linux AP_HAL_Linux: add discard_input method on UARTDriver 2020-05-26 09:20:32 +10:00
AP_HAL_SITL AP_HAL_SITL: add discard_input method on UARTDriver 2020-05-26 09:20:32 +10:00
AP_Hott_Telem AP_Hott_Telem: use new UARTDriver discard_input method 2020-05-26 09:20:32 +10:00
AP_ICEngine AP_ICEngine: convert to new get_rpm() API 2020-03-12 08:36:40 +11:00
AP_InertialNav AP_InertialNav: use ekf::get_vert_pos_rate during high vibration 2019-10-18 11:15:25 +09:00
AP_InertialSensor AP_InertialSensor: FFT gyro window would overflow on windows >= 256 2020-05-24 07:43:34 +10:00
AP_InternalError AP_InternalError: add warning on the internal error_t type 2020-05-06 13:23:15 +10:00
AP_IOMCU AP_IOMCU: use new UARTDriver discard_input method 2020-05-26 09:20:32 +10:00
AP_IRLock AP_IRLock: Change the tab code to whitespace 2020-04-27 09:29:11 +09:00
AP_JSButton
AP_KDECAN AP_KDECAN: regularise CAN pre-arm failure messages 2020-05-05 11:27:53 +10:00
AP_L1_Control AP_L1_Control: wrap_180_cd no longer solely returns floats 2019-09-18 12:57:02 +10:00
AP_Landing ArduPlane: option to keep landing throttle at thr_min during flare and touchdown, not zero. 2020-05-20 11:29:45 +10:00
AP_LandingGear AP_LandingGear: Change the tab code to whitespace 2020-04-27 09:29:18 +09:00
AP_LeakDetector AP_LeakDetector: Mark Leak pins RebootRequired 2019-09-09 09:53:28 -07:00
AP_Logger AP_Logger: Added units to CurrTot message 2020-05-26 16:19:14 +10:00
AP_LTM_Telem AP_LTM_Telem: LTM telemetry support 2019-11-26 12:14:13 +11:00
AP_Math AP_Math: disable INEXACT flag from Float exception 2020-05-17 16:12:43 +10:00
AP_Menu AP_Menu: use strtof() instead of atof() 2019-10-28 15:53:16 +11:00
AP_Mission AP_Scripting: allow to get/set/create arbitrary mission items 2020-05-12 09:58:14 +10:00
AP_Module AP_Module: update example baro include 2019-06-27 14:56:21 +10:00
AP_Motors AP_Motors: Support autorotation windows on external governors 2020-05-20 21:56:09 -04:00
AP_Mount AP_Mount: use logger Write method for logging Solo gimbal 2020-04-28 09:56:09 +10:00
AP_NavEKF AP_NavEKF: GSF white space fixes 2020-04-24 09:43:23 +10:00
AP_NavEKF2 AP_NavEKF2: clarify yaw reset error message 2020-05-26 10:05:35 +10:00
AP_NavEKF3 AP_NavEKF3: clarify yaw reset error message 2020-05-26 10:05:35 +10:00
AP_Navigation
AP_NMEA_Output AP_NMEA_Output: EKF objects have moved into AP_AHRS_NavEKF 2020-01-21 11:53:18 +11:00
AP_Notify AP_Notify: remove recursive call to play in next_action 2020-03-31 11:06:30 +11:00
AP_OpticalFlow AP_OpticalFlow: Change the tab code to whitespace 2020-04-27 09:29:39 +09:00
AP_OSD AP_OSD: avoid build when OSD disabled 2020-03-28 15:28:03 +11:00
AP_Parachute AP_Parachute: Fix singleton panic message 2020-05-05 07:43:02 +10:00
AP_Param AP_Param: fixed race in param count handling 2020-04-29 07:36:55 +10:00
AP_PiccoloCAN AP_PiccoloCAN: regularise CAN pre-arm failure messages 2020-05-05 11:27:53 +10:00
AP_Proximity AP_Proximity: AirSimSITL: fix left right swap 2020-04-28 09:37:59 +10:00
AP_Radio AP_Radio: correct for recent semaphore bool/void changes 2020-03-03 21:56:33 +09:00
AP_Rally AP_Rally: rename APMrover2 to Rover 2020-04-14 09:50:34 +09:00
AP_RAMTRON AP_RAMTRON: fixed build with gcc 9.x 2020-04-01 17:08:48 +11:00
AP_RangeFinder AP_RangeFinder: remove move-to-error-state for LeddarOne driver 2020-05-26 09:20:32 +10:00
AP_RCMapper AP_RCMapper: add singleton 2019-12-30 13:02:04 +11:00
AP_RCProtocol AP_RCProtocol: scale SRXL2 using published conversion values. switch SRXL2 channels to match ArduPilot 2020-05-24 07:45:01 +10:00
AP_RCTelemetry AP_RCTelemetry: Spektrum telemetry library and telemetry abstraction 2020-05-05 09:23:15 +10:00
AP_Relay AP_Relay: change parameter name from relay to instance 2019-09-27 12:02:38 +10:00
AP_RobotisServo
AP_ROMFS AP_ROMFS: added directory listing interface 2020-03-28 15:28:03 +11:00
AP_RPM AP_RPM: allow harmonic notch driver to appear as RPM values. 2020-04-14 09:43:16 +10:00
AP_RSSI AP_RSSI: Fix duplicate values in ANA_PIN 2020-03-24 10:26:04 +11:00
AP_RTC AP_RTC: use GCS_SEND_TEXT() 2020-04-29 07:36:55 +10:00
AP_SBusOut
AP_Scheduler AP_Scheduler: allow registration of tasks at loop rate 2020-02-22 11:15:37 +11:00
AP_Scripting AP_Scripting: Add servo chan override w/ timeout 2020-05-25 14:10:01 +10:00
AP_SerialLED AP_SerialLED: support ProfiLEDs 2020-03-10 10:37:26 +11:00
AP_SerialManager AP_SerialManager: Add a description 2020-02-26 12:18:40 +11:00
AP_ServoRelayEvents AP_ServoRelayEvents: do-set-servo affects sprayer and gripper 2020-02-11 11:08:02 +11:00
AP_SmartRTL AP_SmartRTL: EKF objects have moved into AP_AHRS_NavEKF 2020-01-21 11:53:18 +11:00
AP_Soaring AP_Soaring: add documentation for VAR dataflash log message 2020-05-06 13:23:51 +10:00
AP_SpdHgtControl AP_TECS: Add flags to indicate gliding flight, and use these with AP_Soaring. 2020-04-08 09:11:54 +10:00
AP_Stats AP_Stats: make all semaphores recursive 2020-01-19 20:19:30 +11:00
AP_TECS AP_TECS: Update descriptions of pitch feed-forward parameters. 2020-04-08 09:11:54 +10:00
AP_TempCalibration AP_TempCalibration: Include needed AP_Baro.h 2019-06-27 14:56:21 +10:00
AP_TemperatureSensor AP_TemperatureSensor: fix TSYS01 warning on SITL 2020-02-05 17:10:58 -05:00
AP_Terrain AP_Terrain: added script for creating terrain *.dat files 2020-05-05 11:21:33 +10:00
AP_ToshibaCAN AP_ToshibaCAN: Using the maximum number of ESCs definition 2020-04-20 10:12:57 +09:00
AP_Tuning AP_Tuning: add documentation for PRTN message 2020-04-14 07:34:59 +10:00
AP_UAVCAN AP_UAVCAN: use new UARTDriver discard_input method 2020-05-26 09:20:32 +10:00
AP_Vehicle AP_Vehicle: separate gyrofft gyro sampling from fft initiation 2020-05-24 07:43:34 +10:00
AP_VisualOdom AP_VisualOdom: provide delay to ahrs:writeBodyFrameOdom 2020-05-15 10:07:52 +09:00
AP_Volz_Protocol
AP_WheelEncoder AP_WheelEncoder: Change the tab code to whitespace 2020-04-27 09:32:15 +09:00
AP_Winch AP_Winch: use enum-class for SRV_CHANNEL_LIMIT_TRIM and friends 2019-11-26 10:17:17 +11:00
AP_WindVane AP_WindVane: Fix duplicate values in Param 2020-03-24 10:26:04 +11:00
APM_Control APM_Control: validate parameter ARSPD_FBW_MIN 2020-04-02 19:43:06 -07:00
AR_WPNav AR_WPNav: remove unneeded overshoot methods 2019-10-23 08:28:39 +08:00
doc
Filter Filter: use GCS_SEND_TEXT() 2020-04-29 07:36:55 +10:00
GCS_MAVLink GCS_MAVLink: fixed a ftp duplicate reply 2020-05-14 09:53:42 +10:00
PID Global: rename desired to target in PID info 2019-07-25 17:38:15 +09:00
RC_Channel RC_Channel: add Qassist switch 2020-05-26 09:01:47 +10:00
SITL SITL: add support for simulated proximity sensors 2020-05-22 17:06:16 +10:00
SRV_Channel SRV_Channel: Add servo chan override w/ timeout 2020-05-25 14:10:01 +10:00
StorageManager StorageManager: use pragmas to set storage layout rather than call 2020-01-28 11:34:51 +11:00