ardupilot/libraries
Andrew Tridgell bb1b2dafae AP_InternalError: only panic in SITL if debug enabled
a user recently had a flow of control panic in quadplane in
cygwin/missionplanner SITL. The panic this caused means we don't get
logging information on what line of code was triggered

the panic in SITL for internal errors is only useful if you have debug
information and can then attach a debugger. Without debug information
it is much better to behave the same as a real vehicle and report an
internal error (with line number)
2022-10-21 22:14:39 +11:00
..
AC_AttitudeControl AC_AttitudeControl: remove duplicate `_attitude_target.normalize()` 2022-10-18 08:30:46 +11:00
AC_AutoTune AC_AutoTune: params always use set method 2022-08-03 13:43:48 +01:00
AC_Autorotation AC_Autorotation: add and use AP_RPM_ENABLED 2022-09-20 09:28:27 +10:00
AC_Avoidance all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AC_CustomControl AC_CustomControl: add README 2022-08-30 13:10:09 +10:00
AC_Fence all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AC_InputManager all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AC_PID AC_PID: params always use set method 2022-08-03 13:43:48 +01:00
AC_PrecLand all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AC_Sprayer all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AC_WPNav AC_WPNav: AC_Loiter: Fix loiter level bug 2022-09-02 09:02:46 +09:00
APM_Control APM_Control: added access to time constant 2022-10-18 07:38:39 +11:00
AP_ADC
AP_ADSB all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_AHRS AP_AHRS: pre-arm msg loses extra AHRS prefix 2022-10-21 08:07:39 +11:00
AP_AIS AP_AIS: include GCS_MAVLink.h 2022-07-13 18:32:35 +10:00
AP_AccelCal AP_AccelCal: include GCS_Config.h rather than GCS.h 2022-09-27 09:26:45 +10:00
AP_AdvancedFailsafe all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_Airspeed AP_Airspeed: generalize ARSPD_BUS metadata 2022-10-19 23:27:25 +11:00
AP_Arming AP_Arming: wrap compass cal function calls with COMPASS_CAL_ENABLED 2022-10-11 11:20:50 +11:00
AP_Avoidance all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_BLHeli AP_BLHeli: allow motor mask and motor output type to be passed in for AP_Periph 2022-09-20 09:45:03 +10:00
AP_Baro all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_BattMonitor AP_BattMonitor: add set_temperature() by external temperature sources/libraries 2022-10-18 10:05:31 +11:00
AP_Beacon AP_Beacon: params always use set method 2022-08-03 13:43:48 +01:00
AP_BoardConfig AP_BoardConfig: fixed BRD_SAFETY_MASK 2022-10-07 11:38:15 +11:00
AP_Button AP_Button: print button index and postion on aux function trigger 2022-10-14 12:01:07 +11:00
AP_CANManager AP_CANManager: allow SLCAN to be initialized without CANManager 2022-10-11 11:26:40 +11:00
AP_Camera all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_CheckFirmware AP_CheckFirmware: rename secure data to apsec_data 2022-09-05 12:35:37 +10:00
AP_Common AP_Common: added setonoff() method for bitmask 2022-10-11 11:47:04 +11:00
AP_Compass AP_Compass: send report if we are in the BAD_RADIUS state 2022-10-06 10:31:09 +11:00
AP_CustomRotations
AP_DAL
AP_Declination AP_Declination: avoid undefined floating point exceptions on macOS when using implicit casts 2022-08-24 17:34:17 +10:00
AP_Devo_Telem all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_EFI AP_EFI: convert to using ap_object approach 2022-10-02 08:15:06 +11:00
AP_ESC_Telem AP_ESC_Telem: allow external libraries, like AP_TemperatureSensor, to override the temperature 2022-10-18 10:05:31 +11:00
AP_ExternalAHRS AP_ExternalAHRS: fixes from --ubsan autotest 2022-09-06 10:49:50 +10:00
AP_FETtecOneWire all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_Filesystem AP_Filesystem: correct compilation with rally disabled 2022-09-27 10:16:47 +10:00
AP_FlashIface AP_FlashIface: fix examples 2022-08-19 18:33:58 +10:00
AP_FlashStorage
AP_Follow AP_Follow: include required GCS.h header 2022-09-27 09:26:45 +10:00
AP_Frsky_Telem AP_Frsky_Telem: fixed roll and pitch for VTOL view 2022-10-19 18:36:58 +11:00
AP_GPS AP_GPS: Fix novatel driver to handle DOP correctly, and fix overly optimistic horizontal accuracy estimate 2022-10-18 10:06:46 +11:00
AP_Generator all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_Gripper all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_GyroFFT all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_HAL AP_HAL: correct prescaler calculation and add testing debug. 2022-10-05 18:27:43 +11:00
AP_HAL_ChibiOS hwdef: use minimal GPS driver (ublox only) on low flash boards 2022-10-19 21:07:22 +11:00
AP_HAL_ESP32 all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_HAL_Empty
AP_HAL_Linux AP_HAL_Linux: add missing header to RCInput_RCProtocol.cpp 2022-09-28 18:38:33 -03:00
AP_HAL_SITL HAL_SITL: use motor mask for noise checking for motors 2022-10-16 20:38:19 +11:00
AP_Hott_Telem all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_ICEngine AP_ICEngine: report when engine goes into run state 2022-10-07 07:53:50 +11:00
AP_IOMCU AP_IOMCU: log number of errors reading status page 2022-09-02 11:16:52 +10:00
AP_IRLock
AP_InertialNav
AP_InertialSensor AP_InertialSensor: Fix BMI085 accel scaling 2022-10-18 11:03:34 +11:00
AP_InternalError AP_InternalError: only panic in SITL if debug enabled 2022-10-21 22:14:39 +11:00
AP_JSButton
AP_KDECAN all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_L1_Control all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_LTM_Telem all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_Landing all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_LandingGear all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_LeakDetector all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_Logger AP_Logger: MessageWriter: SysInfo: write RCOut string 2022-10-18 11:53:59 +11:00
AP_MSP all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_Math AP_Math: Add comments to quaternion methods 2022-10-02 16:58:37 +11:00
AP_Menu
AP_Mission all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +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: Multicopter: add motor pwm param range check 2022-09-19 20:57:51 -04:00
AP_Mount all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_NMEA_Output AP_NMEA_Output.cpp: Fix conversion precision issue: 2022-10-07 08:37:59 +11:00
AP_NavEKF all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_NavEKF2 all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_NavEKF3 all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_Navigation
AP_Notify AP_Notify: correct NTF_BUZZ_PIN documentation 2022-10-13 19:26:49 +11:00
AP_OLC
AP_ONVIF all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_OSD all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_OpenDroneID AP_OpenDroneID: fixed cpp check for cygwin 2022-08-24 18:08:40 +10:00
AP_OpticalFlow AP_OpticalFlow: allow use of OpticalFlow on SimOnHardWare 2022-08-24 18:27:32 +10:00
AP_Parachute all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_Param AP_Param: fixed handling of long lines in defaults.parm 2022-10-07 07:53:16 +11:00
AP_PiccoloCAN all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_Proximity all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_RAMTRON AP_RAMTRON: reduce scope for WITH_SEMAPHORE 2022-07-17 21:42:33 +10:00
AP_RCMapper all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_RCProtocol AP_RCProtocol: add has_uart() 2022-10-18 11:20:25 +11:00
AP_RCTelemetry all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_ROMFS
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_Radio AP_Radio: increase short board names to 23 chars 2022-09-21 17:56:42 +10:00
AP_Rally all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_RangeFinder AP_RangeFinder: remove conversion code from 2019 2022-10-20 08:00:32 +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_SBusOut all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_Scheduler all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_Scripting AP_Scripting: binding gen: add number of argument to manual functions and generate docs for manual 2022-10-19 18:35:32 +11:00
AP_SerialLED
AP_SerialManager AP_SerialManager: only use the first defined serial port for RCIN 2022-10-18 11:20:25 +11: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: Correct metadata formatting 2022-10-18 09:38:47 -07:00
AP_Stats
AP_TECS AP_TECS: reset vdot filter if not been called 2022-10-11 10:41:25 +11:00
AP_TempCalibration all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_TemperatureSensor AP_TemperatureSensor: use AP_Enum<>, add sitl, add _config.h 2022-10-18 10:05:31 +11:00
AP_Terrain AP_Terrain: correct compilation with rally disabled 2022-09-27 10:16:47 +10:00
AP_Torqeedo
AP_Tuning
AP_UAVCAN AP_UAVCAN: correct compilation with EFI dronecan not compiled in 2022-10-11 10:50:13 +11:00
AP_Vehicle AP_Vehicle: add AP_TemperatureSensor 2022-10-18 10:05:31 +11:00
AP_VideoTX all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_VisualOdom AP_VisualOdom: only include log structure if enabled 2022-07-13 18:14:12 +10:00
AP_Volz_Protocol
AP_WheelEncoder all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_Winch all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_WindVane all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AR_Motors AR_Motors: remove arming check to allow ackerman and skid-steering 2022-08-22 07:46:50 -04:00
AR_WPNav AR_WPNav: add accessors for accel and jerk limits 2022-09-06 11:23:51 +09:00
Filter Filter: allow for expansion of dynamic filters 2022-10-16 20:38:19 +11:00
GCS_MAVLink GCS_MAVLink: remove more methods based on HAL_VISUSALODOM_ENABLED 2022-10-21 15:03:35 +11:00
PID PID: params always use set method 2022-08-03 13:43:48 +01:00
RC_Channel RC_Channel: move aux pos string to function, print RC channel number with aux fun 2022-10-14 12:01:07 +11:00
SITL SITL: added plane-3d for aerobatic plane 2022-10-19 23:25:22 +11:00
SRV_Channel SRV_Channel: adjust trim, check all channels for range limit 2022-09-20 11:20:16 +10:00
StorageManager
doc