ardupilot/libraries
Randy Mackay 866ea184c8 AP_Torqeedo: major refactor and enhancement
SLEW_TIME specifies the rate of change in output to the motor
DIR_DELAY specifies the length of the pause at zero during forward-reverse transitions
POWER param allows configurable power output
Consume Display system state and setup messages
Consume Motor messages to retrieve volt and current
TRQD logs on each motor speed update
AP_Torqeedo: request and consume motor status messages
ESC_Telemetry support
Battery info accessor
Add real-time error reporting of failures to user
Support user manually clearing motor errors via RC
Improve message reply handling
Tiller message consumption improved
Messages with unexpected lengths increment error count
Enums added
Comments improved
Remove unused include
Disable for AP_Periph and minimise features
2021-10-19 01:30:51 -04:00
..
AC_AttitudeControl AC_AttitudeControl: Fix initialize bug 2021-10-01 13:14:46 -04:00
AC_Autorotation AC_Autorotation: mark logger Write() calls as streaming where appropriate 2021-08-18 10:20:03 +10:00
AC_AutoTune AC_AutoTune: stop specifying bit-widths for state 2021-09-28 11:00:30 +10:00
AC_Avoidance AC_Avoid: Early exit Dijkstra's path finder if destination is found 2021-10-11 02:21:48 -04: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: Raise internal error if state machine is running while precland is disabled 2021-08-30 14:08:44 +09:00
AC_Sprayer AC_Sprayer: use vector.xy().length() instead of norm(x,y) 2021-09-14 10:43:46 +10:00
AC_WPNav AC_WPNav: add getter for wp_radius_cm 2021-09-15 20:36:56 +10:00
AP_AccelCal AP_AccelCal: move from HAL_NO_GCS to HAL_GCS_ENABLED 2021-09-22 21:37:00 +10:00
AP_ADC
AP_ADSB AP_ADSB: Ping200X update health, remove option for external baro, and gnss altitude units bugfix 2021-10-03 09:57:39 -05:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: use mission singleton inside AP_AdvancedFailsafe 2021-08-03 10:35:24 +10:00
AP_AHRS AP_AHRS: do not send EKF_STATUS_REPORT from DCM 2021-10-06 19:10:36 +11:00
AP_Airspeed AP_Airspeed: do not cal if backend does not exist 2021-10-07 13:36:44 +11:00
AP_AIS AP_AIS: log base station report message 2021-08-10 08:11:18 +09:00
AP_Arming AP_Arming: add min heater temp check 2021-10-19 11:16:45 +11:00
AP_Avoidance AC_Avoidance: Add APM_BUILD_Heli 2021-09-29 19:55:48 +10:00
AP_Baro AP_Baro: add option to set BARO_EXT_BUS default value 2021-10-11 17:57:52 -03:00
AP_BattMonitor AP_BattMonitor: Add support for BatteryInfoAux message 2021-10-13 18:44:05 +11:00
AP_Beacon AP_Beacon: hide params with enable flag 2021-08-24 09:38:46 +10:00
AP_BLHeli AP_BLHeli: use is_dshot_protocol in place of >= AP_HAL::RCOutput::MODE_PWM_DSHOT150 2021-10-06 18:59:57 +11:00
AP_BoardConfig AP_BoardConfig: add min arming temp margin param and getter 2021-10-19 11:16:45 +11:00
AP_Button AP_Button: update FUNx values 2021-09-21 09:36:24 +10:00
AP_Camera AP_Camera: use location methods to convert altitudes 2021-10-05 13:54:19 +11:00
AP_CANManager AP_CANManager: factor substring from allocation_error parameter 2021-10-18 12:49:44 +11:00
AP_Common AP_Common: Added missing fenv exception functions from FreeBSD fenv tree 2021-10-16 20:09:11 +11:00
AP_Compass AP_Compass: support 2nd address for ICM20948 compass 2021-10-18 08:29:29 +11:00
AP_DAL AP_DAL: factor substring from allocation_error parameter 2021-10-18 12:49:44 +11:00
AP_Declination AP_Declination: added a test suite for AP_Declination 2021-09-03 14:45:17 +10:00
AP_Devo_Telem
AP_EFI AP_EFI: Remove @RebootRequired: False 2021-08-19 10:00:16 +10:00
AP_ESC_Telem AP_ESC_Telem: fix raw rpm 2021-09-01 17:15:32 +10:00
AP_ExternalAHRS AP_ExternalAHRS: factor substring from allocation_error parameter 2021-10-18 12:49:44 +11:00
AP_FETtecOneWire AP_FETtecOneWire: README.md clarity improvements 2021-08-25 16:05:05 +10:00
AP_Filesystem AP_Filesystem: fix ftp burst read with credit to deanharken 2021-10-15 19:02:41 +11:00
AP_FlashIface AP_FlashIface: add jedec test using bootloader config 2021-09-01 17:10:53 +10:00
AP_FlashStorage AP_FlashStorage: support L496 MCUs 2021-09-24 18:08:00 +10:00
AP_Follow AP_Follow: mark logger Write() calls as streaming where appropriate 2021-08-18 10:20:03 +10:00
AP_Frsky_Telem AP_Frsky_Telem: fix periph-heavy compile errors with different things enabled 2021-09-24 10:47:13 -05:00
AP_Generator AP_Gererator: IE Fuel Cell: reset health timer at init 2021-10-08 19:34:34 -04:00
AP_GPS AP_GPS: fix build and working with single GPS Receiver config 2021-09-30 21:53:07 +10:00
AP_Gripper
AP_GyroFFT AP_GyroFFT: Add APM_BUILD_Heli 2021-09-29 19:55:48 +10:00
AP_HAL AP_HAL: add helpers le64toh_ptr, be64toh_ptr, put_le64_ptr, put_be64_ptr 2021-10-17 08:55:03 +11:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: CubeYellow: set default IMU arming temp margin 2021-10-19 11:16:45 +11:00
AP_HAL_Empty AP_HAL_Empty: AnalogSource: return bool 2021-10-06 18:42:51 +11:00
AP_HAL_Linux GPIO_BBB: fix partially working GPIO init 2021-10-15 15:16:17 -07:00
AP_HAL_SITL AP_HAL_SITL: move simulated megasquirt to SerialDevice framework 2021-10-17 10:00:08 +11:00
AP_Hott_Telem AP_Hott_Telem: cope with BARO_MAX_INSTANCES = 1 2021-09-29 10:51:14 +10:00
AP_ICEngine AP_ICEngine: spelling and grammer fixes inc in param description 2021-08-19 10:00:16 +10:00
AP_InertialNav AP_InertialNav: use vector.xy().length() instead of norm(x,y) 2021-09-14 10:43:46 +10:00
AP_InertialSensor AP_InertialSensor: Add APM_BUILD_Heli 2021-09-29 19:55:48 +10:00
AP_InternalError AP_InternalError: change panic to return error code as string in SITL 2021-09-28 09:11:48 +10:00
AP_IOMCU AP_IOMCU: ensure page_GPIO is aligned to 16bit 2021-09-29 19:08:10 +10:00
AP_IRLock AP_IRLock_I2C: add comment on calibration equation 2021-09-13 10:56:00 +09: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: hide deepstall params with enable flag 2021-08-24 09:38:46 +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: check for valid analog pin 2021-10-06 18:42:51 +11:00
AP_Logger AP_Logger: added stack logging 2021-10-12 16:04:06 +11:00
AP_LTM_Telem
AP_Math AP_Math: add Internal_Error for quaternion of 0 length 2021-09-28 19:09:16 +10:00
AP_Menu
AP_Mission AP_Mission: allow for more jump commands on high memory boards 2021-10-13 12:49:12 +11:00
AP_Module AP_Module: fix examples for AP_AHRS_DCM becoming backend 2021-08-31 14:28:53 +10:00
AP_Motors AP_Motors: add PWM min and max param conversion function 2021-10-11 22:19:17 -04:00
AP_Mount AP_Mount: add handle_global_position_int() method to backend and use it + little spelling 2021-10-08 14:22:43 +11:00
AP_MSP AP_MSP: move from HAL_NO_GCS to HAL_GCS_ENABLED 2021-09-22 21:37:00 +10:00
AP_NavEKF AP_NavEKF: log EKF data source set changes 2021-08-11 19:28:28 +09:00
AP_NavEKF2 AP_NavEKF2: Add APM_BUILD_Heli 2021-09-29 19:55:48 +10:00
AP_NavEKF3 AP_NavEKF3: allow hwdef to override IMU default 2021-10-16 10:26:29 +11: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: use vector.xy().length() instead of norm(x,y) 2021-09-14 10:43:46 +10:00
AP_Notify AP_Notify: link to notify module 2021-09-10 08:17:37 +10:00
AP_OLC
AP_ONVIF AP_ONVIF: use correct #pragma GCC diagnostic pop 2021-09-29 17:27:29 +10:00
AP_OpticalFlow AP_OpticalFlow: SITL driver applies _FX/YSCALER params 2021-08-24 16:49:04 +09:00
AP_OSD OP_OSD_Screen: make the rangefinder distance element fixed length 2021-10-05 12:15:08 +11:00
AP_Parachute AP_Parachute: fixed printf format errors 2021-08-05 09:43:35 +10:00
AP_Param AP_Param: move from HAL_NO_GCS to HAL_GCS_ENABLED 2021-09-22 21:37:00 +10:00
AP_PiccoloCAN AP_PiccoloCAN: fix missing _telem_sem 2021-06-24 17:15:08 +10:00
AP_Proximity AP_Proximity: lower SF45B update rate 2021-09-26 20:26:20 +09:00
AP_Radio AP_Radio: hide params with enable flag 2021-08-24 09:38:46 +10:00
AP_Rally AP_Rally: Add APM_BUILD_Heli 2021-09-29 19:55:48 +10:00
AP_RAMTRON
AP_RangeFinder AP_RangeFinder: analog: check for valid pin 2021-10-06 18:42:51 +11: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: check for RC protocol switching enable 2021-10-15 19:29:23 -04:00
AP_RCTelemetry AP_RCTelemetry: don't enter parameter mode while armed. 2021-09-21 10:41:58 +10:00
AP_Relay AP_Relay: update param description to inclde IOMCU 2021-09-28 09:40:25 +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: Mark type = PWM as not used in docs 2021-08-25 09:36:58 +10:00
AP_RSSI AP_RSSI: check for valid analog pin 2021-10-06 18:42:51 +11:00
AP_RTC AP_RTC: move from HAL_NO_GCS to HAL_GCS_ENABLED 2021-09-22 21:37:00 +10:00
AP_SBusOut
AP_Scheduler AP_Scheduler: Add APM_BUILD_Heli 2021-09-29 19:55:48 +10:00
AP_Scripting AP_Scripting: update ahrs-source-gps-optflow.lua 2021-10-14 10:36:29 +11:00
AP_SerialLED
AP_SerialManager AP_SerialManager: always set options 2021-10-05 12:11:47 +11:00
AP_ServoRelayEvents
AP_SmartRTL AP_SmartRTL: rename for AHRS restructuring 2021-07-21 21:01:39 +10:00
AP_Soaring AP_Soaring: Initialize filter to the current filtered measurement 2021-08-25 19:00:46 +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: mark logger Write() calls as streaming where appropriate 2021-08-18 10:20:03 +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: make TERRAIN_MARGIN a float 2021-08-31 09:25:36 +10:00
AP_Torqeedo AP_Torqeedo: major refactor and enhancement 2021-10-19 01:30:51 -04:00
AP_ToshibaCAN AP_ToshibaCAN: fixed printf format errors 2021-08-05 09:43:35 +10:00
AP_Tuning AP_Tuning: add options to prevent spamming tuning error messages 2021-09-21 07:56:19 +09:00
AP_UAVCAN AP_UAVCAN: Add battery ID field 2021-10-13 18:44:05 +11:00
AP_Vehicle AP_Vehicle: move SITL object up to AP_Vehicle 2021-10-19 11:34:43 +11:00
AP_VideoTX AP_SmartAudio: Add pull down VTX option 2021-06-16 18:49:13 +10:00
AP_VisualOdom AP_VisualOdom: move from HAL_NO_GCS to HAL_GCS_ENABLED 2021-09-22 21:37:00 +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: check for valid analog pins 2021-10-06 18:42:51 +11:00
APM_Control APM_Control: only save autotune gains when P finished 2021-10-10 19:00:57 +11:00
AR_Motors AP_MotorsUGV: make pwm_type private and add is_digital_pwm_type method 2021-10-06 18:59:57 +11:00
AR_WPNav AR_WPNav: integrate PathPlanner returning path_planner_used 2021-07-22 08:51:41 +09:00
doc
Filter Filter: add more unittests 2021-08-30 09:51:25 +10:00
GCS_MAVLink GCS_MAVLink: move ADSB mavlink handling from vehicles to common library 2021-10-14 19:55:27 -07:00
PID
RC_Channel RC_Channel: added RC_OPTION bit for allowing RC protocol switching 2021-10-15 19:29:23 -04:00
SITL SITL: add simulated MCP9600 2021-10-19 08:15:00 +11:00
SRV_Channel SRV_Channel: added SERVO_GPIO_MASK 2021-10-11 19:28:11 +11:00
StorageManager StorageManager: Add APM_BUILD_Heli 2021-09-29 19:55:48 +10:00