ardupilot/libraries
Andy Piper 15ec9d5ab4 AP_HAL_ChibiOS: fix ESCs constantly arming on rover with dshot commands
make sure debug will compile
take into account active channels when configuring bdshot
add channel mask debug output
correct set bdshot telemetry position at startup
make sure all channels in a bdshot group are pulled high to prevent spurious pulses
2022-03-30 11:37:41 +09:00
..
AC_AttitudeControl AC_AttitudeControl: added set_lean_angle_max_cd() 2022-03-30 11:37:41 +09:00
AC_AutoTune AC_Autotune_Heli: print gains on axis completion 2022-02-23 07:44:24 +09:00
AC_Autorotation AC_Autorotation: use accel_to_angle() 2022-03-30 11:37:41 +09:00
AC_Avoidance AC_Avoidance: get Vector3f when checking all components of relpos 2022-02-02 19:09:25 +11:00
AC_Fence AC_Fence: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AC_InputManager
AC_PID AC_PID: tradheli-change param name from _VFF to _FF 2022-02-04 08:03:38 +09:00
AC_PrecLand AC_PrecLand: Change parameter to bitmask 2022-02-01 17:12:56 +09:00
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: use angle/accel functions 2022-03-30 11:37:41 +09:00
APM_Control AR_AttitudeControl: get_turn_rate_from_heading applies acceleration limit 2022-02-10 07:45:12 +09:00
AP_ADC
AP_ADSB AP_ADSB: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_AHRS AP_AHRS: add alias get_position to get_location 2022-02-18 21:23:06 +11:00
AP_AIS AP_AIS: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_AccelCal AP_AccelCal: remove unused calc_mean_squared_residuals 2022-01-26 12:03:17 +09:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: use mission singleton inside AP_AdvancedFailsafe 2021-08-03 10:35:24 +10:00
AP_Airspeed AP_Airspeed: improve description of ARSPD_TUBE_ORDR 2022-03-12 08:01:18 +09:00
AP_Arming AP_Arming: setup for terrain adjustment on arming 2022-03-30 11:37:41 +09:00
AP_Avoidance AP_Avoidance: tidy construction of vector on stack 2022-02-01 19:40:22 +11:00
AP_BLHeli AP_BLHeli: add reboot required to some parameters 2022-03-30 11:37:41 +09:00
AP_Baro AP_Baro: reformat log message to separate fields out 2022-02-28 12:47:57 +11:00
AP_BattMonitor AP_BattMonitor: fixed battery remaining of sum battery 2022-03-30 11:37:41 +09:00
AP_Beacon AP_Beacon: have nooploop use base-class uart instance 2021-11-02 11:19:18 +11:00
AP_BoardConfig AP_BoardConfig: add options for write protecting bootloader and main flash 2022-02-24 10:19:07 +11:00
AP_Button AP_Button: use CopyValuesFrom to avoid duplication 2021-12-15 09:54:06 +11:00
AP_CANManager AP_CANManager: include hal.h 2022-02-22 12:13:19 +11:00
AP_Camera AP_Camera: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_Common AP_Common: improved accuracy of get_bearing() 2022-03-12 08:01:18 +09:00
AP_Compass AP_Compass: add define for COMPASS_ENABLE 2022-02-08 10:41:02 +11:00
AP_DAL AP_DAL: prevent logical loop between AHRS and EKF 2022-02-07 14:13:49 +11:00
AP_Declination AP_Declination: ensure indexing into declination tables is always correct 2022-03-30 11:37:41 +09:00
AP_Devo_Telem AP_Devo_Telem: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_EFI AP_EFI: reserve ID for Loweheiser mavlink-connected generator 2022-01-25 09:44:41 +11:00
AP_ESC_Telem AP_ESC_Telem: correct spelling mili -> milli 2022-01-31 08:55:29 +09:00
AP_ExternalAHRS AP_ExternalAHRS: factor substring from allocation_error parameter 2021-10-18 12:49:44 +11:00
AP_FETtecOneWire AP_FETtecOneWire: correct spelling mili -> milli 2022-01-31 08:55:29 +09:00
AP_Filesystem AP_Filesystem: avoid ff.h in header 2022-02-22 12:13:19 +11:00
AP_FlashIface AP_FlashIface: add support for DTR variant of w25q found on SPRacingH7 2022-02-24 10:19:07 +11:00
AP_FlashStorage AP_FlashStorage: support L496 MCUs 2021-09-24 18:08:00 +10:00
AP_Follow AP_Follow: added APIs for plane ship landing 2022-03-12 08:01:18 +09:00
AP_Frsky_Telem AP_Frsky_Telem: Remove meaningless semicolons 2022-02-07 08:27:34 +09:00
AP_GPS AP_GPS: prevent switching to a dead GPS 2022-03-30 11:37:41 +09:00
AP_Generator AP_Generator: reserve ID for Loweheiser mavlink-connected generator 2022-01-25 09:44:41 +11:00
AP_Gripper AP_Gripper: change UAVCAN to DroneCAN in param metadata 2021-12-15 09:53:21 +11:00
AP_GyroFFT AP_GyroFFT: fix 'arm_status' shadowing a global declaration error 2022-02-16 19:05:07 +11:00
AP_HAL AP_HAL: always choose high for dshot prescaler calculation 2022-03-12 08:01:18 +09:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: fix ESCs constantly arming on rover with dshot commands 2022-03-30 11:37:41 +09:00
AP_HAL_ESP32 AP_HAL_ESP32: remove HAL_COMPASS_DEFAULT define 2022-02-01 12:10:38 +11:00
AP_HAL_Empty AP_HAL_Empty: add HAL_UART_STATS_ENABLED to disable stats gathering 2022-01-12 18:30:49 +11:00
AP_HAL_Linux HAL_Linux: support mavcan 2022-02-12 16:36:05 +11:00
AP_HAL_SITL HAL_SITL: don't use terrain adjustment 2022-03-30 11:37:41 +09:00
AP_Hott_Telem AP_Hott_Telem: add define AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11:00
AP_ICEngine AP_ICEngine: spelling and grammer fixes inc in param description 2021-08-19 10:00:16 +10:00
AP_IOMCU AP_IOMCU: rename and make enum RC_Channel::ControlType 2022-02-27 09:55:01 +11:00
AP_IRLock AP_IRLock: correct spelling mili -> milli 2022-01-31 08:55:29 +09: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: put some functions in fast ram 2022-02-09 12:47:55 +00:00
AP_InternalError AP_InternalError: change panic to return error code as string in SITL 2021-09-28 09:11:48 +10:00
AP_JSButton
AP_KDECAN
AP_L1_Control AP_L1_Control: update_waypoint wrap added to nav_bearing 2022-02-16 18:29:48 +11:00
AP_LTM_Telem AP_LTM_Telem: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_Landing AP_Landing: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +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: added terrain correction logging field 2022-03-30 11:37:41 +09:00
AP_MSP AP_MSP: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_Math AP_Math: added angle_to_accel() and accel_to_angle() 2022-03-30 11:37:41 +09:00
AP_Menu
AP_Mission AP_Mission: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_Module AP_Module: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_Motors AP_Motors: move turbine start to update_turbine_start and style cleanup 2022-02-23 14:22:47 +09:00
AP_Mount AP_Mount: mark result of get_velocity as unused 2022-02-02 19:32:47 +11:00
AP_NMEA_Output AP_NMEA_Output: use a fixed maximum number of NMEA outputs 2022-02-23 12:36:59 +11:00
AP_NavEKF AP_NavEKF: disable warnings on clang 2022-02-13 14:43:37 +11:00
AP_NavEKF2 AP_NavEKF2: update and correct GSF parameter documentation 2022-02-15 10:56:35 +11:00
AP_NavEKF3 AP_NavEKF3: fixed constrain indexing bug 2022-03-12 08:01:18 +09:00
AP_Navigation
AP_Notify AP_Notify: fixed builds 2022-02-23 21:48:58 +11:00
AP_OLC
AP_ONVIF AP_ONVIF: use correct #pragma GCC diagnostic pop 2021-09-29 17:27:29 +10:00
AP_OSD AP_OSD: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_OpticalFlow AP_OpticalFlow: Change division to multiplication 2022-02-01 17:34:40 +11:00
AP_Parachute AP_Parachute: added arming check for chute released 2021-11-18 15:21:15 +11:00
AP_Param AP_Param: fixed param class conversion code 2022-03-30 11:37:41 +09:00
AP_PiccoloCAN AP_PiccoloCAN: GPIO servo does not count as active 2022-03-12 08:01:18 +09:00
AP_Proximity AP_Proximity: change variable type from float to uint8_t 2022-02-07 08:44:09 +09:00
AP_RAMTRON
AP_RCMapper
AP_RCProtocol AP_RCProtocol: added using_uart() method 2022-03-30 11:37:41 +09:00
AP_RCTelemetry AP_RCTelemetry: add define AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11:00
AP_ROMFS
AP_RPM AP_RPM: move RPM sensor logging into AP_RPM 2022-01-11 11:09:26 +11:00
AP_RSSI AP_RSSI : Update Telemetry 2022-01-17 11:26:34 +09:00
AP_RTC AP_RTC: fix oldest_acceptable_date to be in micros 2022-02-10 09:22:30 +11:00
AP_Radio AP_Radio: fix build for skyviper-journey 2022-02-24 09:18:34 +11:00
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_RangeFinder AP_RangeFinder: correct grammar on type field 2022-02-08 10:42:56 +09:00
AP_Relay AP_Relay: update param description to inclde IOMCU 2021-09-28 09:40:25 +10:00
AP_RobotisServo AP_RobotisServo: Move crc16-ibm CRC calculation method to a common class 2022-01-13 09:44:40 +11:00
AP_SBusOut
AP_Scheduler AP_Scheduler: allow 9999us for task display 2022-02-09 12:47:55 +00:00
AP_Scripting AP_Scripting: restored corrected boolean in height_amsl binding 2022-03-30 11:37:41 +09:00
AP_SerialLED AP_SerialLED: removed empty constructors 2021-11-01 10:24:40 +11:00
AP_SerialManager AP_SerialManager: moved uart declaration to cpp file 2022-02-23 12:36:59 +11:00
AP_ServoRelayEvents
AP_SmartRTL AP_SmartRTL: rename for AHRS restructuring 2021-07-21 21:01:39 +10:00
AP_Soaring AP_Soaring: Remove meaningless semicolons 2022-02-07 08:27:34 +09:00
AP_Stats
AP_TECS AP_TECS: add reset throttle I function 2021-12-22 18:46:14 +11:00
AP_TempCalibration
AP_TemperatureSensor
AP_Terrain AP_Terrain: added logging of terrain correction 2022-03-30 11:37:41 +09:00
AP_Torqeedo AP_Torqeedo: simplify conversion of master error code into string 2021-12-06 14:50:15 +11:00
AP_ToshibaCAN AP_ToshibaCAN: correct spelling mili -> milli 2022-01-31 08:55:29 +09:00
AP_Tuning AP_Tuning: removed controller error messages 2022-02-22 12:23:48 +11:00
AP_UAVCAN AP_UAVCAN: add metadata to GetNodeInfo log message 2022-02-14 13:38:07 +11:00
AP_Vehicle AP_Vehicle: added update_target_location() 2022-03-12 08:01:18 +09:00
AP_VideoTX AP_VideoTX : fixed typo 2022-01-13 09:45:39 +11:00
AP_VisualOdom AP_VisualOdom: added VOXL backend type 2021-12-27 12:32:41 +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: add define AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11:00
AR_Motors AR_Motors: remove redundant set of throttle limit flags 2022-02-15 08:02:04 +09:00
AR_WPNav AR_WPNav: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Filter Filter: add trivial test for ModeFilter get method (float version) 2022-02-19 11:16:40 +11:00
GCS_MAVLink GCS_MAVLink: send GCS voltage to GCS 2022-03-30 11:37:41 +09:00
PID
RC_Channel RC_Channel: rename and make enum RC_Channel::ControlType 2022-02-27 09:55:01 +11:00
SITL SITL: don't use adjusted terrain in SITL 2022-03-30 11:37:41 +09:00
SRV_Channel SRV_Channel: add support for alarm servo functions 2022-02-23 18:35:43 +11:00
StorageManager StorageManager: fix write_block() comment 2021-12-17 09:53:47 +09:00
doc