ardupilot/libraries
Andrew Tridgell 7a4483b091 SITL: new XPlane backend
this makes use of DRefs to greatly improve XPlane support. It only
supports XPlane 11 and later

The key change is the use of a JSON file to map ArduPilot output
channels to DataRefs, and map raw joystick inputs to RC inputs

this gets rid of the awful throttle hack handling, and allows for
control of a much wider range of aircraft
2023-01-31 11:22:08 +11:00
..
AC_AttitudeControl AC_AttitudeControl: move THR_G_BOOST to Multicopter only 2023-01-31 08:22:40 +09:00
AC_Autorotation AC_Autorotation: add and use AP_RPM_ENABLED 2022-09-20 09:28:27 +10:00
AC_AutoTune AC_AutoTune: fix pilot testing bug 2022-11-22 08:10:00 +09:00
AC_Avoidance AC_Avoidance: enumeration format fixes 2023-01-25 19:50:34 +11:00
AC_CustomControl AC_CustomControl: generalize pid descriptions 2022-11-22 10:55:45 +11: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: use new defualt pattern 2023-01-24 10:16:56 +11:00
AC_PrecLand AC_PrecLand: include required AP_Vehicle_Type header 2022-11-02 18:35:48 +11:00
AC_Sprayer AC_Sprayer: rename the boolean passed to run method 2022-11-17 13:46:46 +09:00
AC_WPNav AC_WPNav: Fix Bug to use WPNAV_ACCEL_C 2023-01-28 08:11:51 +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: create AP_ADSB_config.h 2023-01-31 11:11:26 +11:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: include cleanups 2022-11-08 09:49:19 +11:00
AP_AHRS AP_AHRS: use FieldBitmaskEnum and FieldValueEnum 2023-01-25 19:50:34 +11:00
AP_Airspeed AP_Airspeed: move setting of first backend defualts to constructor to avoid race 2023-01-05 08:27:45 +11:00
AP_AIS AP_AIS: tidy AP_SerialManager.h includes 2022-11-08 09:49:19 +11:00
AP_Arming AP_Arming: use check_enabked hepler to always check if all bit is set 2023-01-24 11:09:51 +11:00
AP_Avoidance AP_Avoidance: include required AP_Vehicle_Type header 2022-11-02 18:35:48 +11:00
AP_Baro AP_Baro: allow enabling of only some ExternalAHRS sensors 2023-01-30 09:22:02 +11:00
AP_BattMonitor AP_BattMonitor: disable MPPT Fault announcement spam 2023-01-31 10:55:31 +11: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: improve description of BRD_PWM_VOLT_SEL 2023-01-31 11:13:35 +11:00
AP_Button AP_Button: implement parameter CopyFieldsFrom and use it 2023-01-03 11:08:43 +11:00
AP_Camera AP_Camera: fixed CAM_MIN_INTERVAL 2022-12-05 07:48:39 +11:00
AP_CANManager AP_CANManager: check for alloc failure of ObjectBuffer 2023-01-08 15:11:32 +11:00
AP_CheckFirmware AP_CheckFirmware: remove GCS.h from header files 2022-11-16 18:29:07 +11:00
AP_Common AP_Common: added MultiHeap class 2023-01-16 09:19:16 +11:00
AP_Compass AP_Compass: make DRIVER_IST8308 an invalid symbol if not compiled in 2023-01-31 11:08:28 +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: call start_frame for all backends 2022-12-23 09:56:29 +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: remove GCS.h from library header files 2022-11-16 18:29:07 +11:00
AP_ESC_Telem AP_ESC_Telem: simplify AP_TemperatureSensor integration 2023-01-31 10:52:23 +11:00
AP_ExternalAHRS AP_ExternalAHRS: added EAHRS_SENSORS parameter 2023-01-30 09:22:02 +11:00
AP_FETtecOneWire AP_FETtecOneWire: change comments to not use @param 2022-12-30 09:54:09 +11:00
AP_Filesystem AP_Filesystem: detect inconsistent parameter count 2023-01-04 21:50:24 +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: support L496 MCUs 2021-09-24 18:08:00 +10: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: tidy includes of SRV_Channel.h 2023-01-25 22:30:55 +11:00
AP_GPS AP_GPS: fixed use of undulation for GPS2_RAW 2023-01-08 13:30:11 +11:00
AP_Gripper AP_Gripper: tidy includes of SRV_Channel.h 2023-01-25 22:30:55 +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: enumeration format fixes 2023-01-25 19:50:34 +11:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: define HAL_ENABLE_SAVE_PERSISTENT_PARAMS for bootloader in hwdef.h 2023-01-31 10:36:39 +11: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: added old_size to heap_realloc 2023-01-16 09:19:16 +11:00
AP_HAL_Linux AP_HAL_Linux: added old_size to heap_realloc 2023-01-16 09:19:16 +11:00
AP_HAL_SITL HAL_SITL: exit on close of port 0 on cygwin 2023-01-24 15:48:04 +11: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: added allow_throttle_while_disarmed() 2022-11-14 11:14:09 +11:00
AP_InertialNav AP_InertialNav: nfc, fix to say relative to EKF origin 2022-02-03 12:05:12 +09:00
AP_InertialSensor AP_InertialSensor: allow enabling of only some ExternalAHRS sensors 2023-01-30 09:22:02 +11:00
AP_InternalError AP_InternalError: only panic in SITL if debug enabled 2022-10-21 22:14:39 +11:00
AP_IOMCU AP_IOMCU: log number of errors reading status page 2022-09-02 11:16:52 +10:00
AP_IRLock AP_IRLock: correct spelling mili -> milli 2022-01-31 08:55:29 +09: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_Landing AP_Landing: Add Landing Max Throttle Option 2023-01-24 10:19:56 +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: use FieldBitmaskEnum and FieldValueEnum 2023-01-25 19:50:34 +11:00
AP_LTM_Telem AP_LTM_Telem: tidy AP_SerialManager.h includes 2022-11-08 09:49:19 +11:00
AP_Math AP_Math: use classes to fix MATH_CHECK_INDEXES 2023-01-25 19:58:54 +11:00
AP_Menu
AP_Mission AP_Mission: add error check to mission_load.lua 2023-01-17 10:24:08 +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_Motor: removed redundant statements 2023-01-30 08:18:08 +09:00
AP_Mount AP_Mount: servo mount yaw handling fix 2023-01-24 10:59:10 +11:00
AP_MSP AP_MSP: regularise compass defines 2022-11-15 16:44:38 +11:00
AP_NavEKF AP_NavEKF: add and use AP_BEACON_ENABLED 2022-11-16 08:16:31 +11:00
AP_NavEKF2 AP_NavEKF2: remove misleading comment about local variable names 2023-01-25 19:58:54 +11:00
AP_NavEKF3 AP_NavEKF3: use classes to fix MATH_CHECK_INDEXES 2023-01-25 19:58:54 +11:00
AP_Navigation AP_Navigation: make crosstrack_error_integrator pure virtual as nobody use the base class 2021-06-11 04:59:06 -07:00
AP_NMEA_Output AP_NMEA_Output: align param info structures to save flash 2023-01-11 18:41:34 +11:00
AP_Notify AP_Notify: rename HAL_OREO_LED_ENABLED to AP_NOTIFY_OREOLED_ENABLED 2022-11-22 10:23:35 +11:00
AP_OLC AP_OLC: tidy includes 2022-05-03 09:14:58 +10:00
AP_ONVIF all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_OpenDroneID AP_OpenDroneID: set EMERGENCY status on crash or chute deploy 2023-01-17 10:31:26 +11:00
AP_OpticalFlow AP_OpticalFlow: add some units to OFCA log message 2022-12-12 13:27:25 +11:00
AP_OSD AP_OSD: add and use AP_VIDEOTX_ENABLED 2023-01-24 11:03:27 +11:00
AP_Parachute AP_Parachute: use relay singleton in Parachute 2023-01-03 10:19:54 +11:00
AP_Param AP_Param: print length of defaults list as part of key dump 2023-01-24 10:16:56 +11:00
AP_PiccoloCAN all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_Proximity AP_Proximity: Add DroneCAN backend 2022-12-15 07:20:05 +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: reduce scope for WITH_SEMAPHORE 2022-07-17 21:42:33 +10:00
AP_RangeFinder AP_RangeFinder: skip GPIO arming check on analog backend 2022-12-13 12:06:06 +11:00
AP_RCMapper all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_RCProtocol AP_RCProtocol: iterate over array size rather than to last entry 2023-01-25 09:14:16 +11:00
AP_RCTelemetry AP_RCTelemetry: report CRSF link rate rather than mode. 2022-12-22 18:38:31 +00: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_RTC: fix oldest_acceptable_date to be in micros 2022-02-10 09:22:30 +11:00
AP_SBusOut all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_Scheduler AP_Scheduler: added ticks32() API 2023-01-29 15:28:43 +11:00
AP_Scripting AP_Scripting:fix duplicate function in Script_Controller 2023-01-31 10:10:12 +11:00
AP_SerialLED AP_SerialLED: enable 32 servo outs 2022-05-22 12:07:37 +10:00
AP_SerialManager AP_SerialManager: Add 2Mbps for simulator 2023-01-03 12:52:07 +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: change namespace of MultiCopter and FixedWing params 2022-11-09 19:04:37 +11:00
AP_Stats
AP_TECS AP_Landing: Add Landing Max Throttle Option 2023-01-24 10:19:56 +11: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: only include GCS_MAVLink if terrain is enabled 2023-01-03 10:47:28 +11:00
AP_Torqeedo AP_Torqeedo : correct comment spelling 2022-05-24 20:27:45 +09:00
AP_Tuning AP_Tuning: tidy includes 2022-05-03 09:14:58 +10:00
AP_UAVCAN AP_UAVCAN: tidy includes of SRV_Channel.h 2023-01-25 22:30:55 +11:00
AP_Vehicle AP_Vehicle: use minimize.inc for Tramp and SmartAudio 2023-01-24 11:03:27 +11:00
AP_VideoTX AP_VideoTX: use minimize.inc for Tramp and SmartAudio 2023-01-24 11:03:27 +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: tidy includes of SRV_Channel.h 2023-01-25 22:30:55 +11:00
AP_WindVane AP_WindVane: add Arduino script and readme to allow conection to Bluetooth wind-vane 2022-12-20 12:13:46 +11:00
APM_Control AMP_Control: Roll and Pitch Controller: don't reset pid_info.I in reset_I calls 2023-01-17 11:19:39 +11: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: add accessors for accel and jerk limits 2022-09-06 11:23:51 +09:00
doc
Filter Filter: save freq_min_ratio when saving parameters 2023-01-31 10:58:12 +11:00
GCS_MAVLink GCS_MAVLink: add documentation for logged MAV stats Flags 2023-01-25 19:50:34 +11:00
PID PID: use new defualt pattern 2023-01-24 10:16:56 +11:00
RC_Channel RC_Channel: use FieldBitmaskEnum and FieldValueEnum 2023-01-25 19:50:34 +11:00
SITL SITL: new XPlane backend 2023-01-31 11:22:08 +11:00
SRV_Channel SRV_Channel: narrow include for configuration 2023-01-25 22:30:55 +11:00
StorageManager StorageManager: change namespace of MultiCopter and FixedWing params 2022-11-09 19:04:37 +11:00