ardupilot/libraries
Peter Barker d015618e70 AP_HAL_SITL: Periph: stop running SITL updates off main thread
the same code present in the normal HAL-SITL scheduler was not copied across when this method was created.

Without it, if a non-main thread called delay we will attempt to do things like update the sitl_model (ie. SIM_Aircraft) object.  We have no protections in place (nor should we have) for this happening when the main thread is in the middle of doing the SITL updates, so corruption is definitely going to happen at some stage!
2025-01-14 12:15:45 +11:00
..
AC_AttitudeControl AC_PosControl: add get_vel_target and get_accel_target 2024-12-18 18:28:12 +11:00
AC_Autorotation AC_Autorotation: Add RSC_Autorotation class 2024-10-11 09:54:26 +11:00
AC_AutoTune AC_AutoTune_Heli: fix rate and accel limiting 2025-01-06 16:23:37 -05:00
AC_Avoidance AC_Avoidance: save some flash when features disabled 2025-01-14 11:46:13 +11: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_Fence: rearrange log-structure ifdefs 2025-01-14 11:46:13 +11:00
AC_InputManager all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AC_PID AC_PID: AC_P_2D comment fix 2024-10-04 09:25:56 +09:00
AC_PrecLand AC_PrecLand: save some flash when features disabled 2025-01-14 11:46:13 +11:00
AC_Sprayer AC_Sprayer: create and use an AP_Sprayer_config.h 2024-07-05 14:27:45 +10:00
AC_WPNav AC_Loiter: updates to offset handling 2024-10-04 09:25:56 +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: add option to force Mode3AC Only 2024-12-14 22:51:11 -08:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: fix singleton panic message 2024-12-15 23:38:24 +11:00
AP_AHRS AP_AHRS: fix param increment description 2025-01-12 10:18:25 +11:00
AP_Airspeed AP_Airspeed: Fix spelling in GCS message 2025-01-05 17:43:49 +00:00
AP_AIS AP_AIS: rearrange log-structure ifdefs 2025-01-14 11:46:13 +11:00
AP_Arming AP_Arming: HAL_RUNCAM_ENABLED -> AP_CAMERA_RUNCAM_ENABLED 2024-12-13 11:07:09 +00:00
AP_Avoidance AP_Avoidance: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Baro AP_Baro: optimize DroneCAN subscription process 2024-11-18 10:30:29 +11:00
AP_BattMonitor AP_BattMonitor: document BATTn_OPTIONS bit 8 (internal-use-only) 2025-01-06 22:12:53 +11:00
AP_Beacon AP_Beacon: save some flash when features disabled 2025-01-14 11:46:13 +11:00
AP_BLHeli AP_BLHeli: use native motor numbering 2025-01-14 11:24:52 +11:00
AP_BoardConfig AP_BoardConfig: add option to use IO safety led switch for ProfiLED 2024-11-20 19:12:44 +11:00
AP_Button AP_Button: set source index when running aux functions 2024-12-24 11:34:07 +11:00
AP_Camera AP_Camera: save some flash when features disabled 2025-01-14 11:46:13 +11:00
AP_CANManager AP_CANManager: rearrange log-structure ifdefs 2025-01-14 11:46:13 +11:00
AP_CheckFirmware AP_CheckFirmware: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Common AP_Common: Add cont array constructor to AP_Bitmask 2025-01-08 08:52:21 +11:00
AP_Compass AP_Compass: optimize DroneCAN subscription process 2024-11-18 10:30:29 +11:00
AP_CSVReader AP_CSVReader: add simple CSV reader 2023-01-17 11:21:48 +11:00
AP_CustomRotations AP_CustomRotations: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_DAL AP_NavEKF3: move definition of MAX_EKF_CORES 2024-12-31 10:55:51 +11:00
AP_DDS AP_DDS: configuration fixes 2025-01-05 16:07:18 -06:00
AP_Declination AP_Declination: update magnetic field tables 2023-01-03 11:01:32 +11:00
AP_Devo_Telem AP_Devo_Telem: Change division to multiplication 2025-01-02 23:22:42 +11:00
AP_DroneCAN AP_DroneCAN: servo telem rename valid_types to present_types 2025-01-14 10:49:31 +11:00
AP_EFI AP_EFI: Change division to multiplication 2025-01-02 23:22:42 +11:00
AP_ESC_Telem AP_ESC_Telem: save some flash when features disabled 2025-01-14 11:46:13 +11:00
AP_ExternalAHRS AP_ExternalAHRS: support backends with get_variances() 2024-10-23 06:46:59 +09:00
AP_ExternalControl AP_ExternalControl: arm through external control 2024-11-17 21:05:59 +11:00
AP_FETtecOneWire AP_FETtecOneWire: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Filesystem AP_Filesystem: Don't try and rename between backends 2025-01-05 13:33:42 +11:00
AP_FlashIface AP_FlashIface: Fix some typos 2023-10-12 18:30:42 +11:00
AP_FlashStorage AP_FlashStorage: remove superfluous linefeed from panic strings 2024-12-14 10:06:13 +11:00
AP_Follow AP_Follow: use set_alt_m when possible 2024-11-08 10:54:39 +11:00
AP_Frsky_Telem Ap_Frsky_Telem: fix for apparent wind passthrough telemetry frame 2024-11-27 13:46:37 +11:00
AP_Generator AP_Generator: apply -Os to all cpp files 2024-12-17 11:11:27 +11:00
AP_GPS AP_GPS: refactor GSOF to expect packets by ID 2025-01-08 08:52:21 +11:00
AP_Gripper AP_Gripper: correct emitting of grabbed/released messages 2024-06-20 10:59:14 +10:00
AP_GSOF AP_GSOF: refactor GSOF to expect packets by ID 2025-01-08 08:52:21 +11: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: rearrange log-structure ifdefs 2025-01-14 11:46:13 +11:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: replace HAL_NO_UARTDRIVER with AP_HAL_UARTDRIVER_ENABLED 2025-01-14 11:26:37 +11:00
AP_HAL_Empty AP_HAL_Empty: removed run_debug_shell 2024-07-11 07:42:54 +10:00
AP_HAL_ESP32 AP_HAL_ESP32: remove use of HAL_NO_UARTDRIVER 2025-01-07 13:11:15 +11:00
AP_HAL_Linux AP_HAL_Linux: remove superfluous linefeed from panic strings 2024-12-14 10:06:13 +11:00
AP_HAL_QURT AP_HAL_QURT: Added support for PWM channels 4 to 8 when using the IO board 2024-12-24 12:32:04 +11:00
AP_HAL_SITL AP_HAL_SITL: Periph: stop running SITL updates off main thread 2025-01-14 12:15:45 +11:00
AP_Hott_Telem AP_Hott_Telem: disable Hott telemetry by default 2024-08-06 09:30:49 +10:00
AP_IBus_Telem AP_IBus_Telem: Initial implementation 2024-08-07 14:01:44 +10:00
AP_ICEngine AP_ICEngine: reinstate STARTCHN_MIN looking up PWM using source index 2024-12-24 11:34:07 +11: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: do not read FIFO faster than requested rate for ICM45686 2024-12-18 19:05:20 +11:00
AP_InternalError AP_InternalError: remove superfluous linefeed from panic strings 2024-12-14 10:06:13 +11:00
AP_IOMCU AP_IOMCU: Change division to multiplication 2025-01-02 23:22:42 +11: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: standardize on 32 bit microsecond CAN timeouts 2024-10-11 09:51:43 +11:00
AP_L1_Control AP_L1_Control: make reached_loiter_target() more reliable 2024-10-01 07:15:44 +10:00
AP_Landing AP_Landing: add AutoLand fixed-wing mode 2024-12-31 09:18:49 +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 metadata giving enum for RFND.Orient 2024-12-27 16:06:30 +11:00
AP_LTM_Telem AP_LTM_Telem: disable LTM telemetry by default 2024-08-06 09:30:49 +10:00
AP_Math AP_Math: correct description of linear_interpolate 2025-01-11 11:24:36 +11:00
AP_Menu AP_Menu: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Mission AP_Mission: set source index when running aux functions 2024-12-24 11:34:07 +11: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: create and use a singleton for SRV_Channels 2024-11-13 19:47:49 +11:00
AP_Mount AP_Mount: save some flash when features disabled 2025-01-14 11:46:13 +11:00
AP_MSP AP_MSP: MSP_RAW_GPS cog should be decidegrees not centidegrees 2024-09-13 12:45:22 +10:00
AP_MultiHeap AP_MultiHeap: initialize only if heap allocation succeeded 2025-01-05 10:27:32 +11:00
AP_NavEKF AP_NavEKF3: move definition of MAX_EKF_CORES 2024-12-31 10:55:51 +11:00
AP_NavEKF2 AP_NavEKF2: rearrange log-structure ifdefs 2025-01-14 11:46:13 +11:00
AP_NavEKF3 AP_NavEKF3: move definition of MAX_EKF_CORES 2024-12-31 10:55:51 +11:00
AP_Navigation AP_Navigation: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_Networking AP_Networking: correct closing comment on #if 2025-01-07 12:39:42 +11: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: add support for controlling ProfiLED via IOMCU safety pins 2024-11-20 19:12:44 +11:00
AP_OLC AP_OLC: add unit tests 2023-10-04 19:00:34 +11:00
AP_ONVIF AP_ONVIF: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
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: optimize DroneCAN subscription process 2024-11-18 10:30:29 +11: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: remove superfluous linefeed from panic strings 2024-12-14 10:06:13 +11:00
AP_PiccoloCAN AP_PiccoloCAN: servo telem rename valid_types to present_types 2025-01-14 10:49:31 +11:00
AP_Proximity AP_Proximity: add sample data from LD06 sensor 2025-01-09 15:39:34 +11:00
AP_Quicktune AP_Quicktune: adjust defaults 2024-11-27 14:07:38 +11:00
AP_Radio AP_Radio: remove superfluous linefeed from panic strings 2024-12-14 10:06:13 +11:00
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: tidy alert sending 2025-01-14 10:16:32 +11: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 superfluous linefeed from panic strings 2024-12-14 10:06:13 +11:00
AP_RCTelemetry AP_RCTelemetry: add missing CRSF scheduler table entry 2024-12-05 10:03:27 -06:00
AP_Relay AP_Rely: allow RELAYn_DEFAULT values for DroneCAN Periphs 2024-11-15 10:57:31 -08:00
AP_RobotisServo AP_RobotisServo: Send register write values as little-endian 2024-09-27 11:53:06 +10:00
AP_ROMFS AP_ROMFS: clarify usage and null termination 2024-05-04 10:15:44 +10:00
AP_RPM AP_RPM: save some flash when features disabled 2025-01-14 11:46:13 +11:00
AP_RSSI AP_RSSI: make metadata more consistent 2024-07-02 11:34:29 +10:00
AP_RTC AP_RTC: correct logger documentation 2024-11-22 10:18:31 +11:00
AP_SBusOut AP_SBusOut: make sbus output exactly match sbus input decoding 2023-10-13 09:42:25 +11:00
AP_Scheduler AP_Scheduler: log RTC into PM message 2024-11-21 09:19:38 +11:00
AP_Scripting AP_Scripting: servo telem rename valid_types to present_types 2025-01-14 10:49:31 +11:00
AP_SerialLED AP_SerialLED: return success status from send and set_RGB 2023-11-20 19:22:20 +11:00
AP_SerialManager AP_SerialManager: move serial port init of Volz protocol into Volz library 2024-12-17 09:14:08 +11:00
AP_Servo_Telem AP_Servo_Telem: rearrange log-structure ifdefs 2025-01-14 11:46:13 +11:00
AP_ServoRelayEvents AP_ServoRelayEvents: allow mavlink command of rcin scaled functions 2023-10-17 10:32:39 +11:00
AP_SmartRTL AP_SmartRTL: add point made public 2024-07-24 17:22:44 +10:00
AP_Soaring AP_Soaring: Add named value float publisher 2025-01-14 11:56:39 +11:00
AP_Stats AP_Stats: update flight time on disarm 2024-04-05 11:31:20 +11:00
AP_SurfaceDistance AP_SurfaceDistance: re-order initialiser lines so -Werror=reorder will work 2024-09-24 22:50:28 +10:00
AP_TECS AP_TECS: Removed an unused variable to get rid of a compiler warning 2024-12-14 15:42:46 +11:00
AP_TempCalibration AP_TempCalibration: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_TemperatureSensor AP_TemperatureSensor: optimize DroneCAN subscription process 2024-11-18 10:30:29 +11:00
AP_Terrain AP_Terrain: Add const to locals 2024-11-26 15:42:04 +11: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: Change division to multiplication 2025-01-02 23:22:42 +11:00
AP_VideoTX AP_VideoTX: Change division to multiplication 2025-01-02 23:22:42 +11:00
AP_VisualOdom AP_VisualOdom: fix singleton panic message 2024-12-15 23:38:24 +11:00
AP_Volz_Protocol AP_Volz_Protocol: servo telem rename valid_types to present_types 2025-01-14 10:49:31 +11:00
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 AP_WindVane: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
APM_Control APM_Control: Correct use of deceleration 2024-11-04 11:55:28 +09:00
AR_Motors AR_Motors: make SRV_Channels::cork non-static 2024-11-13 19:47:49 +11:00
AR_WPNav AR_WPNav: re-order initialiser lines so -Werror=reorder will work 2024-09-24 22:50:28 +10:00
doc treewide: fix shebangs - /bin/bash -> /usr/bin/env bash 2024-02-13 11:36:23 +11:00
Filter Filter: enable 4 filters on low-flash boards 2024-12-09 07:40:06 +11:00
GCS_MAVLink GCS_MAVLink: remove MOUNT_CONFIGURE and MOUNT_CONTROL support 2025-01-03 14:18:25 +11:00
PID PID: use new defualt pattern 2023-01-24 10:16:56 +11:00
RC_Channel RC_Channel: re-instate init_aux_function call. 2025-01-02 08:25:34 +11:00
SITL SITL: correct buffer size in SIM_FETtecOneWireESC read 2025-01-13 22:14:54 +11:00
SRV_Channel SRV_Channel: added get_output_pwm_chan() for scripting 2024-11-28 09:24:03 +11:00
StorageManager StorageManager: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
COLCON_IGNORE Tools: add COLCON_IGNORE to modules and libraries 2023-04-19 18:34:15 +10:00