ardupilot/libraries
Andy Piper 9f30d01561 AP_HAL_ChibiOS: bdshot for f103 iofirmware
add support to tell if shared DMA channel is actually shared
avoid starting and stopping the timer peripheral with bdshot
ensure that rcout DMA allocation and deallocation happens entirely within the lock
increase rcout thread working area for bdshot
fix mode mask that is sent to the iomcu
ensure iomcu rcout thread gets timeouts for callbacks
control bdshot input and output line levels on f103
use input capture channel pairs to read rising and falling edges of telemetry on f103
reset channel pairs together on iomcu
generalize the bdshot input path to support suitable buffer sizes for iomcu
generalize DMAR reading of CCR registers to read two at a time on iomcu
enable bi-directional dshot channels on PWM1-4 on iomcu
add methods to directly access erpm values from rcout
update erpm mask and esc telemetry correctly for firmware supporting dshot
add support for propagating bdmask to iomcu
dshot commands to all channels need to be aware of iomcu
ensure esc type is propagated to iomcu
cope with iomcu channel numbering when using EDT
ensure pwm driver is reset properly for dshot commands on iomcu
correctly reset pwm for dshot commands
correctly mask off bdshot bits going to iomcu
don't reset GPIO modes on disabled lines
don't reset pwm_started when sharing DMA channels
set thread name on iomcu rcout and reduce stack size on iomcu
ensure that bdshot pulses with no response are handled correctly
correctly setup DMA for input capture on f103
deal with out of order captured bytes when decoding bdshot telemetry
ensure DMA sharing on f103 does not pull lines low
only disable the timer peripheral when switching DMA channels on iomcu
add support for waiting for _UP to finish before proceeding with dshot
re-order iomcu dshot channels to let TIM4_UP go first
ensure that a cascading event will always come when expected on rcout
allow timeouts when using cascading dshot
always rotate telemetry channel after trying to capture input
cater for both in order and out-of-order bdshot telemetry packets
cope with reversed packets when decoding bdshot telemetry
ensure UP DMA channel is fully free on iomcu before starting next dshot cycle
refactor rcout for iofirmware into separate file
2023-12-18 19:02:52 +11:00
..
AC_AttitudeControl AC_AttitudeControl: correct compilation when GCS library not available 2023-12-12 11:41:47 +11:00
AC_Autorotation AC_Autorotation: Fix some typos 2023-10-12 18:30:42 +11:00
AC_AutoTune AC_AutoTune: add and use header guards 2023-12-12 11:36:15 +11:00
AC_Avoidance AC_Avoidance: Fix some typos 2023-10-12 18:30:42 +11:00
AC_CustomControl AP_CustomControl: use base class AC_AttitudeControl object 2023-12-05 08:08:09 +09:00
AC_Fence AC_Fence: Fix some typos 2023-10-12 18:30:42 +11:00
AC_InputManager
AC_PID AC_PID: use AP_Filter for notch configuration 2023-11-21 13:26:23 +11:00
AC_PrecLand AC_PrecLand: Fix some typos 2023-10-12 18:30:42 +11:00
AC_Sprayer AC_Sprayer: Fix some typos 2023-10-12 18:30:42 +11:00
AC_WPNav AC_WPNav: Fix some typos 2023-10-12 18:30:42 +11:00
AP_AccelCal AP_AccelCal: Fix some typos 2023-10-12 18:30:42 +11:00
AP_ADC AP_ADC: Console output can be disabled 2022-05-17 09:53:06 +10:00
AP_ADSB AP_ADSB: create and use AP_MAVLINK_MSG_UAVIONIX_ADSB_OUT_STATUS_ENABLED 2023-11-21 13:21:13 +11:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: make GCS failsafe timeout a parameter 2023-09-13 18:06:28 +10:00
AP_AHRS AP_AHRS: use EKFType enum class in set_ekf_type() 2023-12-17 09:47:30 +11:00
AP_Airspeed AP_Airspeed: support external AHRS airspeed sensor 2023-12-17 09:47:30 +11:00
AP_AIS AP_AIS: Fix some typos 2023-10-12 18:30:42 +11:00
AP_Arming AP_Arming: correct compilation when AP_Vehicle not available 2023-12-13 18:34:40 +11:00
AP_Avoidance AP_Avoidance: correct compilation when HAL_GCS_ENABLED is false 2023-12-12 11:41:47 +11:00
AP_Baro AP_Baro: Returns directly calculated values 2023-11-18 12:18:36 +11:00
AP_BattMonitor AP_BattMonitor: fixed battery percentage with aux info 2023-11-27 13:02:46 +11:00
AP_Beacon AP_Beacon: fix example when Beacon not available 2023-10-17 18:21:04 +11:00
AP_BLHeli AP_BLHeli: add accessor for motor poles and telemetry rate 2023-12-18 19:02:52 +11:00
AP_BoardConfig AP_BoardConfig: add arm/disarm controlled GPIO for module power control 2023-11-18 14:27:05 +11:00
AP_Button AP_Button: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_Camera AP_Camera: Add Camera_Mount handler for CAMERA_CAPTURE_STATUS request 2023-11-09 13:00:57 +09:00
AP_CANManager AP_CANManager: support CAN_Dn_PROTOCOL2 for an aux 11 bit protocol 2023-11-28 11:38:16 +11:00
AP_CheckFirmware AP_CheckFirmware: fixed error code for bad firmware 2023-07-09 18:11:54 +10:00
AP_Common AP_Common: Fix some typos 2023-10-12 18:30:42 +11:00
AP_Compass AP_Compass: use tesla conversion from AP_Math/definitions.h 2023-12-17 09:47:30 +11:00
AP_CSVReader
AP_CustomRotations
AP_DAL AP_DAL: correct compilation when AP_Vehicle not available 2023-12-13 18:34:40 +11:00
AP_DDS AP_DDS: Add instructions for running HW test 2023-11-22 21:44:35 -08:00
AP_Declination AP_Declination: update magnetic field tables 2023-01-03 11:01:32 +11:00
AP_Devo_Telem
AP_DroneCAN AP_DroneCAN: support an aux 11 bit protocol with DroneCAN 2023-11-28 11:38:16 +11:00
AP_EFI AP_EFI : Hirth Driver Addition 2023-11-17 13:09:02 +11:00
AP_ESC_Telem AP_ESC_Telem: don't set up parameters on iofirmware 2023-12-18 19:02:52 +11:00
AP_ExternalAHRS AP_ExternalARHS: Don't offer IMU by default 2023-12-18 16:03:35 +11:00
AP_ExternalControl AP_ExternalControl: Add WARN_IF_UNUSED 2023-11-01 18:30:54 +11:00
AP_FETtecOneWire AP_FETtecOneWire: fixed build on periph 2023-08-24 13:06:40 +10:00
AP_Filesystem AP_RTC: fixed build on arm 2023-12-11 18:00:38 +11:00
AP_FlashIface AP_FlashIface: Fix some typos 2023-10-12 18:30:42 +11:00
AP_FlashStorage AP_FlashStorage: Fix some typos 2023-10-12 18:30:42 +11:00
AP_Follow AP_Follow: correct defaulting of AP_FOLLOW_ENABLED 2023-12-08 22:52:18 +11:00
AP_Frsky_Telem AP_Frsky_Telem: Fix some typos 2023-10-12 18:30:42 +11:00
AP_Generator AP_Gernerator: FuelCell: rework error check to give error cleared msg 2023-11-28 11:27:14 +11:00
AP_GPS Revert "AP_GPS: GSOF robust config parsing" 2023-11-28 16:09:46 +11:00
AP_Gripper AP_Gripper: Fix some typos 2023-10-12 18:30:42 +11:00
AP_GyroFFT AP_GyroFFT: Fix some typos 2023-10-12 18:30:42 +11:00
AP_HAL AP_HAL: add methods to directly access erpm array from rcout 2023-12-18 19:02:52 +11:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: bdshot for f103 iofirmware 2023-12-18 19:02:52 +11:00
AP_HAL_Empty AP_HAL_Empty: introduce get_HAL_mutable() to complement get_HAL() 2023-11-28 08:24:25 +11:00
AP_HAL_ESP32 AP_HAL_ESP32: introduce get_HAL_mutable() to complement get_HAL() 2023-11-28 08:24:25 +11:00
AP_HAL_Linux AP_HAL_Linux: add can-zero board 2023-12-05 07:41:06 -06:00
AP_HAL_SITL HAL_SITL: added InertialLabs simulator 2023-12-17 09:47:30 +11:00
AP_Hott_Telem AP_Hott_Telem: allow for compilation without AP_RTC_ENABLED 2023-10-11 19:17:27 +11:00
AP_ICEngine AP_ICEngine: support relay for ignition and I2C for starter 2023-11-17 13:09:02 +11:00
AP_InertialNav AP_InertialNav: freeze horiz_vel when !velned_ok 2023-12-05 10:44:37 +11:00
AP_InertialSensor AP_InertialSensor: added support for writing raw IMU data to a UART 2023-11-30 07:05:02 +11:00
AP_InternalError AP_InternalError: improve gating of use of AP_InternalError library 2023-08-17 09:16:46 +10:00
AP_IOMCU AP_IOMCU: bdshot for iomcu 2023-12-18 19:02:52 +11:00
AP_IRLock
AP_JSButton AP_JSButton: reserve 4 button functions for script access 2023-09-27 08:14:36 +10:00
AP_KDECAN AP_KDECAN: move and rename CAN Driver_Type enumeration 2023-04-20 08:53:46 +10:00
AP_L1_Control AP_L1_Control: check vehicle yaw (heading) and ground track agree 2023-09-05 10:07:14 +10:00
AP_Landing AP_Landing: correct compilation when GCS library not available 2023-12-12 11:41:47 +11: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 compilation with AP_RSSI disabled 2023-12-13 18:30:32 +11:00
AP_LTM_Telem AP_LTM_Telem: use minimize_features.inc for more features 2023-06-06 10:14:02 +10:00
AP_Math AP_Math: added crc_sum_of_bytes_16() 2023-12-17 09:47:30 +11:00
AP_Menu
AP_Mission AP_Mission: correct compilation when RC_Channel not enabled 2023-12-12 14:52:36 +11:00
AP_Module
AP_Motors AP_Motors: correct compilation when GCS library not available 2023-12-12 11:41:47 +11:00
AP_Mount AP_Mount: validate modes before setting them 2023-11-17 11:45:38 +11:00
AP_MSP AP_MSP: add and use AP_RSSI_ENABLED 2023-12-12 11:37:57 +11:00
AP_NavEKF AP_NavEKF: fallback to no baro on boards that have no baro 2023-08-23 18:25:26 +10:00
AP_NavEKF2 AP_NavEKF2: fixed velocity reset on AID_NONE 2023-06-26 18:09:31 +10:00
AP_NavEKF3 AP_NavEKF3: do not use fmaxF on floating point values 2023-09-12 09:47:17 +10:00
AP_Navigation AP_Navigation: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_Networking AP_Networking: added sendfile() 2023-12-11 18:00:38 +11:00
AP_NMEA_Output AP_NMEA_Output: allow for compilation without AP_RTC_ENABLED 2023-10-11 19:17:27 +11:00
AP_Notify AP_Notify: ensure dshot LEDs work with EDT ESCs 2023-12-18 19:02:52 +11:00
AP_OLC AP_OLC: add unit tests 2023-10-04 19:00:34 +11:00
AP_ONVIF all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_OpenDroneID AP_OpenDroneID: fix comment typo 2023-10-31 10:37:45 +11:00
AP_OpticalFlow AP_OpticalFlow: increase scaler param desc ranges 2023-11-14 10:57:30 +11:00
AP_OSD AP_OSD: correct compilation when RC_Channels library not available 2023-12-12 14:35:12 +11:00
AP_Parachute AP_Parachute: Change to Boolean value 2023-11-11 09:06:42 +09:00
AP_Param AP_Param: check dynamic param tables are avalable before adding a param 2023-11-28 11:22:43 +11:00
AP_PiccoloCAN AP_PiccoloCAN: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_Proximity AP_Proximity: Minor fixes to LD06 driver 2023-10-05 08:23:00 +11:00
AP_Radio AP_Radio: correct build of AP_Radio_bk2425 2023-04-14 20:10:11 +10:00
AP_Rally AP_Rally: add alt_frame to unused flag bits 2023-11-01 19:06:39 +11:00
AP_RAMTRON AP_RAMTRON: added PB85RS128C and PB85RS2MC 2023-03-19 17:22:53 +11:00
AP_RangeFinder AP_RangeFinder: use boolean uartdriver read method 2023-11-29 18:29:11 +11:00
AP_RCMapper
AP_RCProtocol AP_RCProtocol: rename crc_sum8 to crc_sum8_with_carry 2023-11-29 18:50:26 +11:00
AP_RCTelemetry AP_RCTelemetry: throttle CRSF request RX device info messages 2023-11-14 10:36:56 +11:00
AP_Relay AP_Relay: make set() method public 2023-11-17 13:09:02 +11:00
AP_RobotisServo libraries: fix delay after subsequent Robotis servo detections 2023-08-04 08:55:55 +10:00
AP_ROMFS
AP_RPM AP_RPM: include backend header 2023-08-22 09:09:54 +10:00
AP_RSSI AP_RSSI: add and use AP_RSSI_ENABLED 2023-12-12 11:37:57 +11:00
AP_RTC AP_RTC: added time and date APIs for lua 2023-12-11 18:00:38 +11:00
AP_SBusOut AP_SBusOut: make sbus output exactly match sbus input decoding 2023-10-13 09:42:25 +11:00
AP_Scheduler AP_Scheduler: correct compilation when AP_Vehicle not available 2023-12-13 18:34:40 +11:00
AP_Scripting AP_Scripting: update SkyPower driver to support new model 2023-12-17 14:14:20 +11:00
AP_SerialLED AP_SerialLED: return success status from send and set_RGB 2023-11-20 19:22:20 +11:00
AP_SerialManager AP_SerialManager: reserving serial protocol for Vertiq IQUART 2023-12-13 08:12:18 +09:00
AP_ServoRelayEvents AP_ServoRelayEvents: allow mavlink command of rcin scaled functions 2023-10-17 10:32:39 +11:00
AP_SmartRTL AP_SmartRTL: correct compilation when GCS library not available 2023-12-12 11:41:47 +11:00
AP_Soaring
AP_Stats AP_Stats: initialise parameter defaults 2023-11-22 21:43:00 -08:00
AP_TECS TECS: move to new using_airspeed_sensor ahrs method 2023-10-31 10:39:21 +11:00
AP_TempCalibration AP_TempCalibration: add and use AP_TEMPCALIBRATION_ENABLED 2023-11-07 07:46:24 +11:00
AP_TemperatureSensor AP_TempratureSensor: add support for analog sensor with polynomial 2023-10-04 18:28:09 +11:00
AP_Terrain AP_Terrain: add get_grid_spacing accessor 2023-11-02 15:54:37 +11:00
AP_Torqeedo AP_Torqeedo: error code reporting fix 2023-09-12 08:44:39 +10:00
AP_Tuning AP_Tuning: add and use AP_TUNING_ENABLED 2023-09-21 07:07:58 +10:00
AP_Vehicle AP_Vehicle: correct compilation when AP_Vehicle not available 2023-12-13 18:34:40 +11:00
AP_VideoTX AP_VideoTX:add additional freq bands 2023-09-13 18:05:24 +10:00
AP_VisualOdom AP_VisualOdom: correct compilation when HAL_GCS_ENABLED is false 2023-12-12 11:41:47 +11:00
AP_Volz_Protocol AP_Volz_Protocol: don't check MINIMIZE_FEATURES when also checking BOARD_FLASH_SIZE 2023-04-15 09:33:35 +10:00
AP_WheelEncoder AP_WheelEncoder: update for new AC_PID settings 2023-11-21 13:26:23 +11:00
AP_Winch AP_Winch: pos control user output fix 2023-10-31 10:37:45 +11:00
AP_WindVane AP_WindVane: correct compilation when GCS library not available 2023-12-12 11:41:47 +11:00
APM_Control AR_PosControl: no min speed when stopping 2023-11-28 12:46:46 +09:00
AR_Motors AR_Motors: correct compilation when GCS library not available 2023-12-12 11:41:47 +11:00
AR_WPNav AR_WPNav: correct missing include 2023-12-08 22:53:41 +11:00
doc
Filter Filter: fixed uint8_t bug in total filters and expand_filter_count bug 2023-11-28 18:05:37 +11:00
GCS_MAVLink GCS_MAVLink: correct compilation when AP_Vehicle disabled 2023-12-13 18:34:40 +11:00
PID
RC_Channel RC_Channel: use EKFType enum class 2023-12-17 09:47:30 +11:00
SITL SITL: added InertialLabs simulator 2023-12-17 09:47:30 +11:00
SRV_Channel SRV_Channel: fix scaled passthrough of ranges 2023-11-15 18:20:45 +11:00
StorageManager StorageManager: fixed startup crash 2023-03-12 07:15:01 +11:00
COLCON_IGNORE Tools: add COLCON_IGNORE to modules and libraries 2023-04-19 18:34:15 +10:00