ardupilot/libraries
bugobliterator 2bb19228a7 AP_Scripting: stash and restore FPU register context in LUAI_TRY
this fixes an issue where a lua library function triggers an exception
after it does a math operation which changes the floating point
registers on M7 MCUs (such as STM32H7). An example is math.random()
which calls math_random(), which pre-calculates a double value before
checking if the arguments to the call are valid. When it then checks
and finds invalid values the exception longjmp does not restore the
floating point registers.
2023-08-01 16:51:27 +09:00
..
AC_AttitudeControl AC_Attitude:add TKOFF/LAND only weathervane option 2023-03-01 09:51:36 +11:00
AC_Autorotation AC_Autorotation: add and use AP_RPM_ENABLED 2022-09-20 09:28:27 +10:00
AC_AutoTune AC_AutoTune: correct incorrect min raw rate valuee 2023-07-04 12:17:51 +09:00
AC_Avoidance AC_Avoidance: avoid using struct Location 2023-02-04 22:51:54 +11:00
AC_CustomControl AC_CustomControl: generalize pid descriptions 2022-11-22 10:55:45 +11:00
AC_Fence AC_Fence: avoid using struct Location 2023-02-04 22:51:54 +11:00
AC_InputManager all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AC_PID AC_PID: AC_PI: fix param defualting 2023-02-06 08:09:13 +09:00
AC_PrecLand AC_Precland: Add option to resume precland after manual override 2023-01-31 19:56:43 +09:00
AC_Sprayer AC_Sprayer: rename the boolean passed to run method 2022-11-17 13:46:46 +09:00
AC_WPNav AC_WPNav: wpnav speed param check fixed 2023-06-08 10:05:36 +09:00
AP_AccelCal AP_AccelCal: remove unneccesary includes of AP_Vehicle_Type.h 2022-11-02 18:35:48 +11:00
AP_ADC AP_ADC: Console output can be disabled 2022-05-17 09:53:06 +10:00
AP_ADSB AP_ADSB: Fix spam of lost transciever message at update() rate 2023-07-04 12:17:51 +09:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: add and use AP_ADVANCEDFAILSAFE_ENABLED 2023-02-08 19:00:13 +11:00
AP_AHRS AP_AHRS: don't reject airspeed using EKF if dead-reckoning 2023-06-08 10:05:36 +09:00
AP_Airspeed AP_Airspeed: save some bytes by making conversion structure static 2023-03-10 08:49:36 +11:00
AP_AIS AP_AIS: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_Arming AP_Arming: reword GPS pre-arm failure 2023-07-04 12:17:51 +09:00
AP_Avoidance AP_Avoidance: include required AP_Vehicle_Type header 2022-11-02 18:35:48 +11:00
AP_Baro AP_Baro: fix bug in alt error arming check 2023-02-10 06:46:08 +11:00
AP_BattMonitor AP_BattMonitor: Fixes the setting of a default parameter for battery instance #2 set in hwdef 2023-06-08 10:05:36 +09:00
AP_Beacon AP_Beacon: add and use AP_BEACON_ENABLED 2022-11-16 08:16:31 +11:00
AP_BLHeli AP_BLHeli: change namespace of MultiCopter and FixedWing params 2022-11-09 19:04:37 +11:00
AP_BoardConfig AP_BoardConfig: fixed documentation of safety options 2023-06-08 10:05:36 +09:00
AP_Button AP_Button: implement parameter CopyFieldsFrom and use it 2023-01-03 11:08:43 +11:00
AP_Camera AP_Camera: correct config boards include 2023-03-19 09:08:41 +11:00
AP_CANManager AP_CANManager: add and use option to compile SLCAN support out of code 2023-03-15 19:08:09 +11:00
AP_CheckFirmware AP_CheckFirmware: remove GCS.h from header files 2022-11-16 18:29:07 +11:00
AP_Common AP_Common: add NMEA output to a buffer 2023-02-07 21:12:07 +11:00
AP_Compass AP_Compass: specify compass feature enables for periph in chibios_hwdef.py 2023-03-12 09:35:35 +11:00
AP_CSVReader AP_CSVReader: add simple CSV reader 2023-01-17 11:21:48 +11:00
AP_CustomRotations AP_CustomRotations: fix param refrencing 2022-04-20 18:25:57 +10:00
AP_DAL AP_DAL: use MAX_EKF_CORES instead of INS_MAX_INSTANCES in ekf_low_time_remaining 2023-03-21 10:04:16 +11:00
AP_Declination AP_Declination: update magnetic field tables 2023-01-03 11:01:32 +11:00
AP_Devo_Telem AP_Devo_Telem: tidy AP_SerialManager.h includes 2022-11-08 09:49:19 +11:00
AP_EFI AP_EFI: add defines for Lutan and MegaSquirt 2023-03-21 09:01:13 +11:00
AP_ESC_Telem AP_ESC_Telem: add and use an AP_ESC_Telem_config.h 2023-03-10 08:48:24 +11:00
AP_ExternalAHRS AP_ExternalAHRS: specify AP_EXTERNALAHRS_ENABLED for periph in chibios_hwdef.py 2023-03-12 09:35:35 +11:00
AP_FETtecOneWire AP_FETtecOneWire: change comments to not use @param 2022-12-30 09:54:09 +11:00
AP_Filesystem AP_Filesystem: support file rename 2023-03-05 09:42:48 +11:00
AP_FlashIface AP_FlashIface: change namespace of MultiCopter and FixedWing params 2022-11-09 19:04:37 +11:00
AP_FlashStorage AP_FlashStorage: fix spelling 2023-02-14 14:33:01 +00:00
AP_Follow AP_Follow: include required AP_Vehicle_Type header 2022-11-02 18:35:48 +11:00
AP_Frsky_Telem AP_Frsky_Telem: rename HAL_INS_ENABLED to AP_INERTIALSENSOR_ENABLED 2023-01-03 10:28:42 +11:00
AP_Generator AP_Generator: correct config boards include 2023-03-19 09:08:41 +11:00
AP_GPS AP_GPS: fixed ublox M10S auto-config 2023-07-04 12:17:51 +09:00
AP_Gripper AP_Gripper: correct config boards include 2023-03-19 09:08:41 +11:00
AP_GyroFFT AP_GyroFFT: change default FFT frequency range to something more useful 2023-01-24 10:56:33 +11:00
AP_HAL AP_HAL: add helper functions for LEDs 2023-06-08 10:05:35 +09:00
AP_HAL_ChibiOS HAL_ChibiOS: implement newlib alloc functions as malloc wrappers 2023-07-04 15:12:55 +09:00
AP_HAL_Empty AP_HAL_Empty: move implementations of functions to header 2022-06-23 12:38:41 +10:00
AP_HAL_ESP32 AP_HAL_ESP32: Readme update 2023-01-31 18:00:25 +11:00
AP_HAL_Linux AP_HAL_Linux: Update GPIO and RCInput for pi version change 2023-02-22 21:10:04 -08:00
AP_HAL_SITL SITL: Send VCAS in Flightgear packet. 2023-02-20 05:37:21 -08:00
AP_Hott_Telem AP_Hott_Telem: move definition of HAL_HOTT_TELEM_ENABLED to minimise include file 2022-11-08 20:23:58 +11:00
AP_ICEngine AP_ICEngine: fixed a bug engine control when running 2023-06-08 10:05:36 +09:00
AP_InertialNav
AP_InertialSensor AP_InertialSensor: SCHA63T comment fix 2023-06-08 10:05:36 +09:00
AP_InternalError AP_InternalError: add waf argument to get consistent builds 2023-02-17 20:48:45 +11:00
AP_IOMCU AP_IOMCU: fixed issue with not regaining RC input 2023-06-08 10:05:35 +09:00
AP_IRLock
AP_JSButton
AP_KDECAN all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_L1_Control AP_L1_Control: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_Landing AP_Landing: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_LandingGear AP_LandingGear: make and use AP_LANDINGGEAR_ENABLED 2022-12-14 18:30:23 +11:00
AP_LeakDetector AP_LeakDetector: add manual leak-pin selection 2022-11-12 20:38:35 -03:00
AP_Logger AP_Logger: do not rotate logs when disarming if we are replay-logging 2023-06-08 10:05:35 +09:00
AP_LTM_Telem AP_LTM_Telem: tidy AP_SerialManager.h includes 2022-11-08 09:49:19 +11:00
AP_Math AP_Math: add crc8_sae 2023-06-08 10:05:36 +09:00
AP_Menu
AP_Mission AP_Mission: correct missing transitive include problem 2023-03-19 09:08:41 +11:00
AP_Module AP_Module: correct ModuleTest example for lack of GCS object 2022-08-19 18:34:19 +10:00
AP_Motors AP_Motors: Heli RSC: remove incorrect set range call 2023-07-04 12:17:51 +09:00
AP_Mount AP_SerialManager: generalise SToRM32 serial protocol desc and enum 2023-07-04 12:17:51 +09:00
AP_MSP AP_MSP: Increase DisplayPort UART TX buffer to prevent OSD corruption 2023-02-15 12:31:37 +11:00
AP_NavEKF AP_NavEKF: ensure gyro biases are numbers 2023-06-08 10:05:36 +09:00
AP_NavEKF2 AP_NavEKF2: fixed velocity reset on AID_NONE 2023-07-04 12:17:51 +09:00
AP_NavEKF3 AP_NavEKF3: fixed velocity reset on AID_NONE 2023-07-04 12:17:51 +09:00
AP_Navigation AP_Navigation: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_NMEA_Output AP_NMEA_Output: fix GPGGA hdop, fix, sats 2023-03-14 12:45:47 -07:00
AP_Notify AP_Notify: add driver for IS31FL3195 LED 2023-07-04 12:17:52 +09:00
AP_OLC AP_OLC: move OSD minimised features to minimize_features.inc 2023-02-28 10:40:27 +11:00
AP_ONVIF all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_OpenDroneID AP_OpenDroneID: fixed mavlink enum 2023-03-07 20:35:13 +09:00
AP_OpticalFlow AP_OpticalFlow: add some units to OFCA log message 2022-12-12 13:27:25 +11:00
AP_OSD AP_OSD: move OSD minimizement to minimize_features.inc 2023-03-21 08:47:53 +11:00
AP_Parachute AP_Parachute: use relay singleton in Parachute 2023-01-03 10:19:54 +11:00
AP_Param AP_Param: added set() to AP_Enum 2023-06-08 10:05:35 +09:00
AP_PiccoloCAN AP_PiccoloCAN: tidy AP_EFI defines 2023-03-21 09:01:13 +11:00
AP_Proximity AP_Proximity: reduce SF45b mode filter to 3 elements 2023-03-01 18:22:22 +11:00
AP_Radio AP_Radio: increase short board names to 23 chars 2022-09-21 17:56:42 +10:00
AP_Rally AP_Rally: include required AP_Vehicle_Type header 2022-11-02 18:35:48 +11:00
AP_RAMTRON AP_RAMTRON: added PB85RS128C and PB85RS2MC 2023-03-19 17:22:53 +11:00
AP_RangeFinder AP_RangeFinder: allow re-init if no sensors found 2023-03-06 19:48:07 +11:00
AP_RCMapper all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_RCProtocol AP_RCProtocol: return true on initial protocol detection 2023-06-08 10:05:35 +09:00
AP_RCTelemetry AP_RCTelemetry: add and use AP_RCTelemetry_config.h 2023-03-21 08:47:53 +11:00
AP_Relay AP_Relay: added get() method for scripting 2022-10-11 11:47:04 +11:00
AP_RobotisServo all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_ROMFS AP_ROMFS: tidy includes 2022-05-03 09:14:58 +10:00
AP_RPM AP_RPM: fixed SITL RPM backend for new motor mask 2022-10-16 20:38:19 +11:00
AP_RSSI all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_RTC
AP_SBusOut all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_Scheduler AP_Scheduler: rename HAL_SCHEDULER_ENABLED to AP_SCHEDULER_ENABLED 2023-02-28 11:26:04 +11:00
AP_Scripting AP_Scripting: stash and restore FPU register context in LUAI_TRY 2023-08-01 16:51:27 +09:00
AP_SerialLED AP_SerialLED: add defines for some AP_Notify LED libraries 2023-03-07 10:30:13 +11:00
AP_SerialManager AP_SerialManager: improve OPTIONS desc for Swap bit 2023-07-04 12:17:51 +09:00
AP_ServoRelayEvents all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_SmartRTL AP_SmartRTL: params always use set method 2022-08-03 13:43:48 +01:00
AP_Soaring AP_Soaring: change namespace of MultiCopter and FixedWing params 2022-11-09 19:04:37 +11:00
AP_Stats
AP_TECS AP_TECS: protect against low airspeed in reset 2023-02-19 10:20:03 -08:00
AP_TempCalibration all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_TemperatureSensor AP_TemperatureSensor:correct TEMP sensor metadata 2023-01-24 11:16:51 +11:00
AP_Terrain AP_Terrain: terrain offset max default to 30m 2023-03-14 11:59:49 +11:00
AP_Torqeedo AP_Torqeedo: add and use AP_Generator_config.h 2023-03-10 08:48:24 +11:00
AP_Tuning AP_Tuning: tidy includes 2022-05-03 09:14:58 +10:00
AP_UAVCAN AP_UAVCAN: tidy AP_EFI defines 2023-03-21 09:01:13 +11:00
AP_Vehicle AP_Vehicle: added set_land_descent_rate scripting method 2023-02-09 07:02:12 +11:00
AP_VideoTX AP_VideoTX: protect vtx from pitmode changes when not enabled or not armed 2023-02-15 19:30:28 +11:00
AP_VisualOdom AP_VisualOdom: handle voxl yaw and pos jump on reset 2023-01-24 11:07:02 +11:00
AP_Volz_Protocol AP_Volz: disable with minmimize features 2022-06-15 18:05:44 +10:00
AP_WheelEncoder AP_WheelEncoder: Support changing update period 2022-12-13 17:10:06 +11:00
AP_Winch AP_Winch: Fix baud rate handling 2023-03-04 07:59:23 +09:00
AP_WindVane AP_WindVane: use body frame when setting apparent wind in sitl physics backend 2023-03-15 12:58:49 +00:00
APM_Control AR_PosControl: add input_pos_vel_accel target 2023-06-08 10:05:36 +09:00
AR_Motors AR_Motors: fix have_skid_steering to return true for omni too 2022-12-12 19:59:17 +09:00
AR_WPNav AR_WPNav: avoid using struct Location 2023-02-04 22:51:54 +11:00
doc
Filter Filter: SlewLimiter: always caculate slew limit 2023-06-08 10:05:36 +09:00
GCS_MAVLink GCS_Common: handle CMD_DO_SET_ROI_NONE for command int packets 2023-07-04 12:17:51 +09:00
PID PID: use new defualt pattern 2023-01-24 10:16:56 +11:00
RC_Channel RC_Channel: rename Aux SW for AUTO_VTOL to PLANE_AUTO_L:AND_ABORT 2023-03-15 13:31:43 -07:00
SITL SITL: add support for auxiliary IMUs 2023-03-21 10:04:16 +11:00
SRV_Channel SRV_Channel: narrow include for configuration 2023-01-25 22:30:55 +11:00
StorageManager StorageManager: fixed startup crash 2023-03-12 07:15:01 +11:00