ardupilot/libraries
Peter Barker c8a20726ff AP_NavEKF3: do not store prediction-enabled as state
this is only used in one place, and that place is called from the same routine setting the persistent state.  The only other place which calls readIMUData shouldn't be running the prediction step, but mmay, depending on the previous setting of the prediction step.

We are not initialising this state on filter reset, so it's possible that the state will be set when we do an InitialiseFilterBootstrap, which is probably not desired
2024-07-09 10:45:03 +10:00
..
AC_AttitudeControl AC_AttitudeControl: add accessors to set rate limit 2024-07-01 22:57:55 -04:00
AC_Autorotation AC_Autorotation: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AC_AutoTune AC_AutoTune: remove unused variables 2024-07-04 13:19:12 +10:00
AC_Avoidance AC_Avoidance: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AC_CustomControl AC_CustomControl: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AC_Fence AC_Fence: warn on use of old fence point / rally point protocols 2024-06-11 09:39:56 +10:00
AC_InputManager
AC_PID AC_PID: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AC_PrecLand AC_PrecLand: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AC_Sprayer AC_Sprayer: create and use an AP_Sprayer_config.h 2024-07-05 14:27:45 +10:00
AC_WPNav AC_WPNav: remove un-needed initialisation 2024-05-21 15:52:51 +10: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: cache course-over-ground for GPS message 2024-06-19 10:14:50 +10:00
AP_AdvancedFailsafe
AP_AHRS AP_AHRS: rename ins get_primary_accel to get_first_usable_accel 2024-06-26 17:12:12 +10:00
AP_Airspeed AP_Airspeed: make metadata more consistent 2024-07-02 11:34:29 +10:00
AP_AIS AP_AIS: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Arming AP_Arming: tidy pre_arm_checks 2024-07-02 09:56:40 +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: Group device headers 2024-06-20 15:13:01 +10:00
AP_BattMonitor AP_BattMonitor: make metadata more consistent 2024-07-02 11:34:29 +10:00
AP_Beacon AP_Beacon: use enum class for type 2024-06-24 18:24:11 +10:00
AP_BLHeli AP_BLHeli:expand metadata of 3d and Reverse masks 2024-06-04 09:24:41 +10:00
AP_BoardConfig AP_BoardConfig: update RTSCTS param values for new option 2024-05-28 09:48:19 +10:00
AP_Button
AP_Camera AP_Camera: move switch for sending camera messages into AP_Camera 2024-06-05 10:29:01 +10:00
AP_CANManager AP_CANManager: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_CheckFirmware AP_CheckFirmware: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Common AP_Common: char_to_hex returns 0 on invalid char 2024-07-09 09:08:51 +10:00
AP_Compass AP_Compass: warn user if fix_radius() is skipped 2024-07-09 10:13:34 +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: make AP_RANGEFINDER_ENABLED remove more code 2024-07-02 09:17:26 +10:00
AP_DDS AP_DDS: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Declination
AP_Devo_Telem
AP_DroneCAN AP_DroneCAN: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_EFI AP_EFI: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_ESC_Telem AP_ESC_Telem: add get_max_rpm_esc() 2024-06-26 17:36:54 +10:00
AP_ExternalAHRS AP_ExternalAHRS: VectorNav: Add support for sensors outside VN-100 and VN-300 2024-07-05 21:41:22 +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: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_FlashIface
AP_FlashStorage
AP_Follow AP_Follow: factor out separate methods for handling mavlink messages 2024-06-11 16:20:20 +10:00
AP_Frsky_Telem AP_Frsky_Telem: avoid use if int16-t read call 2024-07-02 10:14:28 +10:00
AP_Generator AP_Generator: avoid use of int16_t-read 2024-07-02 10:13:24 +10:00
AP_GPS AP_GPS: don't consider uBlox PVT time correct unless we have 2D fix 2024-07-02 10:25:03 +10:00
AP_Gripper AP_Gripper: correct emitting of grabbed/released messages 2024-06-20 10:59:14 +10:00
AP_GyroFFT AP_GyroFFT: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_HAL AP_HAL: add methods that deal in ip address as uint32_t 2024-06-21 20:31:31 +10:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: chibios_hwdef.py: correct flake8 issues 2024-07-09 10:13:00 +10:00
AP_HAL_Empty HAL_Empty: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_HAL_ESP32 AP_HAL_ESP32: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_HAL_Linux AP_HAL_Linux: remove unused includes 2024-06-17 09:51:38 +10:00
AP_HAL_SITL AP_HAL: Add support for parity to Serial passthrough 2024-06-11 09:24:32 +10:00
AP_Hott_Telem AP_Hott_Telem: add and use AP_BATTERY_ENABLED 2024-02-06 11:01:02 +11:00
AP_ICEngine AP_ICEngine: correct compilation when ICEngine disabled 2024-02-20 09:16:23 +11:00
AP_InertialNav
AP_InertialSensor AP_InertialSensor: move gyro and accel instance ids into AP_InertialSensor_Backend 2024-06-26 17:14:56 +10:00
AP_InternalError AP_InternalError: fix signedness issue with snprintf 2024-05-22 23:22:23 +10:00
AP_IOMCU AP_IOMCU: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_IRLock AP_IRLock: use SocketAPM_native 2024-01-03 12:14:47 +11:00
AP_JSButton AP_JSButton: add SURFTRAK mode 2024-02-21 18:59:20 -03:00
AP_JSON AP_JSON: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_KDECAN AP_KDECAN: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_L1_Control AP_L1_Control: make AHRS attitude member variables private 2024-01-14 12:47:47 +11: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: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_LeakDetector AP_LeakDetector: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Logger AP_Logger: remove twin paths for writing FMT messages 2024-07-09 10:40:08 +10:00
AP_LTM_Telem AP_LTM_Telem: add and use AP_BATTERY_ENABLED 2024-02-06 11:01:02 +11:00
AP_Math AP_Math: Created CentiDegreesToRadians 2024-06-20 09:12:50 +10:00
AP_Menu AP_Menu: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Mission Mission: add is_resume method 2024-06-19 17:12:17 +10:00
AP_Module AP_Module: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Motors AP_Motors: Clean up spacing 2024-07-02 08:39:33 +09:00
AP_Mount AP_Mount: integrate topotek gimbal driver 2024-07-09 09:08:51 +10:00
AP_MSP AP_MSP: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_NavEKF AP_NavEKF: make AP_RANGEFINDER_ENABLED remove more code 2024-07-02 09:17:26 +10:00
AP_NavEKF2 AP_NavEKF2: make AP_RANGEFINDER_ENABLED remove more code 2024-07-02 09:17:26 +10:00
AP_NavEKF3 AP_NavEKF3: do not store prediction-enabled as state 2024-07-09 10:45:03 +10:00
AP_Navigation
AP_Networking AP_Networking: added TCP reflection test 2024-06-27 10:11:14 +10:00
AP_NMEA_Output AP_NMEA_Output: stop passing serial manager to GPS init 2024-03-19 07:28:55 +11:00
AP_Notify AP_Notify: flash green lights based off location not GPS 2024-06-26 18:39:43 +10:00
AP_OLC
AP_ONVIF AP_ONVIF: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_OpenDroneID AP_OpenDroneID: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_OpticalFlow AP_OpticalFlow: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_OSD AP_OSD: make AP_RANGEFINDER_ENABLED remove more code 2024-07-02 09:17:26 +10:00
AP_Parachute AP_Parachute: optional (CHUTE_OPTIONS:1) disarm defore parachute release 2024-04-10 21:55:51 +10:00
AP_Param AP_Param: added get_eeprom_full() 2024-06-18 10:29:55 +10:00
AP_PiccoloCAN AP_PiccoloCAN: Remove duplicated code 2024-02-25 10:19:23 +11:00
AP_Proximity AP_Proximity: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Radio AP_Radio: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Rally AP_Rally: add ASSERT_STORAGE_SIZE macro 2024-01-22 22:44:05 +11:00
AP_RAMTRON
AP_RangeFinder AP_RangeFinder: make metadata more consistent 2024-07-02 11:34:29 +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: remove redundant check for crsf telem on iomcu 2024-06-26 18:13:01 +10:00
AP_RCTelemetry AP_RCTelemetry: use get_max_rpm_esc() 2024-06-26 17:36:54 +10:00
AP_Relay AP_Relay: added relay output invert function 2024-04-06 10:58:43 +11:00
AP_RobotisServo
AP_ROMFS AP_ROMFS: clarify usage and null termination 2024-05-04 10:15:44 +10:00
AP_RPM AP_RPM: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_RSSI AP_RSSI: make metadata more consistent 2024-07-02 11:34:29 +10:00
AP_RTC AP_RTC: use gmtime_r() instead of gmtime() 2024-02-21 12:09:48 +11:00
AP_SBusOut
AP_Scheduler AP_Scheduler: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Scripting AP_Scripting: add missing scheduler include 2024-07-09 07:40:03 +10:00
AP_SerialLED
AP_SerialManager AP_SerialManager: allocate port IDs for scripting serial device ports 2024-06-27 12:00:18 +10:00
AP_ServoRelayEvents
AP_SmartRTL AP_SmartRTL: use enum class for Action, number entries 2024-06-28 10:11:57 +10:00
AP_Soaring AP_Soaring: convert remaining uses of TRIM_ARSPD_CM to AIRSPEED_CRUISE 2024-01-23 15:00:30 +11:00
AP_Stats AP_Stats: update flight time on disarm 2024-04-05 11:31:20 +11:00
AP_SurfaceDistance AP_SurfaceDistance: Start library for tracking the floor/roof distance 2024-05-28 09:55:36 +10:00
AP_TECS AP_TECS: Small legibility improvements 2024-06-20 09:12:50 +10:00
AP_TempCalibration AP_TempCalibration: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_TemperatureSensor AP_Temperature:expand metadata for analog sensors 2024-07-01 14:01:19 +10:00
AP_Terrain AP_Terrain: added parameter for terrain cache size 2024-05-17 10:18:13 +10:00
AP_Torqeedo AP_Torqeedo: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Tuning AP_Tuning: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Vehicle AP_Vehicle: make AP_RANGEFINDER_ENABLED remove more code 2024-07-02 09:17:26 +10:00
AP_VideoTX AP_VideoTX: add autobauding to Tramp 2024-05-29 17:49:08 +10:00
AP_VisualOdom AP_VisualOdom: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Volz_Protocol
AP_WheelEncoder AP_WheelEncoder: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Winch AP_Winch: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_WindVane AP_WindVane: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
APM_Control APM_Control: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AR_Motors AP_MotorsUGV: Fix Riscv64 compiler error issue #25974 2024-01-23 08:34:33 +09:00
AR_WPNav AR_WPNav: allow target position on track to stop advancing 2024-03-20 19:27:56 +11:00
doc treewide: fix shebangs - /bin/bash -> /usr/bin/env bash 2024-02-13 11:36:23 +11:00
Filter Filter: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
GCS_MAVLink GCS_MAVLink: correct a debugging message 2024-07-09 10:10:52 +10:00
PID
RC_Channel RC_Channel: produce error if feature compiled out and aux func initialised 2024-07-04 19:41:07 +10:00
SITL SITL: remove duplicated crc code 2024-07-05 23:02:18 +10:00
SRV_Channel SRV_Channel: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
StorageManager StorageManager: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
COLCON_IGNORE