ardupilot/libraries
Tarik Agcayazi 2bb8294685 AP_Winch: Fix baud rate handling
Correct baud rate is 38400. Confirmed with manufacturer, and with a winch on v1.02. Also confirmed w/ manufacturer that newest winches on v1.04 also use 38400. Removed if statement forcing baud rate of 115200 to be consistent with documentation, and to avoid issues in future if manufacturer changes baud rate again.
2023-03-04 07:59:23 +09:00
..
AC_AttitudeControl AC_Attitude:add TKOFF/LAND only weathervane option 2023-03-01 09:51:36 +11:00
AC_AutoTune AC_AutoTune: Tradheli-modify I gain for angle p and tune check 2023-01-31 10:10:59 -05:00
AC_Autorotation
AC_Avoidance AC_Avoidance: avoid using struct Location 2023-02-04 22:51:54 +11:00
AC_CustomControl AC_CustomControl: generalize pid descriptions 2022-11-22 10:55:45 +11:00
AC_Fence AC_Fence: avoid using struct Location 2023-02-04 22:51:54 +11:00
AC_InputManager
AC_PID AC_PID: AC_PI: fix param defualting 2023-02-06 08:09:13 +09:00
AC_PrecLand AC_Precland: Add option to resume precland after manual override 2023-01-31 19:56:43 +09:00
AC_Sprayer AC_Sprayer: rename the boolean passed to run method 2022-11-17 13:46:46 +09:00
AC_WPNav AC_WPNav: Allow changing circle rate without changing parameter 2023-02-15 19:14:43 +11:00
APM_Control AMP_Control: Roll and Pitch Controller: don't reset pid_info.I in reset_I calls 2023-01-17 11:19:39 +11:00
AP_ADC
AP_ADSB AP_ADSB: create AP_ADSB_config.h 2023-01-31 11:11:26 +11:00
AP_AHRS AP_AHRS: fixed earth frame accel for EKF3 with significant trim 2023-02-28 17:16:39 +11:00
AP_AIS AP_AIS: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_AccelCal AP_AccelCal: remove unneccesary includes of AP_Vehicle_Type.h 2022-11-02 18:35:48 +11:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: add and use AP_ADVANCEDFAILSAFE_ENABLED 2023-02-08 19:00:13 +11:00
AP_Airspeed AP_Airspeed: add get_calibration_state in dummy driver 2023-02-21 17:07:41 +11:00
AP_Arming AP_Arming: correct IMU gyro consistency check 2023-02-24 09:21:42 +11:00
AP_Avoidance AP_Avoidance: include required AP_Vehicle_Type header 2022-11-02 18:35:48 +11:00
AP_BLHeli AP_BLHeli: change namespace of MultiCopter and FixedWing params 2022-11-09 19:04:37 +11:00
AP_Baro AP_Baro: fix bug in alt error arming check 2023-02-10 06:46:08 +11:00
AP_BattMonitor AP_BattMonitor: change isnanf for isnan 2023-02-27 04:15:24 -08:00
AP_Beacon AP_Beacon: add and use AP_BEACON_ENABLED 2022-11-16 08:16:31 +11:00
AP_BoardConfig AP_BoardConfig: improve description of BRD_PWM_VOLT_SEL 2023-01-31 11:13:35 +11:00
AP_Button AP_Button: implement parameter CopyFieldsFrom and use it 2023-01-03 11:08:43 +11:00
AP_CANManager AP_CANManager: check for alloc failure of ObjectBuffer 2023-01-08 15:11:32 +11:00
AP_CSVReader AP_CSVReader: add simple CSV reader 2023-01-17 11:21:48 +11:00
AP_Camera AP_Camera: log image number 2023-03-01 18:18:51 +11:00
AP_CheckFirmware AP_CheckFirmware: remove GCS.h from header files 2022-11-16 18:29:07 +11:00
AP_Common AP_Common: add NMEA output to a buffer 2023-02-07 21:12:07 +11:00
AP_Compass AP_Compass: move removal of BMM150 down into hwdef 2023-03-01 18:28:29 +11:00
AP_CustomRotations
AP_DAL AP_DAL: populate `ekf_type` 2023-02-28 11:27:43 +11:00
AP_Declination AP_Declination: update magnetic field tables 2023-01-03 11:01:32 +11:00
AP_Devo_Telem AP_Devo_Telem: tidy AP_SerialManager.h includes 2022-11-08 09:49:19 +11:00
AP_EFI AP_EFI: correct EFI ignition_voltage flag values 2023-02-07 10:40:50 +11:00
AP_ESC_Telem AP_ESC_Telem: simplify AP_TemperatureSensor integration 2023-01-31 10:52:23 +11:00
AP_ExternalAHRS AP_ExternalAHRS: honour AP_COMPASS_EXTERNALAHRS_ENABLED 2023-02-22 19:40:13 +11:00
AP_FETtecOneWire AP_FETtecOneWire: change comments to not use @param 2022-12-30 09:54:09 +11:00
AP_Filesystem AP_Filesystem: rename HAL_SCHEDULER_ENABLED to AP_SCHEDULER_ENABLED 2023-02-28 11:26:04 +11:00
AP_FlashIface AP_FlashIface: change namespace of MultiCopter and FixedWing params 2022-11-09 19:04:37 +11:00
AP_FlashStorage AP_FlashStorage: fix spelling 2023-02-14 14:33:01 +00:00
AP_Follow AP_Follow: include required AP_Vehicle_Type header 2022-11-02 18:35:48 +11:00
AP_Frsky_Telem AP_Frsky_Telem: rename HAL_INS_ENABLED to AP_INERTIALSENSOR_ENABLED 2023-01-03 10:28:42 +11:00
AP_GPS AP_GPS: allow external libraries to detect CAN instance 2023-03-02 09:22:15 +11:00
AP_Generator AP_Generator: rename has_fuel_remaining to has_fuel_remaining_pct 2023-02-02 16:16:05 +11:00
AP_Gripper AP_Gripper: tidy includes of SRV_Channel.h 2023-01-25 22:30:55 +11:00
AP_GyroFFT AP_GyroFFT: change default FFT frequency range to something more useful 2023-01-24 10:56:33 +11:00
AP_HAL AP_HAL: add waf argument to get consistent builds 2023-02-17 20:48:45 +11:00
AP_HAL_ChibiOS hwdef: adjust SkyViper config for define change 2023-03-03 20:59:06 +11:00
AP_HAL_ESP32 AP_HAL_ESP32: Readme update 2023-01-31 18:00:25 +11:00
AP_HAL_Empty
AP_HAL_Linux AP_HAL_Linux: Update GPIO and RCInput for pi version change 2023-02-22 21:10:04 -08:00
AP_HAL_SITL SITL: Send VCAS in Flightgear packet. 2023-02-20 05:37:21 -08:00
AP_Hott_Telem AP_Hott_Telem: move definition of HAL_HOTT_TELEM_ENABLED to minimise include file 2022-11-08 20:23:58 +11:00
AP_ICEngine AP_ICEngine: added allow_throttle_while_disarmed() 2022-11-14 11:14:09 +11:00
AP_IOMCU AP_IOMCU: read many bytes using read(buffer, len) method 2023-02-24 09:37:20 -08:00
AP_IRLock
AP_InertialNav
AP_InertialSensor AP_InertialSensor: removed the error count on BMI088 0xff data 2023-02-28 11:28:25 +11:00
AP_InternalError AP_InternalError: add waf argument to get consistent builds 2023-02-17 20:48:45 +11:00
AP_JSButton
AP_KDECAN
AP_L1_Control AP_L1_Control: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_LTM_Telem AP_LTM_Telem: tidy AP_SerialManager.h includes 2022-11-08 09:49:19 +11:00
AP_Landing AP_Landing: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_LandingGear AP_LandingGear: make and use AP_LANDINGGEAR_ENABLED 2022-12-14 18:30:23 +11:00
AP_LeakDetector AP_LeakDetector: add manual leak-pin selection 2022-11-12 20:38:35 -03:00
AP_Logger AP_Logger: rename HAL_SCHEDULER_ENABLED to AP_SCHEDULER_ENABLED 2023-02-28 11:26:04 +11:00
AP_MSP AP_MSP: Increase DisplayPort UART TX buffer to prevent OSD corruption 2023-02-15 12:31:37 +11:00
AP_Math AP_Math: add waf argument to get consistent builds 2023-02-17 20:48:45 +11:00
AP_Menu
AP_Mission AP_Mission: replace check_instance with get_instance 2023-03-03 17:35:39 +11:00
AP_Module
AP_Motors AP_Motors: add logging of output throttle 2023-02-28 11:06:32 +11:00
AP_Mount AP_Mount: replace check_instance with get_instance 2023-03-03 17:35:39 +11:00
AP_NMEA_Output AP_NMEA_Output: add params and optimized 2023-02-07 21:12:07 +11:00
AP_NavEKF AP_NavEKF: add and use AP_BEACON_ENABLED 2022-11-16 08:16:31 +11:00
AP_NavEKF2 AP_NavEKF2: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_NavEKF3 AP_NavEKF3: include writeWheelOdom symbol even if no body-odom 2023-02-11 10:36:33 +11:00
AP_Navigation AP_Navigation: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_Notify AP_Notify: use simulated toshiba LED for display rather than directly 2023-02-28 10:24:43 +11:00
AP_OLC AP_OLC: move OSD minimised features to minimize_features.inc 2023-02-28 10:40:27 +11:00
AP_ONVIF
AP_OSD AP_OSD: move OSD minimised features to minimize_features.inc 2023-02-28 10:40:27 +11:00
AP_OpenDroneID AP_OpenDroneID: fixed static msg timing 2023-02-19 10:22:17 -08:00
AP_OpticalFlow AP_OpticalFlow: add some units to OFCA log message 2022-12-12 13:27:25 +11:00
AP_Parachute AP_Parachute: use relay singleton in Parachute 2023-01-03 10:19:54 +11:00
AP_Param AP_Param: print length of defaults list as part of key dump 2023-01-24 10:16:56 +11:00
AP_PiccoloCAN AP_PiccoloCAN: Fix ESC voltage and current telem scaling 2023-02-22 18:40:12 +11:00
AP_Proximity AP_Proximity: reduce SF45b mode filter to 3 elements 2023-03-01 18:22:22 +11:00
AP_RAMTRON
AP_RCMapper
AP_RCProtocol AP_RCProtocol: on IOMCU don't allow protocol to change once detected 2023-02-08 10:08:23 +11:00
AP_RCTelemetry AP_RCTelemetry: fixed warning with gcc 12.2 2023-02-19 13:26:54 +11:00
AP_ROMFS
AP_RPM AP_RPM: fixed SITL RPM backend for new motor mask 2022-10-16 20:38:19 +11:00
AP_RSSI
AP_RTC
AP_Radio
AP_Rally AP_Rally: include required AP_Vehicle_Type header 2022-11-02 18:35:48 +11:00
AP_RangeFinder AP_RangeFinder: Allow multiple USD-D1-CAN 2023-03-02 07:56:56 +11:00
AP_Relay AP_Relay: added get() method for scripting 2022-10-11 11:47:04 +11:00
AP_RobotisServo
AP_SBusOut
AP_Scheduler AP_Scheduler: rename HAL_SCHEDULER_ENABLED to AP_SCHEDULER_ENABLED 2023-02-28 11:26:04 +11:00
AP_Scripting Scripting: add bindings for jump tags 2023-02-28 12:00:18 +11:00
AP_SerialLED
AP_SerialManager AP_SerialManager: Add 2Mbps for simulator 2023-01-03 12:52:07 +11:00
AP_ServoRelayEvents
AP_SmartRTL
AP_Soaring AP_Soaring: change namespace of MultiCopter and FixedWing params 2022-11-09 19:04:37 +11:00
AP_Stats
AP_TECS AP_TECS: protect against low airspeed in reset 2023-02-19 10:20:03 -08:00
AP_TempCalibration
AP_TemperatureSensor AP_TemperatureSensor:correct TEMP sensor metadata 2023-01-24 11:16:51 +11:00
AP_Terrain AP_Terrain: Explicitly state that they are at the same latitude 2023-02-08 08:54:35 +11:00
AP_Torqeedo
AP_Tuning
AP_UAVCAN AP_UAVCAN: add GPS-out 2023-03-02 09:22:15 +11:00
AP_Vehicle AP_Vehicle: added set_land_descent_rate scripting method 2023-02-09 07:02:12 +11:00
AP_VideoTX AP_VideoTX: protect vtx from pitmode changes when not enabled or not armed 2023-02-15 19:30:28 +11:00
AP_VisualOdom AP_VisualOdom: handle voxl yaw and pos jump on reset 2023-01-24 11:07:02 +11:00
AP_Volz_Protocol
AP_WheelEncoder AP_WheelEncoder: Support changing update period 2022-12-13 17:10:06 +11:00
AP_Winch AP_Winch: Fix baud rate handling 2023-03-04 07:59:23 +09:00
AP_WindVane AP_WindVane: add Arduino script and readme to allow conection to Bluetooth wind-vane 2022-12-20 12:13:46 +11:00
AR_Motors AR_Motors: fix have_skid_steering to return true for omni too 2022-12-12 19:59:17 +09:00
AR_WPNav AR_WPNav: avoid using struct Location 2023-02-04 22:51:54 +11:00
Filter Filter: implement 3 element mode filter 2023-03-01 18:22:22 +11:00
GCS_MAVLink GCS_MAVLink: constrain battery % to 0-100 2023-03-02 18:07:30 +11:00
PID PID: use new defualt pattern 2023-01-24 10:16:56 +11:00
RC_Channel RC_Channel: Check when to use 2023-02-24 09:22:50 +11:00
SITL SITL: add and use SIM_RGBLED 2023-02-28 10:24:43 +11:00
SRV_Channel SRV_Channel: narrow include for configuration 2023-01-25 22:30:55 +11:00
StorageManager StorageManager: fix spelling 2023-02-14 14:33:01 +00:00
doc