ardupilot/libraries
Thomas Watson ef1c31bd50 AP_NavEKF3: document provenance of yaw fusion equations
Requires digging up old versions of the generator script.

The equations have been rearranged somewhat after generation to choose
the appropriate method but they do match overall. The auto-substitution
of the power functions caused slight changes to the generated syntax so
we make those to the real code as well.

Delete `yaw_generated.cpp` as we know exactly how to generate it now.
2024-10-01 09:28:54 +10:00
..
AC_AttitudeControl AC_AttitudeControl: rate_controller_run_dt() takes dt as last argument 2024-09-26 19:25:33 +10:00
AC_Autorotation
AC_AutoTune AC_Autotune_Multi: Use rate step command 2024-09-26 19:25:33 +10:00
AC_Avoidance AC_Avoidance: re-order initialiser lines so -Werror=reorder will work 2024-09-24 22:50:28 +10:00
AC_CustomControl AC_CustomControl: re-order initialiser lines so -Werror=reorder will work 2024-09-24 22:50:28 +10:00
AC_Fence
AC_InputManager
AC_PID AC_PID: re-order initialiser lines so -Werror=reorder will work 2024-09-24 22:50:28 +10:00
AC_PrecLand AC_PrecLand: remove assumption about how precland update method is called 2024-09-24 10:56:57 +09:00
AC_Sprayer
AC_WPNav AC_WPNav: lower WPNAV_SPEED min to 10 cm/s 2024-08-30 07:55:50 +09:00
AP_AccelCal AP_AccelCal: remove pointless assignment when counting calibrators 2024-01-21 09:53:04 +11:00
AP_ADC AP_ADC: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_ADSB AP_ADSB: re-order initialiser lines so -Werror=reorder will work 2024-09-24 22:50:28 +10:00
AP_AdvancedFailsafe
AP_AHRS AP_AHRS: add option to disable the EKF check for airspeed 2024-09-29 11:06:05 +10:00
AP_Airspeed AP_Airspeed: Don't fail on REG_WHOAMI_RECHECK_ID 2024-09-17 10:36:29 +10:00
AP_AIS
AP_Arming AP_Arming: mark ARMING_RUDDER as Plane,Rover,Copter and Blimp only 2024-09-27 21:51:06 +10:00
AP_Avoidance AP_Avoidance: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Baro AP_Baro: fix example: fixing missing objects 2024-09-29 09:40:37 +10:00
AP_BattMonitor AP_BattMonitor: add and use Battery backend internal-use-only flag 2024-08-08 09:12:08 +10:00
AP_Beacon AP_Beacon: allow hwdefs to override number of beacons 2024-08-26 13:48:02 +10:00
AP_BLHeli
AP_BoardConfig AP_BoardConfig: use GCS_SEND_TEXT rather than gcs().send_text 2024-08-07 18:33:16 +10:00
AP_Button AP_Button: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_Camera AP_Camera: Add capability to set VIDEO_STREAM_INFORMATION from Lua 2024-10-01 08:18:54 +09:00
AP_CANManager AP_CANManager: Integrate methods for converting hexadecimal characters to numbers 2024-09-25 08:48:44 +10:00
AP_CheckFirmware
AP_Common AP_Common: Integrate methods for converting hexadecimal characters to numbers 2024-09-25 08:48:44 +10:00
AP_Compass AP_Compass: re-order initialiser lines so -Werror=reorder will work 2024-09-24 22:50:28 +10:00
AP_CSVReader
AP_CustomRotations AP_CustomRotations: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_DAL AP_DAL: add missing include file for Replay build 2024-09-06 08:52:01 +10:00
AP_DDS AP_DDS: add params for ping timeout and max retries 2024-09-24 22:49:49 +10:00
AP_Declination
AP_Devo_Telem AP_Devo_Telem: tidy AP_SerialManager.h includes 2022-11-08 09:49:19 +11:00
AP_DroneCAN AP_DroneCAN: prevent saturation of CPU with DroneCAN thread 2024-09-27 11:06:20 +10:00
AP_EFI AP_EFI: Hirth: fix sensor health bitmask 2024-09-13 18:52:48 +10:00
AP_ESC_Telem AP_ESC_Telem: tidy old calls to _telem_data 2024-09-11 10:23:00 +10:00
AP_ExternalAHRS AP_ExternalAHRS: re-order initialiser lines so -Werror=reorder will work 2024-09-24 22:50:28 +10:00
AP_ExternalControl AP_ExternalControl: add REP-147 Global Position Control 2023-12-20 02:37:01 +00:00
AP_FETtecOneWire AP_FETtecOneWire: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Filesystem AP_Filesystem: remove dependency on tmpnam 2024-09-24 22:49:18 +10:00
AP_FlashIface
AP_FlashStorage
AP_Follow
AP_Frsky_Telem AP_Frsky_Telem: re-order initialiser lines so -Werror=reorder will work 2024-09-24 22:50:28 +10:00
AP_Generator
AP_GPS AP_GPS: move initialisation of some members into header 2024-09-24 09:30:05 +10:00
AP_Gripper AP_Gripper: correct emitting of grabbed/released messages 2024-06-20 10:59:14 +10:00
AP_GSOF AP_GSOF: Use sparse endian instead of custom code 2024-08-26 13:31:49 +10:00
AP_GyroFFT AP_GyroFFT: move to new constant dt low pass filter class 2024-08-20 09:09:41 +10:00
AP_HAL AP_HAL: re-order initialiser lines so -Werror=reorder will work 2024-09-24 22:50:28 +10:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: CubeRedPrimary: probe external compasses 2024-10-01 09:22:42 +10:00
AP_HAL_Empty
AP_HAL_ESP32 AP_HAL_ESP32: Migration of ESP32 targets from idf 4.4 to 5.3 consisting of: 2024-10-01 09:25:35 +10:00
AP_HAL_Linux AP_HAL_Linux: re-order initialiser lines so -Werror=reorder will work 2024-09-24 22:50:28 +10:00
AP_HAL_QURT AP_HAL_QURT: re-order initialiser lines so -Werror=reorder will work 2024-09-24 22:50:28 +10:00
AP_HAL_SITL
AP_Hott_Telem
AP_IBus_Telem AP_IBus_Telem: Initial implementation 2024-08-07 14:01:44 +10:00
AP_ICEngine AP_ICEngine: fix send_text severities 2024-09-27 16:12:28 +10:00
AP_InertialNav AP_InertialNav: remove use of AP_AHRS from most headers 2024-09-03 10:35:54 +10:00
AP_InertialSensor AP_InertialSensor: re-order initialiser lines so -Werror=reorder will work 2024-09-24 22:50:28 +10:00
AP_InternalError
AP_IOMCU AP_IOMCU: add support for disabled channels 2024-09-04 18:34:10 +10:00
AP_IRLock
AP_JSButton AP_JSButton: add SURFTRAK mode 2024-02-21 18:59:20 -03:00
AP_JSON
AP_KDECAN
AP_L1_Control AP_L1_Control: make reached_loiter_target() more reliable 2024-10-01 07:15:44 +10:00
AP_Landing AP_Landing: restart_landing_sequence get current location and pass it to get_landing_sequence_start 2024-04-02 11:11:59 +11:00
AP_LandingGear AP_LandingGear: use GCS_SEND_TEXT rather than gcs().send_text 2024-08-07 18:33:16 +10:00
AP_LeakDetector AP_LeakDetector: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Logger AP_Logger: add and use global NaNf float value 2024-09-26 19:26:59 +10:00
AP_LTM_Telem AP_LTM_Telem: disable LTM telemetry by default 2024-08-06 09:30:49 +10:00
AP_Math AP_Math: add and use global NaNf float value 2024-09-26 19:26:59 +10:00
AP_Menu AP_Menu: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Mission AP_Mission: Change the IF statement to a SWITCH statement 2024-09-27 21:30:43 +10:00
AP_Module AP_Module: remove use of AP_AHRS from most headers 2024-09-03 10:35:54 +10:00
AP_Motors AP_Motors: Change to pass-through 2024-09-24 22:51:23 +10:00
AP_Mount AP_Mount: use NaN in place of 0 for camera information message 2024-09-26 19:26:59 +10:00
AP_MSP AP_MSP: MSP_RAW_GPS cog should be decidegrees not centidegrees 2024-09-13 12:45:22 +10:00
AP_NavEKF AP_NavEKF: define SourceSetSelection enum class and use it for clarity 2024-09-08 10:02:29 +10:00
AP_NavEKF2 AP_NavEKF2: re-order initialiser lines so -Werror=reorder will work 2024-09-24 22:50:28 +10:00
AP_NavEKF3 AP_NavEKF3: document provenance of yaw fusion equations 2024-10-01 09:28:54 +10:00
AP_Navigation AP_Navigation: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_Networking AP_Networking: add connector loopback test for Ethernet 2024-09-19 11:44:22 +10:00
AP_NMEA_Output
AP_Notify AP_Notify: Fix compilation error in GPIO_LED_1.cpp 2024-08-29 09:37:50 +10:00
AP_OLC
AP_ONVIF
AP_OpenDroneID Copter: Give better error in opendroneid build when DID_ENABLE=0. 2024-09-17 09:17:24 +10:00
AP_OpticalFlow AP_OpticalFlow: simplify condition used for building onboard optical flow in 2024-08-13 10:45:31 +10:00
AP_OSD AP_OSD: don't go via RCMap singleton to get RPTY RC channels 2024-09-17 22:10:53 +10:00
AP_Parachute AP_Parachute: remove AUX_FUNC entries based on feature defines 2024-09-08 00:55:43 +10:00
AP_Param AP_Param: add and use global NaNf float value 2024-09-26 19:26:59 +10:00
AP_PiccoloCAN AP_PiccoloCAN: Remove duplicated code 2024-02-25 10:19:23 +11:00
AP_Proximity AP_Proximity_DroneCAN: fix code stype 2024-09-10 23:36:44 +10:00
AP_Radio
AP_Rally AP_Rally: add ASSERT_STORAGE_SIZE macro 2024-01-22 22:44:05 +11:00
AP_RAMTRON AP_RAMTRON: added PB85RS128C and PB85RS2MC 2023-03-19 17:22:53 +11:00
AP_RangeFinder AP_RangeFinder: Move the flag setting location of has_data 2024-09-29 09:40:20 +10:00
AP_RCMapper AP_RCMapper: exclude body of AP_RCMapper based on AP_RCMAPPER_ENABLED 2024-04-17 18:17:56 +10:00
AP_RCProtocol AP_RCProtocol: re-order initialiser lines so -Werror=reorder will work 2024-09-24 22:50:28 +10:00
AP_RCTelemetry AP_RCTelemetry: re-order initialiser lines so -Werror=reorder will work 2024-09-24 22:50:28 +10:00
AP_Relay
AP_RobotisServo AP_RobotisServo: Send register write values as little-endian 2024-09-27 11:53:06 +10:00
AP_ROMFS
AP_RPM AP_RPM: Allow more instances 2024-08-10 22:37:03 +10:00
AP_RSSI
AP_RTC
AP_SBusOut
AP_Scheduler AP_Scheduler: record and make available the last sample time 2024-09-17 10:12:35 +10:00
AP_Scripting AP_Scripting: Add binding for AP_Camera::set_stream_information() 2024-10-01 08:18:54 +09:00
AP_SerialLED
AP_SerialManager AP_SerialManager: avoid use of AP_HAL.h in config file 2024-09-24 11:59:13 +10:00
AP_ServoRelayEvents
AP_SmartRTL
AP_Soaring AP_Soaring: remove use of AP_AHRS from most headers 2024-09-03 10:35:54 +10:00
AP_Stats
AP_SurfaceDistance AP_SurfaceDistance: re-order initialiser lines so -Werror=reorder will work 2024-09-24 22:50:28 +10:00
AP_TECS
AP_TempCalibration
AP_TemperatureSensor AP_TemperatureSensor: allow AP_TEMPERATURE_SENSOR_DUMMY_METHODS_ENABLED to be overridden 2024-09-22 20:34:33 +10:00
AP_Terrain AP_Terrain: create and use AP_Terrain_config.h 2024-09-24 11:59:13 +10:00
AP_Torqeedo
AP_Tuning AP_Tuning: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Vehicle AP_Vehicle: add support for set_target_rate_and_throttle 2024-09-25 08:47:30 +10:00
AP_VideoTX AP_VideoTX:add additional freq bands(RushFPV 3.3GHz) 2024-08-13 21:32:56 +10:00
AP_VisualOdom
AP_Volz_Protocol
AP_WheelEncoder AP_WheelEncoder: correct initialisation of WheelRateController objects 2024-09-24 10:46:34 +09:00
AP_Winch AP_Winch: correct compilation when backends compiled out 2024-08-12 18:28:27 +10:00
AP_WindVane
APM_Control APM_Control: add missing include for AP::ins() 2024-09-06 08:52:01 +10:00
AR_Motors AR_Motors: use GCS_SEND_TEXT rather than gcs().send_text 2024-08-07 18:33:16 +10:00
AR_WPNav AR_WPNav: re-order initialiser lines so -Werror=reorder will work 2024-09-24 22:50:28 +10:00
doc
Filter Filter: only update notch on init if fixed 2024-09-09 09:29:32 +10:00
GCS_MAVLink GCS_MAVLink: Add handler for VIDEO_STREAM_INFORMATION request 2024-10-01 08:18:54 +09:00
PID PID: use new defualt pattern 2023-01-24 10:16:56 +11:00
RC_Channel RC_Channel: add accessor for channel number 2024-09-25 08:46:55 +10:00
SITL SITL: Change division to multiplication 2024-09-28 11:01:41 +10:00
SRV_Channel SRV_Channel: added lift_release 2024-09-10 10:15:34 +10:00
StorageManager
COLCON_IGNORE