Ardupilot2/libraries
Peter Barker ea7c7f9d19 AP_FETtecOneWire: complete rewrite of the ESC-configuration state machine
Co-authored-by: Dr.-Ing. Amilcar do Carmo Lucas <amilcar.lucas@iav.de>

tidy message sending using templates
Calculate and enforce the minimum update period.
Disable unused features to save flash
forced time gaps between all transmits
correct ESC reset functionality
Avoid re-initialization repeatition
Make sure we stop FETtec if safety is on (ignore reverse) this reduces duplicated code
Error count calculation changed
   as the telemetry error count is absolute only the overflow status can be safed and used for the percentage calculation
Update the README to add autotests information
FETtec needs a time gap between frames
  This allows running at high fast_loop_rates
do not send fast_throttle data if a configuration command just got sent
Example parameter configuration file is for a Quadcopter with ESCs connected to Telem2
remove two FIXME
fix compilation in master
Fix the ESC not re-initializing issue.
  Now we re-init whenever we loose connection
RVMASK parameter changes only take effect when not armed
Improve documentation
Always use the same wording when referring to fast-throttle commands
fix pre-arm check message
assure the length of the memmove is positive
Set HAL_AP_FETTEC_CONFIGURE_ESCS to 0 when no ESC hardware is available and you want to test the UART send function
2021-08-13 16:22:37 +10:00
..
AC_AttitudeControl AC_AttitudeControl: AC_PosControl: support Control: Refactor to use Jerk 2021-08-11 17:07:29 +09:00
AC_Autorotation AC_Autorotation: Add copter vehicle type to flight log metadata 2021-02-08 22:09:49 -05:00
AC_AutoTune AC_AutoTune: remove @Values from param metadata where @Bitmask exists 2021-06-23 18:37:34 +10:00
AC_Avoidance AC_Avoidance: do fence pointer check before using it 2021-08-11 13:43:23 +10:00
AC_Fence AC_Fence: remove @Values from param metadata where @Bitmask exists 2021-06-23 18:37:34 +10:00
AC_InputManager
AC_PID AC_PID: fix PID filter names FILT -> FLTE, D_FILT -> FLTD 2021-08-10 08:33:56 +09:00
AC_PrecLand AC_PrecLand: change class name from SITL::SITL to SITL::SIM 2021-08-05 07:25:31 +10:00
AC_Sprayer
AC_WPNav AC_WPNav: support Control: Refactor to use Jerk 2021-08-11 17:07:29 +09:00
AP_AccelCal AP_AccelCal: do not add accelcal if no GCS iface available 2021-06-30 17:06:02 +10:00
AP_ADC
AP_ADSB AP_ADSB: remove @Values from param metadata where @Bitmask exists 2021-06-23 18:37:34 +10:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: use mission singleton inside AP_AdvancedFailsafe 2021-08-03 10:35:24 +10:00
AP_AHRS AP_AHRS: remove pointless zeroing of gyro_estimate vector 2021-08-12 08:52:24 +10:00
AP_Airspeed AP_Airspeed: check for baro baro data in SDP3X 2021-08-10 07:10:02 +10:00
AP_AIS AP_AIS: log base station report message 2021-08-10 08:11:18 +09:00
AP_Arming AP_Arming: call fettec prearm checks 2021-08-13 16:22:37 +10:00
AP_Avoidance AP_Avoidance: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_Baro Add pressure offset based on device P-mode 2021-08-10 18:30:04 -04:00
AP_BattMonitor AP_BattMonitor: fix mppt sequence bug 2021-08-12 14:37:04 +10:00
AP_Beacon AP_Beacon: fix comparison order to prevent using wrong beacon_instance first 2021-08-11 15:17:08 +10:00
AP_BLHeli AP_BLHeli: ensure correct rotation through telemetry ESCs 2021-07-21 17:18:12 +10:00
AP_BoardConfig AP_BoardConfig: replaced Pixhawk with more appropriate wording in docs 2021-07-22 07:48:12 +10:00
AP_Button AP_Button: fixed formatting of pin arming check 2021-08-05 09:43:35 +10:00
AP_Camera AP_Camera: support RunCam Hybrid correctly 2021-06-09 17:04:27 +10:00
AP_CANManager AP_CANManager: fixed printf format errors 2021-08-05 09:43:35 +10:00
AP_Common AP_Common: tests: stop overriding non-virtual method 2021-08-05 10:37:47 +10:00
AP_Compass AP_Compass: change class name from SITL::SITL to SITL::SIM 2021-08-05 07:25:31 +10:00
AP_DAL AP_DAL: stop using AHRS as conduit for Compass pointer 2021-07-30 12:19:42 +10:00
AP_Declination
AP_Devo_Telem
AP_EFI AP_EFI: use separate register_driver method while contructing CAN Driver 2021-07-23 16:01:29 +10:00
AP_ESC_Telem AP_ESC_Telem: implement get_active_esc_mask() 2021-08-13 16:22:37 +10:00
AP_ExternalAHRS AP_ExternalAHRS: remove message when EAHRS_TYPE is None 2021-04-14 14:46:03 +10:00
AP_FETtecOneWire AP_FETtecOneWire: complete rewrite of the ESC-configuration state machine 2021-08-13 16:22:37 +10:00
AP_Filesystem AP_Filesystem: correct file open flags for append 2021-08-11 18:43:53 +10:00
AP_FlashIface AP_FlashIface: remove any delay from is device busy 2021-06-30 19:33:17 +10:00
AP_FlashStorage Docs: Change all references from dev.ardupilot.org to the appropriate documentation URLs. 2021-05-31 12:20:45 +10:00
AP_Follow
AP_Frsky_Telem AP_Frsky_Telem: added airspeed flag to frame 0x5005 enabled by a new parameter 2021-07-07 11:53:12 +10:00
AP_Generator AP_Generator: Simplify boolean expression 2021-02-23 10:30:05 +11:00
AP_GPS AP_GPS: added doc message for bit 2 of DRV_OPTIONS 2021-08-10 10:54:14 +10:00
AP_Gripper
AP_GyroFFT AP_GyroFFT: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_HAL AP_HAL: add accessor for reversed mask 2021-08-12 19:00:51 +09:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: disable FETtec OneWire device driver 2021-08-13 16:22:37 +10:00
AP_HAL_Empty AP_HAL_Empty: add QSPIDevice empty HAL Iface 2021-06-30 19:33:17 +10:00
AP_HAL_Linux AP_HAL_LINUX:toggle gpio port 2021-07-24 09:16:08 -07:00
AP_HAL_SITL AP_HAL_SITL: add simulated FETtec ESC 2021-08-13 16:22:37 +10:00
AP_Hott_Telem AP_Hott_Telem: use GPS single-char representation of fix type 2021-02-18 08:59:23 +11:00
AP_ICEngine AP_ICEngine: add note about ICE_STARTCHN_MIN param 2021-05-11 09:12:05 +10:00
AP_InertialNav AP_InertialNav: rename for AHRS restructuring 2021-07-21 21:01:39 +10:00
AP_InertialSensor AP_InertialSensor: BMI160: Allow configuring the rotation 2021-08-13 12:32:28 +10:00
AP_InternalError AP_InternalError: specify size for error_t 2021-06-13 08:41:25 +10:00
AP_IOMCU AP_IOMCU: fixed a safety reset case for IOMCU reset 2021-05-25 12:14:01 +10:00
AP_IRLock AP_IRLock: change class name from SITL::SITL to SITL::SIM 2021-08-05 07:25:31 +10:00
AP_JSButton
AP_KDECAN AP_KDECAN: Use HAL_CANMANAGER_ENABLED instead of HAL_ENABLE_LIBUAVCAN_DRIVERS 2021-06-24 09:02:42 +10:00
AP_L1_Control AP_L1_Control: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_Landing AP_Landing: remove DeepStall from 1MB boards 2021-07-26 16:19:12 +10:00
AP_LandingGear AP_LandingGear: remove @Values from param metadata where @Bitmask exists 2021-06-23 18:37:34 +10:00
AP_LeakDetector AP_LeakDetector: enable for Pixhawk4 2021-08-09 18:55:11 -04:00
AP_Logger AP_Logger: fix MAVLink logger random failure on SITL 2021-08-12 13:55:22 +10:00
AP_LTM_Telem AP_LTM_Telem: get airspeed sensor from singleton not AHRS object 2020-12-07 15:57:28 -08:00
AP_Math AP_Math: move crc8_dvb_update into crc library 2021-08-13 16:22:37 +10:00
AP_Menu
AP_Mission AP_Mission: caculate distance to do_land_start with no location correctly 2021-07-27 09:00:11 +09:00
AP_Module AP_Module: rename for AHRS restructuring 2021-07-21 21:01:39 +10:00
AP_Motors AP_Motors: add accessors for turtle mode 2021-08-12 19:00:51 +09:00
AP_Mount AP_Mount: stop using AHRS as conduit for Compass pointer 2021-07-30 12:19:42 +10:00
AP_MSP AP_OSD: rename BLH elements to ESC 2021-07-06 12:18:21 +10:00
AP_NavEKF AP_NavEKF: log EKF data source set changes 2021-08-11 19:28:28 +09:00
AP_NavEKF2 AP_NavEKF2: remove unecessary assignements 2021-08-12 10:39:49 +09:00
AP_NavEKF3 AP_NavEKF3: remove unecessary assignements 2021-08-12 10:39:49 +09:00
AP_Navigation AP_Navigation: make crosstrack_error_integrator pure virtual as nobody use the base class 2021-06-11 04:59:06 -07:00
AP_NMEA_Output AP_NMEA_Output: stop using AHRS as conduit for Compass pointer 2021-07-30 12:19:42 +10:00
AP_Notify AP_Notify: change class name from SITL::SITL to SITL::SIM 2021-08-05 07:25:31 +10:00
AP_OLC AP_OLC: fixed build of OSD on SITL 2020-11-12 14:22:44 -08:00
AP_ONVIF AP_ONVIF: make onvif test empty if ONVIF not enabled 2021-07-07 18:57:25 +10:00
AP_OpticalFlow AP_OpticalFlow: change class name from SITL::SITL to SITL::SIM 2021-08-05 07:25:31 +10:00
AP_OSD AP_OSD: check for nullptr before using it 2021-08-12 13:56:53 +10:00
AP_Parachute AP_Parachute: fixed printf format errors 2021-08-05 09:43:35 +10:00
AP_Param AP_Param: allow save_sync without send 2021-04-21 07:12:55 +10:00
AP_PiccoloCAN AP_PiccoloCAN: fix missing _telem_sem 2021-06-24 17:15:08 +10:00
AP_Proximity AP_Proximity: change class name from SITL::SITL to SITL::SIM 2021-08-05 07:25:31 +10:00
AP_Radio
AP_Rally AP_Rally: omit code that breaks build for herepro 2021-07-02 08:50:16 +10:00
AP_RAMTRON
AP_RangeFinder AP_RangeFinder: use typename SIM instead of SITL as it conflicts with namespace name 2021-08-05 07:25:31 +10:00
AP_RCMapper fix metadata to emit RCMAP_FORWARD and _LATERAL for Rover 2021-05-17 13:38:17 +10:00
AP_RCProtocol AP_RCProtocol: make SBUS frame gap configurable 2021-08-10 10:08:05 +10:00
AP_RCTelemetry AP_RCTelemetry: add baud rate change command frame processing. 2021-08-04 17:26:18 +10:00
AP_Relay AP_Relay: fixed printf format errors 2021-08-05 09:43:35 +10:00
AP_RobotisServo AP_RobotisServo: omit code that breaks build for herepro 2021-07-02 08:50:16 +10:00
AP_ROMFS AP_ROMFS: added crc check in ROMFS decompression 2021-02-23 20:20:07 +11:00
AP_RPM AP_RPM: fixed formatting of pin arming check 2021-08-05 09:43:35 +10:00
AP_RSSI AP_RSSI: replaced PixhawkAUX1 with AUX1 2021-07-22 07:48:12 +10:00
AP_RTC AP_RTC: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_SBusOut
AP_Scheduler AP_Scheduler: Change the Task Performance Notification Level to Information 2021-06-13 22:47:24 -07:00
AP_Scripting AP_Scripting: Add mission selection applet 2021-08-13 08:18:55 +10:00
AP_SerialLED
AP_SerialManager AP_SerialManager: add FETtecOneWire protocol 2021-08-13 16:22:37 +10:00
AP_ServoRelayEvents
AP_SmartRTL AP_SmartRTL: rename for AHRS restructuring 2021-07-21 21:01:39 +10:00
AP_Soaring AP_Soaring: Add an override-disable flag to update_active_state to support e.g. mission landing sequence. 2021-08-04 06:52:56 +10:00
AP_SpdHgtControl AP_SpdHgtControl: added get_max_sinkrate() 2021-06-05 13:05:30 +10:00
AP_Stats AP_Stats: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_TECS AP_TECS: added get_max_sinkrate() API 2021-06-05 13:05:30 +10:00
AP_TempCalibration AP_TempCalibration: Remove pointer check before delete 2021-02-04 09:01:19 +11:00
AP_TemperatureSensor AP_TemperatureSensor: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_Terrain AP_Terrain: add setter for terrain-enabled 2021-07-12 17:34:44 +10:00
AP_Torqeedo AP_Torqeedo: increase speed cmd at 50hz 2021-08-12 10:54:36 +10:00
AP_ToshibaCAN AP_ToshibaCAN: fixed printf format errors 2021-08-05 09:43:35 +10:00
AP_Tuning AP_Tuning: use AUX_PWM_TRIGGER_LOW and AUX_PWM_TRIGGER_HIGH 2021-02-10 18:48:06 +11:00
AP_UAVCAN AP_UAVCAN: fixed printf format errors 2021-08-05 09:43:35 +10:00
AP_Vehicle AP_Vehicle: output rcout banner when initialization is done 2021-08-12 19:07:51 +09:00
AP_VideoTX AP_SmartAudio: Add pull down VTX option 2021-06-16 18:49:13 +10:00
AP_VisualOdom AP_VisualOdom: rename for AHRS restructuring 2021-07-21 21:01:39 +10:00
AP_Volz_Protocol AP_Volz_Protocol: omit code that breaks build for herepro 2021-07-02 08:50:16 +10:00
AP_WheelEncoder AP_WheelEncoder: change class name from SITL::SITL to SITL::SIM 2021-08-05 07:25:31 +10:00
AP_Winch
AP_WindVane AP_WindVane: replaced PixhawkAUX1 with AUX1 2021-07-22 07:48:12 +10:00
APM_Control APM_Control: lower the tuning trigger threshold 2021-07-31 10:01:14 +10:00
AR_Motors AP_Motors: move AP_MotorsUGV to new AR_Motors directory 2021-07-20 10:48:01 +09:00
AR_WPNav AR_WPNav: integrate PathPlanner returning path_planner_used 2021-07-22 08:51:41 +09:00
doc
Filter Filter: Add Vector2f option to notch filter 2021-07-06 14:56:02 +10:00
GCS_MAVLink GCS_MVALink: remove virtual from send_simstate 2021-08-10 09:48:34 +10:00
PID
RC_Channel RC_Channel: add turtle mode to RC option 150 2021-08-12 19:00:51 +09:00
SITL SITL: add simulated FETtec ESC 2021-08-13 16:22:37 +10:00
SRV_Channel SRV_Channel: add FETtec support 2021-08-13 16:22:37 +10:00
StorageManager StorageManager: add read_float and write_float 2021-06-06 11:41:30 +10:00