Ardupilot2/libraries
Andrew Tridgell e5d878eebd AP_GPS: change handling of moving baseline yaw
this changes yaw handling in a few ways:

 - GPS yaw now has a timestamp associated with the yaw separate from
   the timestamp associated with the GPS fix

 - we no longer force the primary to change to the UBLOX MB rover when
   it has a GPS yaw. This means we don't change GPS primary due to GPS
   loss, which keeps the GPS more stable. It also increases accuracy
   as the rover is always less accurate in position and velocity than
   the base

 - now we force the primary to be the MB base if the other GPS is a
   rover and the base has GPS lock
2021-07-21 17:59:49 +10:00
..
AC_AttitudeControl AC_AttitudeControl: AC_PosControl: Auto Terain following update 2021-07-21 16:03:44 +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 @Values from param metadata where @Bitmask exists 2021-06-23 18:37:34 +10:00
AC_Avoidance AC_Avoidance: remove @Values from param metadata where @Bitmask exists 2021-06-23 18:37:34 +10:00
AC_Fence AC_Fence: remove @Values from param metadata where @Bitmask exists 2021-06-23 18:37:34 +10:00
AC_InputManager
AC_PID AC_PID: convert AC_P_2D to double 2021-06-24 21:34:30 +10:00
AC_PrecLand AC_PrecLand: NFC: Refactor EKF code 2021-07-05 15:21:27 +09:00
AC_Sprayer
AC_WPNav AC_WPNav: use get_terrain_margin instead of constant 2021-07-21 16:03:44 +09:00
AP_AccelCal AP_AccelCal: do not add accelcal if no GCS iface available 2021-06-30 17:06:02 +10:00
AP_ADC
AP_ADSB AP_ADSB: remove @Values from param metadata where @Bitmask exists 2021-06-23 18:37:34 +10: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 unused active_accel_instance 2021-07-20 20:37:40 +10:00
AP_Airspeed AP_Airspeed: review updates 2021-07-12 17:14:59 +10:00
AP_Arming AP_Arming: fixed arming checks for no baro 2021-07-08 07:56:51 +10:00
AP_Avoidance AP_Avoidance: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_Baro AP_Baro: fixed SITL with SIM_BARO_COUNT==0 2021-07-08 07:56:51 +10:00
AP_BattMonitor AP_BattMonitor: add Navigator to pins metadata 2021-07-19 12:21:40 -07:00
AP_Beacon AP_Beacon: added const 2020-11-11 16:14:22 -08:00
AP_BLHeli AP_BLHeli: ensure correct rotation through telemetry ESCs 2021-07-21 17:18:12 +10:00
AP_BoardConfig AP_BoardConfig: remove @Values from param metadata where @Bitmask exists 2021-06-23 18:37:34 +10:00
AP_Button AP_Button: log auxillary function invocations 2021-04-29 13:00:40 +10:00
AP_Camera AP_Camera: support RunCam Hybrid correctly 2021-06-09 17:04:27 +10:00
AP_CANManager AP_CANManager: fix casting without ensuring alignment 2021-07-15 07:50:12 +10:00
AP_Common AP_Common: use double precision for more location functions when available 2021-07-14 17:34:40 +10:00
AP_Compass AP_Compass: allow compass cal option for AP_Periph if defined 2021-07-02 08:50:16 +10:00
AP_DAL AP_DAL: move to using tool instead of tools program group 2021-07-07 17:31:09 +10:00
AP_Declination
AP_Devo_Telem
AP_EFI AP_EFI: fix casting without ensuring alignment 2021-07-15 07:50:12 +10:00
AP_ESC_Telem AP_ESC_Telem: add method to get the temperature of the motor with highest temperature 2021-07-06 12:18:21 +10:00
AP_ExternalAHRS AP_ExternalAHRS: remove message when EAHRS_TYPE is None 2021-04-14 14:46:03 +10:00
AP_Filesystem AP_Filesystem: Use HAL_CANMANAGER_ENABLED instead of HAL_ENABLE_LIBUAVCAN_DRIVERS 2021-06-24 09:02:42 +10:00
AP_FlashIface AP_FlashIface: remove any delay from is device busy 2021-06-30 19:33:17 +10:00
AP_FlashStorage Docs: Change all references from dev.ardupilot.org to the appropriate documentation URLs. 2021-05-31 12:20:45 +10:00
AP_Follow
AP_Frsky_Telem AP_Frsky_Telem: added airspeed flag to frame 0x5005 enabled by a new parameter 2021-07-07 11:53:12 +10:00
AP_Generator AP_Generator: Simplify boolean expression 2021-02-23 10:30:05 +11:00
AP_GPS AP_GPS: change handling of moving baseline yaw 2021-07-21 17:59:49 +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: add support for usb passthrough with baud changes 2021-07-21 17:06:41 +10:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: make linecoding objects static arrays 2021-07-21 17:06:41 +10:00
AP_HAL_Empty AP_HAL_Empty: add QSPIDevice empty HAL Iface 2021-06-30 19:33:17 +10:00
AP_HAL_Linux AP_HAL_Linux: add support for hw random number generation 2021-07-07 18:57:25 +10:00
AP_HAL_SITL HAL_SITL: update for changed SITL API 2021-07-14 17:34:40 +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: add note about ICE_STARTCHN_MIN param 2021-05-11 09:12:05 +10:00
AP_InertialNav
AP_InertialSensor AP_InertialSensor: add HAL_INS_ENABLED 2021-06-30 17:06:02 +10:00
AP_InternalError AP_InternalError: specify size for error_t 2021-06-13 08:41:25 +10:00
AP_IOMCU AP_IOMCU: fixed a safety reset case for IOMCU reset 2021-05-25 12:14:01 +10:00
AP_IRLock AP_IRLock: convert SITL backends to double precision position 2021-06-24 21:34:30 +10:00
AP_JSButton
AP_KDECAN AP_KDECAN: Use HAL_CANMANAGER_ENABLED instead of HAL_ENABLE_LIBUAVCAN_DRIVERS 2021-06-24 09:02:42 +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: enable deepstall landing to be compiled out of the code 2021-07-06 12:38:21 +10:00
AP_LandingGear AP_LandingGear: remove @Values from param metadata where @Bitmask exists 2021-06-23 18:37:34 +10:00
AP_LeakDetector AP_LeakDetector: update leak pin for navigator r3 in metadata 2021-07-21 17:04:27 +10:00
AP_Logger AP_Logger: Add Link Quality reporting to RC protocols 2021-07-16 13:27:38 +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: add support for crc8_maxim 2021-07-13 10:01:14 +09:00
AP_Menu
AP_Mission AP_Mission: Cleanup the header to reduce flash cost 2021-06-22 10:08:02 +10:00
AP_Module AP_Module: fix example 2021-03-03 18:07:38 +11:00
AP_Motors AP_Motors: move AP_MotorsUGV to new AR_Motors directory 2021-07-20 10:48:01 +09:00
AP_Mount AP_Mount: use ZERO_FARRAY() 2021-07-10 07:20:41 +10:00
AP_MSP AP_OSD: rename BLH elements to ESC 2021-07-06 12:18:21 +10:00
AP_NavEKF AP_NavEKF: log EKF data source set in XKFS 2021-07-21 16:31:53 +10:00
AP_NavEKF2 AP_NavEKF2: allow for double EKF build 2021-07-10 07:20:41 +10:00
AP_NavEKF3 AP_NavEKF3: fixed indentation in readGpsData() 2021-07-21 17:59:49 +10:00
AP_Navigation AP_Navigation: make crosstrack_error_integrator pure virtual as nobody use the base class 2021-06-11 04:59:06 -07:00
AP_NMEA_Output AP_NMEA: fix example 2021-03-03 18:07:38 +11:00
AP_Notify AP_Notify: disable DShot buzzer by default 2021-07-05 07:36:28 +10:00
AP_OLC AP_OLC: fixed build of OSD on SITL 2020-11-12 14:22:44 -08:00
AP_ONVIF AP_ONVIF: make onvif test empty if ONVIF not enabled 2021-07-07 18:57:25 +10:00
AP_OpticalFlow AP_OpticalFlow: make centideg metadata incr and range consistent 2021-05-25 10:10:18 +10:00
AP_OSD AP_OSD: move OSD_LINK_Q_* to a new param table 2021-07-16 13:27:38 +10:00
AP_Parachute
AP_Param AP_Param: allow save_sync without send 2021-04-21 07:12:55 +10:00
AP_PiccoloCAN AP_PiccoloCAN: fix missing _telem_sem 2021-06-24 17:15:08 +10:00
AP_Proximity AP_Proximity: fix proximity status for upward facing rangefinder 2021-06-16 17:41:45 +09:00
AP_Radio
AP_Rally AP_Rally: omit code that breaks build for herepro 2021-07-02 08:50:16 +10:00
AP_RAMTRON
AP_RangeFinder AP_RangeFinder: Use HAL_CANMANAGER_ENABLED instead of HAL_ENABLE_LIBUAVCAN_DRIVERS 2021-06-24 09:02:42 +10:00
AP_RCMapper fix metadata to emit RCMAP_FORWARD and _LATERAL for Rover 2021-05-17 13:38:17 +10:00
AP_RCProtocol AP_RCProtocol: add Link Quality reporting to RC protocols 2021-07-16 13:27:38 +10:00
AP_RCTelemetry AP_RCTelemetry: fix ELRS systems spamming CRSF mode/rate messages 2021-07-13 09:52:53 +10:00
AP_Relay
AP_RobotisServo AP_RobotisServo: omit code that breaks build for herepro 2021-07-02 08:50:16 +10:00
AP_ROMFS AP_ROMFS: added crc check in ROMFS decompression 2021-02-23 20:20:07 +11:00
AP_RPM AP_RPM: fixed #ifdef HAL_WITH_ESC_TELEM to #if HAL_WITH_ESC_TELEM 2021-07-02 15:35:05 +10:00
AP_RSSI AP_RSSI: add Link Quality reporting to RC protocols 2021-07-16 13:27:38 +10: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: Change the Task Performance Notification Level to Information 2021-06-13 22:47:24 -07:00
AP_Scripting AP_Scripting: add bindings and example for dynamic motor mixer 2021-07-20 09:19:28 +10:00
AP_SerialLED
AP_SerialManager AP_SerialManager: document DisableFIFO bit 2021-07-15 11:31:55 +10: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: Vario filter cleanup and convert in-line filters to LowPassFilter instances 2021-07-02 15:31:27 +10:00
AP_SpdHgtControl AP_SpdHgtControl: added get_max_sinkrate() 2021-06-05 13:05:30 +10:00
AP_Stats AP_Stats: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_TECS AP_TECS: added get_max_sinkrate() API 2021-06-05 13:05:30 +10: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: add setter for terrain-enabled 2021-07-12 17:34:44 +10:00
AP_Torqeedo AP_Torqeedo: simple driver to control torqeedo 1003 motor 2021-07-13 10:01:14 +09:00
AP_ToshibaCAN AP_ToshibaCAN: Use HAL_CANMANAGER_ENABLED instead of HAL_ENABLE_LIBUAVCAN_DRIVERS 2021-06-24 09:02:42 +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 BatteryInfoAux dsdl message 2021-07-08 11:56:06 +10:00
AP_Vehicle AP_Vehicle: explicitly number ModeReason enumeration values 2021-07-17 09:27:38 +10:00
AP_VideoTX AP_SmartAudio: Add pull down VTX option 2021-06-16 18:49:13 +10:00
AP_VisualOdom AP_VisualOdom: do not build on 1MB boards 2021-06-09 20:12:44 +09:00
AP_Volz_Protocol AP_Volz_Protocol: omit code that breaks build for herepro 2021-07-02 08:50:16 +10:00
AP_WheelEncoder AP_WheelEncoder: fixed PID constructor calls 2021-06-08 11:14:52 +10:00
AP_Winch
AP_WindVane AP_WindVane: fixed copying of filter objects 2021-06-08 11:14:52 +10:00
APM_Control APM_Control: adjust fixed wing filter defaults 2021-07-05 20:07:47 +10:00
AR_Motors AP_Motors: move AP_MotorsUGV to new AR_Motors directory 2021-07-20 10:48:01 +09:00
AR_WPNav AR_WPNav: add WP_PIVOT_DELAY parameter 2021-06-16 15:52:43 +09:00
doc
Filter Filter: Add Vector2f option to notch filter 2021-07-06 14:56:02 +10:00
GCS_MAVLink GCS_MAVLink: add support for passthrough with baud changes 2021-07-21 17:06:41 +10:00
PID
RC_Channel RC_Channel: added training mode RC option 2021-07-20 09:00:46 +10:00
SITL SITL: add simulated ms5611 baro 2021-07-14 17:46:15 +10:00
SRV_Channel SRV_Channel: Use HAL_CANMANAGER_ENABLED instead of HAL_ENABLE_LIBUAVCAN_DRIVERS 2021-06-24 09:02:42 +10:00
StorageManager StorageManager: add read_float and write_float 2021-06-06 11:41:30 +10:00