Ardupilot2/libraries
Andrew Tridgell 6f04fae4a0 AP_NavEKF3: added fallback to mag option with external yaw
this allows for a magnetometer to be used as a fallback yaw source in
flight when using an external yaw source such as a GPS. The
magnetometer bias is learned while the GPS yaw is available and
fallback is only done if the mag yaw and GPS yaw are consistent when
fallback is enabled

This also learns the Z gyro bias until first yaw alignment when
MAG_CAL is EXTERNAL_YAW_FALLBACK. This prevents large gyro bias
building while waiting for GPS lock
2020-04-11 21:14:31 +10:00
..
AC_AttitudeControl AC_PosControl: add documentation for PSC log message 2020-04-06 10:46:45 +10:00
AC_Autorotation AC_Autorotation: convert to new get_rpm() API 2020-03-12 08:36:40 +11:00
AC_AutoTune AC_AutoTune: Logger documentation TimeUS fix 2020-04-07 18:57:01 +10:00
AC_Avoidance AC_Avoidance: keep track of velocity liminting status 2020-02-04 10:24:33 +09:00
AC_Fence AC_Fence: add the description of FENCE_ACTION in Rover 2020-02-05 14:58:56 +09: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: make configurable in hwdef.dat 2020-01-18 13:48:48 +11:00
AC_WPNav AC_WPNav: add shift_wp_origin_to_current_pos_xy 2020-03-11 10:39:18 +09:00
AP_AccelCal AP_AccelCal: adjust for new vehicle base class 2019-10-08 11:26:04 +11:00
AP_ADC AP_ADC: remove keywords.txt 2019-02-17 22:19:08 +11:00
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: add get_quaternion 2020-04-09 19:41:08 +09:00
AP_Airspeed AP_Airspeed: expose get_corrected_pressure() 2020-03-25 20:37:00 +11:00
AP_Arming AP_Arming: integrate visual odometry pre_arm_check 2020-04-09 19:41:08 +09:00
AP_Avoidance AP_Avoidance: make all semaphores recursive 2020-01-19 20:19:30 +11:00
AP_Baro AP_Baro: make all semaphores recursive 2020-01-19 20:19:30 +11:00
AP_BattMonitor AP_Battery: fixed bug in SUI driver 2020-04-10 11:46:01 +10:00
AP_Beacon AP_Beacon: pozyx: remove dead and pointless code 2020-04-01 15:42:47 +09:00
AP_BLHeli AP_BlHeli: always report test results and report band channel once 2020-02-04 10:38:20 +11:00
AP_BoardConfig AP_BoardConfig: run validation test if declared under hwdef 2020-04-10 07:04:21 +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: add RunCam device type 2 documentation 2020-04-06 20:27:32 +10:00
AP_Common AP_Common: use standard realloc method from HAL 2020-03-24 10:32:14 +11:00
AP_Compass AP_Compass: change RM3100 device ID 2020-04-08 11:21:51 +10:00
AP_Declination AP_Declination: re-generate mag tables 2019-12-24 11:33:10 +11:00
AP_Devo_Telem AP_Devo_Telem: add floating point constant designators 2019-04-05 23:04:17 -07:00
AP_EFI AP_EFI: correct duplicate-label problem in EFI2 log message 2020-04-08 11:17:41 +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: use @ROMFS 2020-03-28 15:28:03 +11:00
AP_FlashStorage AP_FlashStorage: implement erase() method 2020-01-02 09:52:57 +11:00
AP_Follow AP_Follow: minor format fix to FOLL_ALT_TYPE param desc 2020-02-17 14:30:18 +09:00
AP_Frsky_Telem AP_Frsky_Telem: fix for protocol=4 GAlt=0 and GSPd=0 2020-03-31 13:09:35 +11:00
AP_GPS AP_GPS: fixed AP_Periph build with gcc 9.x 2020-04-01 17:08:48 +11:00
AP_Gripper AP_Gripper: use https:// scheme for ardupilot URLs 2019-12-10 07:53:46 +11:00
AP_GyroFFT AP_GyroFFT: inline used-only-once Log_Write parameters 2020-03-22 18:35:14 +11:00
AP_HAL AP_HAL: send statustext at regular intervals after watchdog reset 2020-03-31 14:30:11 +11:00
AP_HAL_ChibiOS hwdef: add validation checks for CubeOrange 2020-04-10 07:04:21 +10:00
AP_HAL_Empty AP_HAL_Empty: empty implementation of HAL FFT 2020-02-22 11:15:37 +11:00
AP_HAL_Linux AP_HAL_Linux: do not create ConsoleDevices for Replay or examples 2020-03-31 11:22:21 +11:00
AP_HAL_SITL HAL_SITL: fixed simulation of roll/pitch of moving baseline ublox 2020-04-11 21:14:31 +10:00
AP_Hott_Telem AP_Hott_Telem: correct GPS fix character 2020-04-01 19:24:58 +11: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: suppress expected errors from invensense IMUs 2020-03-11 16:30:06 +11:00
AP_InternalError AP_InternalError: added hex and decimal comments 2019-12-09 12:43:39 +11:00
AP_IOMCU AP_IOMCU: use more efficient read API for rcin 2020-01-31 11:09:07 +11:00
AP_IRLock AP_IRLock: removed unusued AP_Common/Semaphore.h 2019-05-15 15:33:48 +10:00
AP_JSButton AP_JSButton: Add servo toggle button function 2017-12-28 14:14:47 -05:00
AP_KDECAN AP_KDECAN: fixed build error on Linux 2019-12-31 11:38:30 +11: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 AP_Landing_Deepstall: correct missing parameter docs 2020-02-18 13:28:03 +11:00
AP_LandingGear AP_LandingGear: add OPTIONS param to auto deploy and retract 2020-02-26 08:01:00 +09:00
AP_LeakDetector AP_LeakDetector: Mark Leak pins RebootRequired 2019-09-09 09:53:28 -07:00
AP_Logger AP_Logger: add log message description for VISO 2020-04-09 19:41:08 +09:00
AP_LTM_Telem AP_LTM_Telem: LTM telemetry support 2019-11-26 12:14:13 +11:00
AP_Math AP_Math: alternative quaternion rotation test 2020-04-09 19:41:08 +09:00
AP_Menu AP_Menu: use strtof() instead of atof() 2019-10-28 15:53:16 +11:00
AP_Mission AP_Mission: Added immediate trigger for DO_SET_CAM_TRIGG_DIST 2020-03-31 10:05:40 +11:00
AP_Module AP_Module: update example baro include 2019-06-27 14:56:21 +10:00
AP_Motors AP_Motors: MotorsMulticopter fix floating boost output 2020-03-02 18:22:30 +09:00
AP_Mount AP_Mount: ignore rc trim when calculating desired mount angles 2020-02-25 17:38:24 +09:00
AP_NavEKF AP_NavEKF:Logger documentation TimeUS fix 2020-04-07 18:57:01 +10:00
AP_NavEKF2 AP_NavEKF2: make mag variance reporting consistent 2020-04-06 17:30:29 +10:00
AP_NavEKF3 AP_NavEKF3: added fallback to mag option with external yaw 2020-04-11 21:14:31 +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: 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: add orient-yaw parameter units 2020-02-03 19:35:40 +09:00
AP_OSD AP_OSD: avoid build when OSD disabled 2020-03-28 15:28:03 +11:00
AP_Parachute AP_Parachute: default to parachute enabled 2020-01-18 13:48:48 +11:00
AP_Param AP_Param: use smaller param area for all 1M flash boards 2020-03-28 15:28:03 +11:00
AP_PiccoloCAN AP_PiccoloCAN: fixed build error on Linux 2019-12-31 11:38:30 +11:00
AP_Proximity AP_Proximity: TeraRangerTower uses intermediate serial class 2020-02-19 11:12:37 +09:00
AP_Radio AP_Radio: correct for recent semaphore bool/void changes 2020-03-03 21:56:33 +09: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: fixed build with gcc 9.x 2020-04-01 17:08:48 +11:00
AP_RangeFinder AP_RangeFinder: comment out no-loner-used PX4 enum entry 2020-02-12 21:18:47 +11:00
AP_RCMapper AP_RCMapper: add singleton 2019-12-30 13:02:04 +11:00
AP_RCProtocol AP_RCProtocol: added logging of RC prototol input bytes 2020-03-24 09:10:36 +09:00
AP_Relay AP_Relay: change parameter name from relay to instance 2019-09-27 12:02:38 +10:00
AP_RobotisServo AP_RobotisServo: fix includes place and order 2019-03-26 10:27:54 +11:00
AP_ROMFS AP_ROMFS: added directory listing interface 2020-03-28 15:28:03 +11:00
AP_RPM AP_RPM: changed get_rpm() API to be scripting compatible 2020-03-12 08:36:40 +11:00
AP_RSSI AP_RSSI: Fix duplicate values in ANA_PIN 2020-03-24 10:26:04 +11:00
AP_RTC AP_RTC: make all semaphores recursive 2020-01-19 20:19:30 +11:00
AP_SBusOut AP_SBusOut: fix includes place and order 2019-03-26 10:27:54 +11:00
AP_Scheduler AP_Scheduler: allow registration of tasks at loop rate 2020-02-22 11:15:37 +11:00
AP_Scripting AP_Scripting: Cleanups to remove false posive warnings 2020-03-28 21:16:09 +11: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 log documentation. 2020-04-08 09:11:54 +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: Avoid update() IO operations when not enabled 2020-01-26 10:35:29 +11:00
AP_ToshibaCAN AP_ToshibaCAN: fix unused variable error 2020-04-01 17:10:36 +11:00
AP_Tuning AP_Tuning: avoid name collision with Copter's PTUN message 2020-03-22 18:35:14 +11:00
AP_UAVCAN AP_UAVCAN: make all semaphores recursive 2020-01-19 20:19:30 +11:00
AP_Vehicle AP_Vehicle: add visual odometry 2020-04-09 19:41:08 +09:00
AP_VisualOdom AP_VisualOdom: align sensor displays yaw shift in 0 to 360 range 2020-04-09 19:41:08 +09:00
AP_Volz_Protocol AP_Volz_Protocol: fixed build warnings 2018-10-17 12:54:22 +11:00
AP_WheelEncoder AP_WheelEncoder: add param docs for new PID filter parameters 2020-02-19 15:09:16 +11: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 Copter: port betaflight in-flight fft analysis to arducopter and expose as a log message 2020-02-22 11:15:37 +11:00
GCS_MAVLink GCS_MAVLink: visual odometry build fixes 2020-04-09 19:41:08 +09:00
PID Global: rename desired to target in PID info 2019-07-25 17:38:15 +09:00
RC_Channel RC_Channel: add aux function for visodom-calibrate 2020-04-09 19:41:08 +09:00
SITL SITL: added SIM_GPS2_HDG and rationalise the GPS position variables 2020-04-11 21:14:31 +10:00
SRV_Channel SRV_Channels: fix unannotated fall-through between switch labels 2020-04-01 17:10:36 +11:00
StorageManager StorageManager: use pragmas to set storage layout rather than call 2020-01-28 11:34:51 +11:00