ardupilot/libraries
Andrew Tridgell 040ff007ea HAL_ChibiOS: fixed some F4 clocks, and support no crystal on F4
this fixes up some of the F4 varients that were running at the wrong
clock, and also gives support for running F4s with no crystal
2022-01-29 18:57:33 +11:00
..
AC_AttitudeControl AC_AttitudeControl: AC_PosControl: use relax_integrator 2022-01-25 13:20:47 +09: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: Move rate limit to AC_AttitudeControl 2022-01-11 10:57:53 +11:00
AC_Avoidance AC_Avoidance: don't build avoidance on plane 2022-01-11 09:51:47 +11:00
AC_Fence AC_Fence: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AC_InputManager
AC_PID AC_PID: replace reset_I_smoothly with relax_integrator 2022-01-25 13:20:47 +09:00
AC_PrecLand AC_PrecLand: Fix multi #include's 2021-12-21 10:38:46 +11: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: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_AccelCal AP_AccelCal: remove unused calc_mean_squared_residuals 2022-01-26 12:03:17 +09:00
AP_ADC
AP_ADSB AP_ADSB: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: use mission singleton inside AP_AdvancedFailsafe 2021-08-03 10:35:24 +10:00
AP_AHRS AP_AHRS: getOptFlowSample returns latest correct flow data for use in calibration 2022-01-29 08:26:12 +09:00
AP_Airspeed AP_Airspeed: move Airspeed up to AP_Vehicle, use dummy class for Copter 2022-01-19 18:21:32 +11:00
AP_AIS AP_AIS: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_Arming AP_Arming: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_Avoidance AP_Avoidance: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_Baro AP_Baro: add define AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11:00
AP_BattMonitor AP_BattMonitor: UAVCAN switch to CURR_MULT 2022-01-25 13:55:31 +09:00
AP_Beacon AP_Beacon: have nooploop use base-class uart instance 2021-11-02 11:19:18 +11:00
AP_BLHeli AP_BLHeli: allow for no uart in update() 2021-12-10 08:11:24 -08:00
AP_BoardConfig AP_BoardConfig: disable STLink debug pins by default 2021-12-28 10:31:25 +11:00
AP_Button AP_Button: use CopyValuesFrom to avoid duplication 2021-12-15 09:54:06 +11:00
AP_Camera AP_Camera: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_CANManager AP_CANManager: make C_TO_KELVIN a function macro; create KELVIN_TO_C 2022-01-13 18:31:46 +11:00
AP_Common AP_Common: support AP_CUSTOM_FIRMWARE_STRING 2022-01-19 08:07:45 +11:00
AP_Compass AP_Compass: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_DAL AP_DAL: add define AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11:00
AP_Declination AP_Declination: Fix multi #include's 2021-12-21 10:38:46 +11:00
AP_Devo_Telem AP_Devo_Telem: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_EFI AP_EFI: reserve ID for Loweheiser mavlink-connected generator 2022-01-25 09:44:41 +11:00
AP_ESC_Telem AP_ESC_Telem : Update Telemetry 2022-01-17 11:26:34 +09:00
AP_ExternalAHRS AP_ExternalAHRS: factor substring from allocation_error parameter 2021-10-18 12:49:44 +11:00
AP_FETtecOneWire AP_FETtecOneWire: Fix spelling in comments (NFC) 2022-01-06 09:15:54 +11:00
AP_Filesystem AP_Filesystem: add HAL_UART_STATS_ENABLED to disable stats gathering 2022-01-12 18:30:49 +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: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_Frsky_Telem AP_Frsky_Telem: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_Generator AP_Generator: reserve ID for Loweheiser mavlink-connected generator 2022-01-25 09:44:41 +11:00
AP_GPS AP_GPS: sync pps rate with message rate 2022-01-20 17:26:35 +11:00
AP_Gripper AP_Gripper: change UAVCAN to DroneCAN in param metadata 2021-12-15 09:53:21 +11:00
AP_GyroFFT AP_GyroFFT: make vehicles write notch log messages 2022-01-05 16:34:36 +11:00
AP_HAL AP_HAL: add HAL_UART_STATS_ENABLED to disable stats gathering 2022-01-12 18:30:49 +11:00
AP_HAL_ChibiOS HAL_ChibiOS: fixed some F4 clocks, and support no crystal on F4 2022-01-29 18:57:33 +11:00
AP_HAL_Empty AP_HAL_Empty: add HAL_UART_STATS_ENABLED to disable stats gathering 2022-01-12 18:30:49 +11:00
AP_HAL_ESP32 AP_HAL_ESP32: Fix multi #include's 2021-12-21 10:38:46 +11:00
AP_HAL_Linux AP_Hal_Linux: PCA9685: do not shutdown 2022-01-18 11:06:35 +11:00
AP_HAL_SITL HAL_SITL: fixed mapping of --serial ports in SITL 2022-01-21 10:07:55 +11:00
AP_Hott_Telem AP_Hott_Telem: add define AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11: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: rename for neu & cm/cms 2021-11-30 10:08:07 +11:00
AP_InertialSensor AP_InertialSensor: add and use AP_SIM_INS_ENABLED 2022-01-17 19:14:39 +11: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: fix ADC scaling on IOMCU 2021-11-16 14:12:43 +11:00
AP_IRLock AP_IRLock_I2C: add comment on calibration equation 2021-09-13 10:56:00 +09:00
AP_JSButton
AP_KDECAN
AP_L1_Control AP_L1_Control: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_Landing AP_Landing: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_LandingGear AP_LandingGear: add enable param 2021-11-23 11:40:44 +11:00
AP_LeakDetector AP_LeakDetector: check for valid analog pin 2021-10-06 18:42:51 +11:00
AP_Logger AP_Logger: log original fw string if available 2022-01-19 08:07:45 +11:00
AP_LTM_Telem AP_LTM_Telem: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_Math AP_Math: quaternion add is_zero() & zero() 2022-01-19 18:03:17 +11:00
AP_Menu
AP_Mission AP_Mission: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_Module AP_Module: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_Motors AP_Motors: tweak logging structure construction 2022-01-21 21:34:57 +11:00
AP_Mount AP_Mount: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_MSP AP_MSP: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_NavEKF AP_NavEKF: log EKF data source set changes 2021-08-11 19:28:28 +09:00
AP_NavEKF2 AP_NavEKF2: minor spelling fixes 2022-01-17 11:29:39 +09:00
AP_NavEKF3 AP_NavEKF3: getOptFlowSample returns latest correct flow data for use in calibration 2022-01-29 08:26:12 +09:00
AP_Navigation
AP_NMEA_Output AP_NMEA_Output: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_Notify AP_Notify: change UAVCAN to DroneCAN in param metadata 2021-12-15 09:53:21 +11: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: integrate calibrator 2022-01-29 08:26:12 +09:00
AP_OSD AP_OSD: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_Parachute AP_Parachute: added arming check for chute released 2021-11-18 15:21:15 +11:00
AP_Param AP_Param: Change from a direct value to a defined name 2022-01-25 10:45:36 +11:00
AP_PiccoloCAN AP_PiccoloCAN : Update Telemetry 2022-01-17 11:26:34 +09:00
AP_Proximity AP_Proximity: Removed AP_Proximity_LightWareSF40C_v09 2022-01-07 08:28:59 +09:00
AP_Radio AP_Radio: hide params with enable flag 2021-08-24 09:38:46 +10:00
AP_Rally AP_Rally: convert APM_BUILD_COPTER_OR_HELI() to APM_BUILD_COPTER_OR_HELI 2021-10-26 11:42:12 +11:00
AP_RAMTRON
AP_RangeFinder AP_RangFinder: support various maxbotix serial sonar 2022-01-18 11:08:34 +11:00
AP_RCMapper
AP_RCProtocol AP_RCProtocol: change default SBUS frame gap to 4ms 2022-01-29 15:09:29 +11:00
AP_RCTelemetry AP_RCTelemetry: add define AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11:00
AP_Relay AP_Relay: update param description to inclde IOMCU 2021-09-28 09:40:25 +10:00
AP_RobotisServo AP_RobotisServo: Move crc16-ibm CRC calculation method to a common class 2022-01-13 09:44:40 +11:00
AP_ROMFS
AP_RPM AP_RPM: move RPM sensor logging into AP_RPM 2022-01-11 11:09:26 +11:00
AP_RSSI AP_RSSI : Update Telemetry 2022-01-17 11:26:34 +09:00
AP_RTC AP_GPS: make more precise calculation of gps message 2022-01-20 17:26:35 +11:00
AP_SBusOut
AP_Scheduler AP_Scheduler: Fix multi #include's 2021-12-21 10:38:46 +11:00
AP_Scripting AP_Scripting: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_SerialLED AP_SerialLED: removed empty constructors 2021-11-01 10:24:40 +11:00
AP_SerialManager AP_SerialManager: allow for EFI serial option for non-MS protocols 2022-01-17 15:16:24 +11:00
AP_ServoRelayEvents
AP_SmartRTL AP_SmartRTL: rename for AHRS restructuring 2021-07-21 21:01:39 +10:00
AP_Soaring AP_Soaring: Add speed-to-fly calculation used if SOAR_CRSE_ARSPD<0. 2021-12-16 07:12:24 +11:00
AP_Stats
AP_TECS AP_TECS: add reset throttle I function 2021-12-22 18:46:14 +11:00
AP_TempCalibration
AP_TemperatureSensor
AP_Terrain AP_Terrain: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_Torqeedo AP_Torqeedo: simplify conversion of master error code into string 2021-12-06 14:50:15 +11:00
AP_ToshibaCAN AP_ToshibaCAN: Fix multi #include's 2021-12-21 10:38:46 +11: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: make C_TO_KELVIN a function macro; create KELVIN_TO_C 2022-01-13 18:31:46 +11:00
AP_Vehicle AP_Vehicle: move Airspeed to AP_Vehicle 2022-01-19 18:21:32 +11:00
AP_VideoTX AP_VideoTX : fixed typo 2022-01-13 09:45:39 +11:00
AP_VisualOdom AP_VisualOdom: added VOXL backend type 2021-12-27 12:32:41 +11: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: quadrature spelling changed 2021-10-27 16:03:06 +11:00
AP_Winch AP_Winch: use floats for get/set output scaled 2021-10-20 18:29:58 +11:00
AP_WindVane AP_WindVane: add define AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11:00
APM_Control APM_Control: correct metadata description for roll/pitch rate limits 2022-01-25 08:37:39 +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: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
doc
Filter Filter: optimize hot parts of notch filter updates 2021-12-22 18:23:33 +11:00
GCS_MAVLink GCS_MAVLink: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
PID
RC_Channel RC_Channel: add aux switch for optical flow calibration 2022-01-29 08:26:12 +09:00
SITL SITL: do not compile SIM_GPS parameters in if SIM_GPS not enabled 2022-01-25 19:28:06 +11:00
SRV_Channel SRV_Channel: add native slew rate limiting 2022-01-25 10:12:13 +11:00
StorageManager StorageManager: fix write_block() comment 2021-12-17 09:53:47 +09:00