ardupilot/libraries
Peter Barker 7b83ccfdd1 AP_HAL_SITL: change SITL unbuffered writes to more-closely minim ChibiOS HAL
We don't ever actually do unbuffered writes in ChibiOS.  We just poke the relevant thread to say there's data available.  This kind of mimics that my instantly evoking the same routine the timer-tick method does, which may or may not get all of the bytes out in good order.
2023-07-26 17:06:27 +10:00
..
AC_AttitudeControl AC_AttitudeControl: allow AP_SCRIPTING_ENABLED to come from hwdef files 2023-06-09 16:10:52 +10:00
AC_AutoTune AC_AutoTune: remove unsued variables 2023-07-13 11:02:40 +10:00
AC_Autorotation
AC_Avoidance AC_Avoidance: make _output_level AP_Enum 2023-05-15 09:25:57 +10:00
AC_CustomControl AC_CustomControl_PID: set false to avoid hitting limits 2023-06-20 10:50:11 +10:00
AC_Fence
AC_InputManager
AC_PID
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: limit and zero velocity I-term 2023-07-05 20:27:54 +09: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: comment to clarify get-velocity-NED units 2023-07-18 21:02:02 +09: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: tidy AP_Airspeed includes, use AP_AIRSPEED_ENABLED properly 2023-07-18 11:03:07 +10:00
AP_Arming AP_Arming:change metatdata for ARMING_REQUIRE 2023-07-18 11:35:55 +10:00
AP_Avoidance
AP_BLHeli AP_BLHeli: add battery status MSP handling 2023-07-05 15:39:15 +01:00
AP_Baro AP_Baro: add and use AP_BARO_ENABLED 2023-06-21 22:28:48 +10:00
AP_BattMonitor AP_BattMonitor: remove unsued variables 2023-07-13 11:02:40 +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: add accessor for param BRD_SERIAL_NUM 2023-07-04 13:35:09 -07:00
AP_Button
AP_CANManager AP_CANManager: moved UART port locking up to AP_HAL 2023-07-12 17:06:02 +10:00
AP_CSVReader
AP_Camera AP_Camera: mount backend implements set_tracking 2023-07-18 21:02:02 +09:00
AP_CheckFirmware AP_CheckFirmware: fixed error code for bad firmware 2023-07-09 18:11:54 +10:00
AP_Common AP_Common: removed set_blocking_writes 2023-07-12 17:06:02 +10:00
AP_Compass AP_Compass: stop auto replacing missing CAN by default, add option to re-enable 2023-06-27 09:24:41 +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: fix reliable stream buffer size 2023-07-19 16:59:38 +09:00
AP_Declination
AP_Devo_Telem
AP_DroneCAN AP_DroneCAN: add support for sending CAN and Protocol Stats 2023-07-10 12:56:37 +10:00
AP_EFI EFI: added efi MavLink class 2023-07-11 12:32:19 +10:00
AP_ESC_Telem AP_ESC_Telem: Raise default timeout for the RPM spin check to 210ms 2023-06-20 09:30:03 +10:00
AP_ExternalAHRS AP_ExternalAHRS: Use sparse-endian be32to<ftype>_ptr 2023-06-05 09:09:13 +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_FlashIface: support OctoSPI flash correctly 2023-04-28 08:31:15 +10:00
AP_FlashStorage
AP_Follow AP_Follow: remove unused variables 2023-07-13 11:02:40 +10:00
AP_Frsky_Telem
AP_GPS AP_GPS: use AP_AHRS_ENABLED in place of HAL_BUILD_AP_PERIPH 2023-07-04 10:27:32 +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: added set_size_best() for ByteBuffer 2023-07-18 11:38:27 +10:00
AP_HAL_ChibiOS hwdef: added SIYI NY flight controller 2023-07-24 17:25:29 +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: change SITL unbuffered writes to more-closely minim ChibiOS HAL 2023-07-26 17:06:27 +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: removed set_blocking_writes 2023-07-12 17:06:02 +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_InternalError: imu resets aren't fatal on esp32 2023-05-02 14:38:03 +10:00
AP_JSButton AP_JSButton: add unittest 2023-06-07 17:16:15 +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_LTM_Telem AP_LTM_Telem: use minimize_features.inc for more features 2023-06-06 10:14:02 +10:00
AP_Landing AP_Landing: set FW landing speed if not set 2023-07-04 10:24:30 +10:00
AP_LandingGear
AP_LeakDetector
AP_Logger AP_Logger: add Write_NamedValueFloat 2023-07-18 11:34:31 +10:00
AP_MSP AP_MSP: use minimize.inc for HAL_MSP_ENABLED and dependencies 2023-06-14 17:44:13 +10:00
AP_Math AP_Math: define M_PI to more digits for use by code that uses DOUBLE_PRECISION_SOURCES 2023-07-18 11:06:02 +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: Example: Test: allow to run on heliquad 2023-07-18 08:05:26 +09:00
AP_Mount AP_Mount: viewpro and xacti only enabled on boards 2mb flash 2023-07-18 21:02:02 +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: fix docs on ABIAS_P_NSE_DEFAULT 2023-07-14 08:33:05 +09:00
AP_Navigation
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: initialize structures correctly 2023-07-13 11:02:40 +10: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: remove unused 2023-06-14 17:58:43 +10: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: add missing include for I2cDevice.h 2023-07-11 10:30:02 +09:00
AP_Relay AP_Relay: add option to disable relay and servorelay libraries 2023-06-20 09:36:39 +10:00
AP_RobotisServo
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: viewpro driver comment fix 2023-07-18 21:02:02 +09:00
AP_SerialLED
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: create and use AP_BATTERY_ENABLED 2023-06-21 22:28:48 +10:00
AP_Terrain AP_Terrain: assume HAL_BOARD_TERRAIN_DIRECTORY is defined 2023-07-19 17:25:18 +09:00
AP_Torqeedo
AP_Tuning
AP_Vehicle AP_Vehicle: dynamic notch use min ratio for RPM tracking 2023-07-18 11:32:39 +10:00
AP_VideoTX
AP_VisualOdom AP_VisualOdom: Check for driver availability first 2023-07-03 19:22:52 +10: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-07-18 11:06:02 +10:00
GCS_MAVLink GCS_MAVLink: rely on item conversion to run DO_SET_ROI_NONE when presented in COMMAND_LONG 2023-07-19 17:03:00 +09:00
PID
RC_Channel RC_Channel:clean up metadata for AUX switches 2023-07-21 11:16:47 +10:00
SITL SITL: remove unused variables 2023-07-13 11:02:40 +10:00
SRV_Channel SRV_Channel: allow scaled passthru to go to trim on rc failsafe 2023-06-29 21:37:12 +10:00
StorageManager
doc
COLCON_IGNORE Tools: add COLCON_IGNORE to modules and libraries 2023-04-19 18:34:15 +10:00