Ardupilot2/libraries
Andrew Tridgell fe7e2ed657 AP_Scripting: added throttle and height controller to aerobatic example
changed rolling circle to take the radius and number of
circles. negative radius for negative yaw rate and negative number of
circles for left roll
2021-12-07 10:33:13 +11:00
..
AC_AttitudeControl AC_PosControl: minor formatting fix 2021-12-01 08:54:34 +09:00
AC_Autorotation
AC_AutoTune AC_AutoTune: INAV rename for neu & cm/cms 2021-11-30 10:08:07 +11:00
AC_Avoidance AC_Avoid: Convert Dijkstras to A-star 2021-11-16 15:08:16 +09:00
AC_Fence AC_Fence: void index when overwriting fence count on fencepoint-close 2021-11-30 20:50:32 +11:00
AC_InputManager
AC_PID AC_PID: P 1D, P 2D: remove unused limit flags 2021-11-23 13:49:02 +09:00
AC_PrecLand
AC_Sprayer AC_Sprayer: use vector.xy().length() instead of norm(x,y) 2021-09-14 10:43:46 +10:00
AC_WPNav AC_WPNav: INAV rename for neu & cm/cms 2021-11-30 10:08:07 +11:00
AP_AccelCal AP_AccelCal: move from HAL_NO_GCS to HAL_GCS_ENABLED 2021-09-22 21:37:00 +10:00
AP_ADC
AP_ADSB AP_ADSB: bugfix vertical velocity sign was backwards 2021-10-28 09:51:33 +11:00
AP_AdvancedFailsafe
AP_AHRS AP_AHRS: fixed switching airspeed sensor based on EKF3 affinity 2021-11-24 13:52:13 +11:00
AP_Airspeed AP_Airspeed: add date for parameter conversion code 2021-11-23 12:27:14 +00:00
AP_AIS AP_AIS: Make the char_to_hex method a common method 2021-11-09 10:16:25 +11:00
AP_Arming AP_Arming: support Benewake CAN 2021-11-30 09:49:20 +11:00
AP_Avoidance AC_Avoidance: Add APM_BUILD_Heli 2021-09-29 19:55:48 +10:00
AP_Baro AP_Baro: add option to set BARO_EXT_BUS default value 2021-10-11 17:57:52 -03:00
AP_BattMonitor AP_BattMonitor: added VLT_OFFSET for analog 2021-11-17 19:09:40 +11:00
AP_Beacon AP_Beacon: have nooploop use base-class uart instance 2021-11-02 11:19:18 +11:00
AP_BLHeli AP_BLHeli: convert APM_BUILD_COPTER_OR_HELI() to APM_BUILD_COPTER_OR_HELI 2021-10-26 11:42:12 +11:00
AP_BoardConfig AP_BoardConfig: correct va_list memory over-read error 2021-11-23 11:46:09 +11:00
AP_Button AP_Button: update FUNx values 2021-09-21 09:36:24 +10:00
AP_Camera AP_Camera: don't use stale image number in CAMERA_FEEDBACK 2021-11-17 18:48:00 +11:00
AP_CANManager AP_CANManager: support Benewake CAN 2021-11-30 09:49:20 +11:00
AP_Common Location: get_vector_from_origin gets units comment 2021-12-01 09:03:40 +09:00
AP_Compass AP_Compass: revert compass parameter changes 2021-12-04 16:51:53 +11:00
AP_DAL AP_DAL: support 9 uarts 2021-11-22 22:48:59 +11:00
AP_Declination
AP_Devo_Telem AP_Devo_Telem: compile out devo telemetry 2021-12-01 19:16:44 +11:00
AP_EFI
AP_ESC_Telem
AP_ExternalAHRS AP_ExternalAHRS: factor substring from allocation_error parameter 2021-10-18 12:49:44 +11:00
AP_FETtecOneWire AP_FETtecOneWire: rely on AP_FETTEC_ONEWIRE_ENABLED being set in hwdef.h 2021-11-24 12:01:22 +11:00
AP_Filesystem AP_FileSystem: mention of HAL_CRASH_DUMP_FLASHPAGE not required 2021-12-01 18:17:50 +11:00
AP_FlashIface
AP_FlashStorage AP_FlashStorage: support L496 MCUs 2021-09-24 18:08:00 +10:00
AP_Follow
AP_Frsky_Telem AP_Frsky_Telem: move from ENABLE_SCRIPTING to AP_SCRIPTING_ENABLED 2021-11-15 20:27:40 +11:00
AP_Generator AP_Gererator: IE Fuel Cell: reset health timer at init 2021-10-08 19:34:34 -04:00
AP_GPS AP_GPS_UBLOX: tidy reading of uart data 2021-11-09 10:31:25 +11:00
AP_Gripper
AP_GyroFFT AP_GyroFFT: convert APM_BUILD_COPTER_OR_HELI() to APM_BUILD_COPTER_OR_HELI 2021-10-26 11:42:12 +11:00
AP_HAL AP_HAL: tidy set/get of hw RTC 2021-12-06 12:58:43 +11:00
AP_HAL_ChibiOS hwdef: added CarbonixL496 AP_Periph node 2021-12-07 10:23:54 +11:00
AP_HAL_Empty AP_HAL_Empty: support up to 9 UARTs 2021-11-22 22:48:59 +11:00
AP_HAL_ESP32 AP_HAL_ESP32: revert compass parameter changes 2021-12-04 16:51:53 +11:00
AP_HAL_Linux AP_HAL_Linux: tidy set/get of hw RTC 2021-12-06 12:58:43 +11:00
AP_HAL_SITL AP_HAL_SITL: remove unused _home_str member 2021-12-07 09:36:22 +11:00
AP_Hott_Telem AP_Hott_Telem: cope with BARO_MAX_INSTANCES = 1 2021-09-29 10:51:14 +10:00
AP_ICEngine
AP_InertialNav AP_InertialNav: rename for neu & cm/cms 2021-11-30 10:08:07 +11:00
AP_InertialSensor AP_InertialSensor: for all Cubes ensure use of non-isolated IMU 2021-11-30 10:20:54 +11:00
AP_InternalError AP_InternalError: change panic to return error code as string in SITL 2021-09-28 09:11:48 +10:00
AP_IOMCU AP_IOMCU: fix ADC scaling on IOMCU 2021-11-16 14:12:43 +11:00
AP_IRLock
AP_JSButton
AP_KDECAN
AP_L1_Control AP_L1_Control: remove SpdHgt and use TECS direct 2021-11-13 08:05:39 +11:00
AP_Landing AP_Landing: remove SpdHgt and use TECS direct 2021-11-13 08:05:39 +11:00
AP_LandingGear AP_LandingGear: add enable param 2021-11-23 11:40:44 +11:00
AP_LeakDetector AP_LeakDetector: check for valid analog pin 2021-10-06 18:42:51 +11:00
AP_Logger AP_Logger: turn dataflash logging off by default 2021-11-24 13:23:40 +11:00
AP_LTM_Telem
AP_Math AP_Math: update_pos_vel_accel methods accept limit as const reference 2021-12-01 12:45:46 +09:00
AP_Menu
AP_Mission AP_Mission: Decode MAV_CMD_DO_PAUSE_CONTINUE commands 2021-11-25 08:18:27 +09:00
AP_Module
AP_Motors AP_Motors: add spool down complete flag 2021-12-05 22:12:13 -05:00
AP_Mount AP_Mount: add handle_global_position_int() method to backend and use it + little spelling 2021-10-08 14:22:43 +11:00
AP_MSP AP_MSP: factor code in init method 2021-10-28 20:37:24 +11:00
AP_NavEKF
AP_NavEKF2 AP_NavEKF2: revert compass parameter changes 2021-12-04 16:51:53 +11:00
AP_NavEKF3 AP_NavEKF3: revert compass parameter changes 2021-12-04 16:51:53 +11:00
AP_Navigation
AP_NMEA_Output AP_NMEA_Output: use vector.xy().length() instead of norm(x,y) 2021-09-14 10:43:46 +10:00
AP_Notify AP_Notify: make the buzzer pin configurable on all boards 2021-11-18 15:22:03 +11:00
AP_OLC
AP_ONVIF AP_ONVIF: use correct #pragma GCC diagnostic pop 2021-09-29 17:27:29 +10:00
AP_OpticalFlow
AP_OSD AP_OSD: convert APM_BUILD_COPTER_OR_HELI() to APM_BUILD_COPTER_OR_HELI 2021-10-26 11:42:12 +11:00
AP_Parachute AP_Parachute: added arming check for chute released 2021-11-18 15:21:15 +11:00
AP_Param AP_Param: simplify set_defaults_from_table error path 2021-11-22 22:43:02 +11:00
AP_PiccoloCAN
AP_Proximity AP_Proximity: Add Cygbot D1 2021-12-03 08:02:50 +09:00
AP_Radio
AP_Rally AP_Rally: convert APM_BUILD_COPTER_OR_HELI() to APM_BUILD_COPTER_OR_HELI 2021-10-26 11:42:12 +11:00
AP_RAMTRON
AP_RangeFinder AP_RangeFinder: fixed support for multiple Benewake_CAN CAN lidars 2021-12-04 16:31:35 +11:00
AP_RCMapper
AP_RCProtocol AP_RCProtocol: process CRSF crc per-byte 2021-12-01 19:04:19 +11:00
AP_RCTelemetry AP_CRSF_Telem: adjusted status text frame size based on actually used bytes 2021-11-01 21:32:24 +11:00
AP_Relay AP_Relay: update param description to inclde IOMCU 2021-09-28 09:40:25 +10:00
AP_RobotisServo
AP_ROMFS
AP_RPM
AP_RSSI AP_RSSI: fix ADC scaling on IOMCU 2021-11-16 14:12:43 +11:00
AP_RTC AP_RTC: move from HAL_NO_GCS to HAL_GCS_ENABLED 2021-09-22 21:37:00 +10:00
AP_SBusOut
AP_Scheduler AP_Scheduler: allow specification of Scheduler table priorities 2021-11-17 19:00:04 +11:00
AP_Scripting AP_Scripting: added throttle and height controller to aerobatic example 2021-12-07 10:33:13 +11:00
AP_SerialLED AP_SerialLED: removed empty constructors 2021-11-01 10:24:40 +11:00
AP_SerialManager AP_SerialManager: support up to 9 UARTs 2021-11-22 22:48:59 +11:00
AP_ServoRelayEvents
AP_SmartRTL
AP_Soaring AP_Soaring: remove SpdHgt and use TECS direct 2021-11-13 08:05:39 +11:00
AP_Stats
AP_TECS AP_TECS: Connsider throttle saturation in height demand limiting 2021-11-25 15:02:09 +11:00
AP_TempCalibration
AP_TemperatureSensor
AP_Terrain AP_Terrain: cast result of labs to unsigned 2021-11-30 10:16:01 +11:00
AP_Torqeedo AP_Torqeedo: simplify conversion of master error code into string 2021-12-06 14:50:15 +11:00
AP_ToshibaCAN
AP_Tuning AP_Tuning: add options to prevent spamming tuning error messages 2021-09-21 07:56:19 +09:00
AP_UAVCAN AP_UAVCAN: removed old vendor DSDL and add README.md 2021-12-06 20:17:02 +11:00
AP_Vehicle AP_Vehicle: clean up short failsafe 2021-12-07 10:09:33 +11:00
AP_VideoTX
AP_VisualOdom AP_VisualOdom: removed empty constructors 2021-10-31 09:47:12 +11:00
AP_Volz_Protocol
AP_WheelEncoder AP_WheelEncoder: quadrature spelling changed 2021-10-27 16:03:06 +11:00
AP_Winch AP_Winch: use floats for get/set output scaled 2021-10-20 18:29:58 +11:00
AP_WindVane AP_WindVane: fix ADC scaling on IOMCU 2021-11-16 14:12:43 +11:00
APM_Control APM_Control: tweaks from review feedback 2021-11-30 16:19:26 +11:00
AR_Motors AP_MotorsUGV: make pwm_type private and add is_digital_pwm_type method 2021-10-06 18:59:57 +11:00
AR_WPNav AR_WPNav: minor comment improvement 2021-12-01 08:54:18 +09:00
doc
Filter Filter: set output slew rate to zero when max is zero. 2021-11-11 08:13:23 +09:00
GCS_MAVLink AP_Devo_Telem: compile out devo telemetry 2021-12-01 19:16:44 +11:00
PID
RC_Channel RC_Channel: added QRTL mode on a switch 2021-12-02 08:29:07 +11:00
SITL SITL: revert compass parameter changes 2021-12-04 16:51:53 +11:00
SRV_Channel SRV_Channel: correct casting of servo function number 2021-11-30 10:32:16 +11:00
StorageManager StorageManager: fix storage manager counts and merge common areas 2021-11-10 19:03:59 +11:00