ardupilot/libraries
Andy Piper ec1edea1da AP_IOMCU: add support for shared DMA to iomcu-dshot
new event-based update() loop for iomcu to allow for DMA channel sharing
spin event loop at 2Khz to give dshot thread ample access to DMA channels
correct transmission complete callbacks
ensure peripheral is re-enabled on DMA resumption
ensure DMA transactions do not get clobbered by locking
restructure callbacks for shared and non-shared DMA cases
ensure RC updates happen at 1Khz
increase expected delay at startup
2023-08-15 06:53:48 +10:00
..
AC_AttitudeControl AC_AttitudeControl: Heli: move integrate_bf_rate_error_to_angle_errors to private 2023-08-01 09:14:46 +09:00
AC_AutoTune AC_AutoTune: remove unsued variables 2023-07-13 11:02:40 +10:00
AC_Autorotation
AC_Avoidance
AC_CustomControl AC_CustomControl_PID: set false to avoid hitting limits 2023-06-20 10:50:11 +10:00
AC_Fence AC_Fence: add build_options.py option to remove fencepoint protocol 2023-08-09 17:53:54 +10:00
AC_InputManager
AC_PID AC_PID: AC_PID_2D integrates SlewCalculator2D 2023-08-01 09:16:17 +10:00
AC_PrecLand
AC_Sprayer
AC_WPNav AC_WPNav: add roi circle_option metadata 2023-07-02 13:15:20 +10:00
APM_Control AR_PosControl: add singleton and get_srate 2023-08-01 09:16:17 +10:00
AP_ADC
AP_ADSB AP_ADSB: correct bad 16bit port read in ADSB drivers 2023-07-12 08:05:29 +10:00
AP_AHRS AP_AHRS: fixed relative home functions to calculate without origin 2023-08-03 13:08:21 +10:00
AP_AIS
AP_AccelCal AP_AccellCal: initialize HAL_INS_ACCELCAL_ENABLED for periph 2023-07-04 05:41:03 -07:00
AP_AdvancedFailsafe
AP_Airspeed AP_Airspeed: increased timeout on DroneCAN airspeed data 2023-08-11 10:33:36 +10:00
AP_Arming AP_Arming: Added DDS Method for Arming/Disarming 2023-08-11 13:35:49 +10:00
AP_Avoidance
AP_BLHeli AP_BLHeli: normalize motor index correctly for iomcu running dshot 2023-08-15 06:53:48 +10:00
AP_Baro AP_Baro: add and use AP_BARO_ENABLED 2023-06-21 22:28:48 +10:00
AP_BattMonitor AP_BattMonitor: fixed reset_remaining() for INAxxx and LTC2946 2023-08-10 07:43:25 +10:00
AP_Beacon AP_Beacon: MarvelMind: avoid potentially reading INT32_MAX bytes of input 2023-07-18 11:18:47 +10:00
AP_BoardConfig AP_BoardConfig: check IOMCU is enabled when checking dshot 2023-08-15 06:53:48 +10:00
AP_Button
AP_CANManager AP_CANManager: fixed owner of SLCAN UART 2023-08-02 17:44:39 +10:00
AP_CSVReader
AP_Camera AP_Camera: MAVLinkCamV2 sends gimbal_device_id in camera_information 2023-08-10 14:37:30 +09:00
AP_CheckFirmware AP_CheckFirmware: fixed error code for bad firmware 2023-07-09 18:11:54 +10:00
AP_Common AP_Common: ensure that constants are float not double if not otherwise declared 2023-08-02 16:22:59 +01:00
AP_Compass AP_Compass: handle mag cal as both COMMAND_LONG and COMMAND_INT 2023-08-08 10:06:13 +10:00
AP_CustomRotations
AP_DAL AP_DAL: Add handlers for external lat lng position set 2023-06-06 15:19:12 +10:00
AP_DDS AP_DDS: Added ROS 2 service support 2023-08-11 13:35:49 +10:00
AP_Declination
AP_Devo_Telem
AP_DroneCAN AP_DroneCAN: get/set param timeout after 0.1 sec 2023-08-09 18:10:35 +10:00
AP_EFI EFI: added efi MavLink class 2023-07-11 12:32:19 +10:00
AP_ESC_Telem AP_ESC_Telem: Fix some time wrap issues that can lead to using stale data if a ESC stops responding 2023-08-08 09:53:48 +10:00
AP_ExternalAHRS AP_ExternalAHRS: Rename LORD to MicroStrain 2023-08-07 19:16:03 +10:00
AP_FETtecOneWire AP_FETtecOneWire: removed set_blocking_writes 2023-07-12 17:06:02 +10:00
AP_Filesystem AP_Filesystem: move AP_RTC::mktime to be ap_mktime 2023-06-27 11:25:11 +10:00
AP_FlashIface
AP_FlashStorage
AP_Follow AP_Follow: remove unused variables 2023-07-13 11:02:40 +10:00
AP_Frsky_Telem AP_Frsky_Telem: add build_options.py option to remove fencepoint protocol 2023-08-09 17:53:54 +10:00
AP_GPS AP_GPS: Switch to sparse endian to make it portable 2023-08-11 11:21:41 +10:00
AP_Generator AP_Generator: use minimize_features.inc for more features 2023-06-06 10:14:02 +10:00
AP_Gripper
AP_GyroFFT
AP_HAL AP_HAL: support accessors for dshot_period_us 2023-08-15 06:53:48 +10:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: ensure shared DMA works in IOMCU 2023-08-15 06:53:48 +10:00
AP_HAL_ESP32 AP_HAL_ESP32: moved UART port locking up to AP_HAL 2023-07-12 17:06:02 +10:00
AP_HAL_Empty AP_HAL_Empty: moved UART port locking up to AP_HAL 2023-07-12 17:06:02 +10:00
AP_HAL_Linux AP_HAL_Linux: moved UART port locking up to AP_HAL 2023-07-12 17:06:02 +10:00
AP_HAL_SITL AP_HAL_SITL: Rename LORD to MicroStrain 2023-08-07 19:16:03 +10:00
AP_Hott_Telem AP_Hott_Telem: removed set_blocking_writes 2023-07-12 17:06:02 +10:00
AP_ICEngine AP_ICEngine: allow for ICE with no RPM support 2023-05-30 07:29:55 +10:00
AP_IOMCU AP_IOMCU: add support for shared DMA to iomcu-dshot 2023-08-15 06:53:48 +10:00
AP_IRLock
AP_InertialNav AP_InertialNav: clarify get_vert_pos_rate AHRS method name to include 'D' 2023-06-06 20:09:28 +10:00
AP_InertialSensor AP_InertialSensor: create define specifically for the developer feature for killing IMUs 2023-06-07 18:23:01 +10:00
AP_InternalError
AP_JSButton AP_JSButton: add unittest 2023-06-07 17:16:15 +10:00
AP_KDECAN
AP_L1_Control AP_L1_Control: Made changes to avoid zero division in proposed formula 2023-08-01 10:01:47 +10:00
AP_LTM_Telem AP_LTM_Telem: use minimize_features.inc for more features 2023-06-06 10:14:02 +10:00
AP_Landing AP_Landing: trim LogStructure base off included code 2023-08-01 10:07:28 +10:00
AP_LandingGear AP_LandingGear: avoid use of MINIMIZE_FEATURES in AP_LandingGear_config.h 2023-08-01 10:44:59 +10:00
AP_LeakDetector
AP_Logger AP_Logger: correct use of nullptr in SITL structure sanity checks 2023-08-14 22:25:50 +10:00
AP_MSP AP_MSP: remove references to HAL_BUILD_AP_PERIPH 2023-08-09 17:39:49 +10:00
AP_Math AP_Math: do not use internal_error() on iofirmware 2023-08-15 06:53:48 +10:00
AP_Menu
AP_Mission AP_Mission: use fabsF where appropriate 2023-07-18 11:06:02 +10:00
AP_Module
AP_Motors AP_Motors: correct metadata for H_DDFP_SPIN_MIN param 2023-08-07 07:36:47 -04:00
AP_Mount AP_Mount: use backend instead of _backends[instance] 2023-08-11 07:55:05 +09:00
AP_NMEA_Output AP_NMEA_Output: add and use AP_AHRS_ENABLED 2023-06-21 22:28:48 +10:00
AP_NavEKF
AP_NavEKF2 AP_NavEKF2: fixed velocity reset on AID_NONE 2023-06-26 18:09:31 +10:00
AP_NavEKF3 AP_NavEKF3: fixed race condition in updateFilterStatus() 2023-08-12 17:47:56 +10:00
AP_Navigation
AP_Networking AP_Networking: fixed duplicate parameters in wiki 2023-08-10 13:34:14 -07:00
AP_Notify AP_Notify: fixed DroneCAN LEDs 2023-06-24 20:48:08 +10:00
AP_OLC
AP_ONVIF
AP_OSD AP_OSD: added OSD_TYPE2 param to enable dual OSDs backend support 2023-07-13 12:39:19 +10:00
AP_OpenDroneID AP_OpenDroneID: remove Chip ID as Basic ID mechanism 2023-06-17 14:49:22 +10:00
AP_OpticalFlow AP_OpticalFlow: use vector rotate method 2023-07-18 11:19:57 +10:00
AP_Parachute AP_Parachute: add option to disable relay and servorelay libraries 2023-06-20 09:36:39 +10:00
AP_Param AP_Param: allow AP_SCRIPTING_ENABLED to come from hwdef files 2023-06-09 16:10:52 +10:00
AP_PiccoloCAN AP_PiccoloCAN: remove double-definition of HAL_PICCOLOCAN_ENABLED 2023-06-09 08:00:46 +10:00
AP_Proximity AP_Proximity: Add backend for scripted Lua Driver 2023-08-03 08:02:49 +09:00
AP_RAMTRON
AP_RCMapper
AP_RCProtocol AP_RCProtocol: rescan at CRSFv3 baud rates to avoid RX loss on soft reboot 2023-07-19 16:32:36 +09:00
AP_RCTelemetry AP_RCTelemetry: remove intermediate option_is_enabled methods for RC_Channel 2023-06-14 17:39:43 +10:00
AP_ROMFS
AP_RPM AP_RPM: prepare for AP_Periph 2023-08-11 13:31:45 -07:00
AP_RSSI
AP_RTC AP_RTC: get-date-and-time returns milliseconds 2023-07-18 21:02:02 +09:00
AP_Radio
AP_Rally
AP_RangeFinder AP_RangeFinder: move rangefinder rotation default down into AP_Periph 2023-08-09 17:39:49 +10:00
AP_Relay AP_Relay: enable sending of RELAY_STATUS message 2023-08-09 07:44:07 +10:00
AP_RobotisServo libraries: fix delay after subsequent Robotis servo detections 2023-08-04 08:55:55 +10:00
AP_SBusOut AP_SBusOut: add and use AP_SBUSOUTPUT_ENABLED 2023-06-27 10:10:41 +10:00
AP_Scheduler AP_Scheduler: add and use AP_SCHEDULER_EXTENDED_TASKINFO_ENABLED 2023-06-27 10:43:39 +10:00
AP_Scripting AP_Scripting: added BattEstimate lua script 2023-08-10 07:43:25 +10:00
AP_SerialLED AP_SerialLED: configure serial LED feature based on hal availability 2023-08-15 06:53:48 +10:00
AP_SerialManager AP_SerialManager: removed set_blocking_writes_all 2023-07-12 17:06:02 +10:00
AP_ServoRelayEvents AP_ServoRelayEvents: add option to disable relay and servorelay libraries 2023-06-20 09:36:39 +10:00
AP_SmartRTL
AP_Soaring
AP_Stats
AP_TECS AP_TECS: remove unused variables 2023-07-13 11:02:40 +10:00
AP_TempCalibration
AP_TemperatureSensor AP_TemperatureSensor: add Source Pitot_tube 2023-08-11 13:20:51 -07:00
AP_Terrain AP_Terrain: fixed assumption that HOME is on the ground 2023-08-05 08:31:02 +10:00
AP_Torqeedo AP_Torqeedo: remove use of HAL_BUILD_AP_PERIPH 2023-08-09 17:39:49 +10:00
AP_Tuning
AP_Vehicle AP_Vehicle: soft reboot iomcu on soft reboot 2023-08-15 06:53:48 +10:00
AP_VideoTX
AP_VisualOdom AP_VisualOdom: Change name from position to pose 2023-08-10 13:58:00 +09:00
AP_Volz_Protocol
AP_WheelEncoder
AP_Winch
AP_WindVane AP_WindVane: Enable SITL when it is selected 2023-06-17 14:48:49 +10:00
AR_Motors AR_Motors: add option to disable relay and servorelay libraries 2023-06-20 09:36:39 +10:00
AR_WPNav
Filter Filter: fix notch filter test. 2023-08-02 16:22:59 +01:00
GCS_MAVLink GCS_MAVLink: fixed corruption of FTP reply component ID 2023-08-14 22:25:23 +10:00
PID
RC_Channel RC_Channel: add camera lens aux function 2023-07-26 20:20:13 +09:00
SITL SITL: Make SIM_Aircraft use double precision to stop SITL's short-range teleporting 2023-08-12 10:49:02 +10:00
SRV_Channel SRV_Channel: correct RC channel failsafe mask 2023-08-14 11:21:06 +10:00
StorageManager
doc
COLCON_IGNORE