Commit Graph

28976 Commits

Author SHA1 Message Date
Bill Geyer
a5c1d51430 AC_AutoTune: add rate limits for rate dwell test and unusual attitude protections 2022-02-01 23:06:51 -05:00
Bill Geyer
768648b14c AC_AutoTune: fix position holding during sweeps 2022-02-01 23:06:51 -05:00
Bill Geyer
2c1985aecd AC_AutoTune: comments in FreqResp and use M_2PI for 6.28 2022-02-01 23:06:51 -05:00
Bill Geyer
af1c8dd9bc AC_AutoTune: clean up FreqResp library and add comments 2022-02-01 23:06:51 -05:00
Bill Geyer
9ff3a7e795 AutoTune: fix commit Add units to the AC_AttitudeControl Library after rebase 2022-02-01 23:06:51 -05:00
Bill Geyer
6cdf3b9109 AC_AutoTune: adding comments to FreqResp Library 2022-02-01 23:06:51 -05:00
Bill Geyer
c757de153d AC_AutoTune: tradheli autotune, sqashed commits together 2022-02-01 23:06:51 -05:00
Randy Mackay
873924d6cd AC_AutoTune: formatting and comment improvements 2022-02-01 23:06:51 -05:00
bnsgeyer
fae1917aa7 AC_Autotune: add heli autotune with review comments incorporated 2022-02-01 23:06:51 -05:00
Iampete1
427e8d1e24 AP_Scripting: add define option to disable interupts for the duration of script run 2022-02-02 11:33:46 +11:00
Iampete1
da352163ee AP_Scripting: move singleton method bindings to flash 2022-02-02 11:33:46 +11:00
Andrew Tridgell
c2c94631e8 HAL_ChibiOS: added STM32CubeMX files for new F412 configs 2022-02-02 07:42:23 +11:00
Andrew Tridgell
e07057d24f HAL_ChibiOS: support SDIO 48MHz clock on F412 2022-02-02 07:42:23 +11:00
Peter Barker
189c4cc4c7 AP_Logger: add missing documentation for RCI2 message 2022-02-01 22:45:19 +11:00
Peter Barker
e2ced65c04 AP_Avoidance: tidy construction of vector on stack 2022-02-01 19:40:22 +11:00
Peter Barker
abc57740ee AP Avoidance: stop using relative_lat member in Location object 2022-02-01 19:40:22 +11:00
Rishabh
89cd6ab006 AC_PrecLand: Change parameter to bitmask 2022-02-01 17:12:56 +09:00
TulleU
7907fd5729 AP_HAL_ChibiOS: revo-mini-i2c probe for external compasses
allow for probing of external compasses on i2c
2022-02-01 17:36:14 +11:00
Willian Galvani
802974a337 AP_Filesystem: tweak fgets()
This avoids that it returns False when encountering new lines or
\n\r
2022-02-01 17:35:26 +11:00
Willian Galvani
e6929892e3 AP_Param: Use AP:FS() to read files 2022-02-01 17:35:26 +11:00
Willian Galvani
403ea405dd AP_Hal_Linux: create defaults.parm for Navigator 2022-02-01 17:35:26 +11:00
murata
42d1fd984c AP_OpticalFlow: Change division to multiplication 2022-02-01 17:34:40 +11:00
Hwurzburg
0ea7044796 AP_HAL_ChibiOS: update option names in BATTMonitor in prep for expansion 2022-02-01 12:35:03 +11:00
Hwurzburg
95e074a7bc AP_BattMonitor: update option names in BATTMonitor in prep for expansion 2022-02-01 12:35:03 +11:00
Peter Barker
f5526d095b AP_HAL: remove HAL_COMPASS_DEFAULT define
this doesn't actually allow you to specify a default, despite the name
and a couple of hwdefs trying to use it that way.

This would have stopped being useful when we did the
compass-prority-table stuff - or before.
2022-02-01 12:10:38 +11:00
Peter Barker
9305a67737 AP_HAL_ESP32: remove HAL_COMPASS_DEFAULT define
this doesn't actually allow you to specify a default, despite the name
and a couple of hwdefs trying to use it that way.

This would have stopped being useful when we did the
compass-prority-table stuff - or before.
2022-02-01 12:10:38 +11:00
Peter Barker
0eacc0348e AP_HAL_ChibiOS: remove HAL_COMPASS_DEFAULT define
this doesn't actually allow you to specify a default, despite the name
and a couple of hwdefs trying to use it that way.

This would have stopped being useful when we did the
compass-prority-table stuff - or before.
2022-02-01 12:10:38 +11:00
Peter Barker
ef2fd1f4ba AP_Compass: remove HAL_COMPASS_DEFAULT define
this doesn't actually allow you to specify a default, despite the name
and a couple of hwdefs trying to use it that way.

This would have stopped being useful when we did the
compass-prority-table stuff - or before.
2022-02-01 12:10:38 +11:00
Peter Barker
a4d2194f80 hwdef: SkyViper-v2450: enable only UBLOX and MAV GPS backends 2022-02-01 11:22:02 +11:00
Peter Barker
60b8277e1b AP_GPS: create and use AP_GPS_BACKEND_DEFAULT_ENABLED
Allows for all backends to be set to off by default.
2022-02-01 11:22:02 +11:00
mathieulohier
bcc60d0945 hwdef: modalai_fc_v1 update documentation 2022-02-01 11:02:23 +11:00
Iampete1
b3646494d4 AC_AttitudeControl: always use smaller of slew yaw and rate max 2022-02-01 08:19:35 +09:00
Rishabh
3caff0fa1e AP_Scripting: Add lua script example for Rover moving in circles with fixed radius using turn rate guided command 2022-01-31 14:48:22 +09:00
Rishabh
2e7e4a36ff AP_Scripting: Allow scripts to set Rovers turn rate and speed guided command 2022-01-31 14:48:22 +09:00
Rishabh
d90d3d1283 AP_Vehicle: Allow lua script access to Rover's turn rate guided command 2022-01-31 14:48:22 +09:00
Rishabh
819539af1a AC_PrecLand: Add features to check if target is moving and figure out its velocity 2022-01-31 14:38:29 +09:00
Rishabh
ef20d749bf AP_Proximity: Fix Cygbot_D1 driver CRC 2022-01-31 14:10:21 +09:00
Randy Mackay
372fc1a840 AP_Math: spline lateral scaler reduced to 0.5
Co-authored-by: Leonard Hall <leonardthall@gmail.com>
2022-01-31 12:05:59 +09:00
murata
71d87c3c94 AP_ToshibaCAN: correct spelling mili -> milli 2022-01-31 08:55:29 +09:00
murata
42264599f2 AP_IRLock: correct spelling mili -> milli 2022-01-31 08:55:29 +09:00
murata
3eb0fca212 AP_FETtecOneWire: correct spelling mili -> milli 2022-01-31 08:55:29 +09:00
murata
fb8582e98e AP_ESC_Telem: correct spelling mili -> milli 2022-01-31 08:55:29 +09:00
Iampete1
fd11620383 SRV_Channels: correct RC channel define to SERVO channel 2022-01-30 17:29:56 +11:00
Peter Barker
c463036706 AP_GPS: write config blob out as chunk rather than iterating 2022-01-30 13:24:45 +11:00
Andrew Tridgell
563528dfc0 HAL_ChibiOS: update CubeMX files 2022-01-29 18:57:33 +11:00
Andrew Tridgell
00e32b52bf hwdef: removed unnecessary PLL overrides
now we've properly filled in the F4 clocks we can use normal PLL
settings
2022-01-29 18:57:33 +11:00
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
Andrew Tridgell
a8b98bfcc4 HAL_ChibiOS: required EXPECTED_CLOCK in all MCU files
this ensures we validate the clock setup at compile time
2022-01-29 18:57:33 +11:00
Andrew Tridgell
1224ff48b3 hwdef: fixed VCC monitoring on AIRLink 2022-01-29 15:09:46 +11:00
Andrew Tridgell
af9e96c619 AP_RCProtocol: change default SBUS frame gap to 4ms
this is to cope with some newer receivers such as the skydroid H16
which produces SBUS frames with gaps over 2ms

without this change we get can RC failsafes constantly
2022-01-29 15:09:29 +11:00
Randy Mackay
7a35fa2214 AP_OpticalFlow: integrate calibrator 2022-01-29 08:26:12 +09:00
Randy Mackay
5a2bf89384 AP_OpticalFlow: add calibrator 2022-01-29 08:26:12 +09:00
Randy Mackay
41f1c763f2 RC_Channel: add aux switch for optical flow calibration 2022-01-29 08:26:12 +09:00
Randy Mackay
9126e14c9c AP_AHRS: getOptFlowSample returns latest correct flow data for use in calibration 2022-01-29 08:26:12 +09:00
Randy Mackay
e16a64383f AP_NavEKF3: getOptFlowSample returns latest correct flow data for use in calibration 2022-01-29 08:26:12 +09:00
Peter Barker
da79a5ea78 hwdef: skyviper-v2450: exclude many build features 2022-01-27 20:58:24 +11:00
Kirill Shilov
477fb4c408 hwdef: AIRLink added default parameters files 2022-01-27 17:42:11 +11:00
Andrew Tridgell
d71ec5bb4d HAL_ChibiOS: don't init RCOut twice
this triggered a watchdog if the dshot timer was already active, which caused
the neoled driver to prevent boot of the Matek F405 GPS
2022-01-27 08:26:47 +11:00
Andrew Tridgell
585ee5b2e4 hwdef: fixed rainbow effect on startup in CUAV_GPS 2022-01-27 08:26:47 +11:00
Andrew Tridgell
e35514b551 HAL_ChibiOS: fixed neopixel control
fixes frequency setup for neopixel, separating out DShot setup. Also
allows for neopixel without other DMA controlled output types for LEDs
in AP_Periph
2022-01-27 08:26:47 +11:00
Randy Mackay
576dd2bf9e AP_AccelCal: remove unused calc_mean_squared_residuals 2022-01-26 12:03:17 +09:00
Randy Mackay
53479701eb AP_AccelCal: minor format fix 2022-01-25 20:04:34 +09:00
Randy Mackay
8afe5b9e3b AP_OpticalFlow: update comment 2022-01-25 20:04:24 +09:00
Peter Barker
8782e21443 SITL: do not compile SIM_GPS parameters in if SIM_GPS not enabled 2022-01-25 19:28:06 +11:00
Joshua Henderson
90744e08e1 AP_BattMonitor: UAVCAN switch to CURR_MULT 2022-01-25 13:55:31 +09:00
Leonard Hall
d51e2d323e AC_AttitudeControl: AC_PosControl: use relax_integrator 2022-01-25 13:20:47 +09:00
Leonard Hall
1ad5479954 AC_AttitudeControl: use relax_integrator 2022-01-25 13:20:47 +09:00
Leonard Hall
8d330a95b5 AC_PID: replace reset_I_smoothly with relax_integrator 2022-01-25 13:20:47 +09:00
Leonard Hall
48a15947ab AC_AttitudeControl: AC_PosControl: use consistent measured vel and accel callers in z 2022-01-25 13:20:47 +09:00
Leonard Hall
203529f45e AC_AttitudeControl: AC_PosControl_Sub: Increase Jerk with Accel when out of velocity range 2022-01-25 09:04:25 +09:00
Leonard Hall
f6f51f5a74 AC_AttitudeControl: AC_PosControl: Increase Jerk with Accel when out of velocity range 2022-01-25 09:04:25 +09:00
Peter Barker
bd069cc5e9 AP_AHRS: move logging of SIMSTATE, AHRS2 and POS into AP_AHRS library 2022-01-25 10:59:17 +11:00
Leonard Hall
2cda59c09d AC_AttitudeControl: AC_PosControl: Init desired accel to zero 2022-01-25 08:57:38 +09:00
Peter Barker
21caa8c686 GCS_MAVLink: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
54cf46b8e9 AR_WPNav: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
e8e4aef998 AP_Terrain: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
3438caebe2 AP_Scripting: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
26c4b65d4e AP_OSD: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
88b463947a AP_NMEA_Output: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
1c63aa1e4d AP_MSP: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
fcd8d1b5eb AP_Mount: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
3f8fe9d3ef AP_Module: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
f51914ed25 AP_Mission: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
d4b2a48806 AP_LTM_Telem: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
6b1e20916b AP_Landing: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
cd88ec65fa AP_L1_Control: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
51a9efe817 AP_HAL_ChibiOS: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
423bd1e8a4 AP_Frsky_Telem: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
88afef4cdc AP_Follow: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
9264a25955 AP_Devo_Telem: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
38abec2133 AP_Compass: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
84e58c4f7f AP_Camera: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
313ed7fc71 AP_Avoidance: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
e7e95f5990 AP_Arming: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
45733c96ac AP_AIS: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
ff63b62b0c AP_AHRS: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
e089f23c70 AP_ADSB: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
05a5754452 AC_WPNav: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
Peter Barker
965b03f143 AC_Fence: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
murata
a6bbfca44e AP_Param: Change from a direct value to a defined name 2022-01-25 10:45:36 +11:00
Hwurzburg
45e8cdea70 AP_BatteryMonitor: add current scaler for UAVCAN 2022-01-25 10:37:00 +11:00
Iampete1
6fd989e2ab SRV_Channel: add native slew rate limiting 2022-01-25 10:12:13 +11:00
Peter Barker
f25c1ef954 AP_Generator: reserve ID for Loweheiser mavlink-connected generator 2022-01-25 09:44:41 +11:00
Peter Barker
90107c3977 AP_EFI: reserve ID for Loweheiser mavlink-connected generator 2022-01-25 09:44:41 +11:00
Hwurzburg
c5a444e4a3 hwdef: correct Pixhawk5 3.3V analog in scale factor 2022-01-25 09:37:34 +11:00
Hwurzburg
d1f02916cf APM_Control: correct metadata description for roll/pitch rate limits 2022-01-25 08:37:39 +11:00
Peter Barker
170b8da2fa AP_OpticalFlow: tighten scope on variables 2022-01-24 21:11:56 +09:00
Iampete1
b7bd8cd6be AP_Scripting: update parameter binding docs 2022-01-23 07:00:56 +11:00
Iampete1
f147f6f215 AP_Scripting: add bindings for prameter set defualt and configured 2022-01-23 07:00:56 +11:00
Iampete1
37db2c5d4d AP_Scripting: Parameter helper: add configured and set defualt 2022-01-23 07:00:56 +11:00
Peter Barker
bd4aed80dc AP_Motors: tweak logging structure construction
const and avoid assignment rather just do initialisation

allows for static checking of narrowing conversions
2022-01-21 21:34:57 +11:00
Andrew Tridgell
9fd25907e2 HAL_SITL: fixed mapping of --serial ports in SITL
uart paths are still in uartABCD order
2022-01-21 10:07:55 +11:00
bugobliterator
46294c0fba AP_GPS: sync pps rate with message rate 2022-01-20 17:26:35 +11:00
bugobliterator
49b767b24e AP_GPS: add support for correcting GPS times while using DroneCAN GPS 2022-01-20 17:26:35 +11:00
bugobliterator
49bf4fa27b AP_GPS: move to using last_corrected_gps_time_us instead of uart_timestamp_us 2022-01-20 17:26:35 +11:00
bugobliterator
9834304525 AP_GPS: make more precise calculation of gps message
use PPS signal if available as well
2022-01-20 17:26:35 +11:00
Peter Barker
a6099acd5c AP_AHRS: return failure in pre_arm_check if unhealthy 2022-01-19 18:33:07 +11:00
ot0tot
13050b325b Tools: add JHEMCU GSF405A bootloader and ID 2022-01-19 18:31:05 +11:00
ot0tot
1a08a1e1a1 hwdef: add support for JHEMCU GSF405A 2022-01-19 18:31:05 +11:00
Josh Henderson
442cff4c60 SITL: helicopter add update_external_payload() for sensors 2022-01-19 18:21:32 +11:00
Peter Barker
2d0d2a123d AP_Airspeed: move Airspeed up to AP_Vehicle, use dummy class for Copter 2022-01-19 18:21:32 +11:00
Josh Henderson
1831a1a009 AP_Airspeed: NFC add note about TYPE 0 index 2022-01-19 18:21:32 +11:00
Josh Henderson
bf65b2eba8 AP_Airspeed: move default type for SITL to be for only Plane 2022-01-19 18:21:32 +11:00
Josh Henderson
af348e6ba1 AP_DAL: add define AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11:00
Josh Henderson
f219d56e9c AP_Frsky_Telem: add define AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11:00
Josh Henderson
9355fcd6b3 AP_Hott_Telem: add define AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11:00
Josh Henderson
65d4b6377e AP_LTM_Telem: add define AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11:00
Joshua Henderson
1aacd7ba02 AP_MSP: add define AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11:00
Joshua Henderson
3ff13733ea AP_OSD: add define AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11:00
Josh Henderson
56a30617e2 AP_RCTelemetry: add define AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11:00
Josh Henderson
0e662bbf35 AP_WindVane: add define AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11:00
Josh Henderson
382d4639a0 RC_Channel: add define AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11:00
Josh Henderson
319fec2b1f AP_Baro: add define AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11:00
Josh Henderson
f38c5d9c31 AP_Arming: add define AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11:00
Joshua Henderson
8a6942a9df AP_AHRS: add define AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11:00
Josh Henderson
fa9a852ef7 GCS_MAVLINK: move AP_Airspeed to AP_Vehicle 2022-01-19 18:21:32 +11:00
Joshua Henderson
ee273da50d AP_Vehicle: move Airspeed to AP_Vehicle 2022-01-19 18:21:32 +11:00
Joshua Henderson
3cfbad0f4d AP_Airspeed: add AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11:00
Josh Henderson
1200f25e05 GCS_MAVLINK: move high_latency_air_temperature up 2022-01-19 18:21:32 +11:00
Joshua Henderson
4e3a66a4d3 AP_Math: quaternion add is_zero() & zero()
& length_squared() &  add unit tests
2022-01-19 18:03:17 +11:00
Leonard Hall
7a9a0bfb3f AC_AttitudeControl: Support MAVLINK_MSG_ID_SET_ATTITUDE_TARGET 2022-01-19 18:03:17 +11:00
Andrew Tridgell
94c117fe62 AP_Logger: log original fw string if available 2022-01-19 08:07:45 +11:00
Andrew Tridgell
8b7ea70029 AP_Common: support AP_CUSTOM_FIRMWARE_STRING
this allows vendors to setup a custom firmware string in hwdef.dat,
which makes maintaining a vehicle specific firmware easier
2022-01-19 08:07:45 +11:00
Andrew Tridgell
d85dae8e50 AP_Scripting: added copy docs 2022-01-18 19:18:13 +11:00
Andrew Tridgell
d56840e4ef AP_Scripting: special case handling of copy method
allow for each copy() of Location, Vector2f and Vector3f without
adding special methods to each type in C++
2022-01-18 19:18:13 +11:00
Andrew Tridgell
3f2a72f9db AP_Compass: only magcal detected compasses
inflight compass learning with COMPASS_LEARN=3 was not working with
less than 3 compasses, as the force_use parameter was preventing
skipping compasses. This fixes it to calibate all detected compasses
that have USE enabled
2022-01-18 12:01:14 +11:00
Gone4Dirt
2599c2d134 RC_Channel: make AUXF.function an instance 2022-01-18 11:10:17 +11:00
Peter Barker
185ccaee92 AP_HAL_ChibiOS: disable UART stats based on GCS being enabled
We may need to revisit this if we are able to transfer these files over
some other mechanism into the future
2022-01-18 11:09:03 +11:00
chobits
051104a3f7 AP_RangFinder: support various maxbotix serial sonar 2022-01-18 11:08:34 +11:00
Willian Galvani
b5de26c1f2 AP_Hal_Linux: PCA9685: do not shutdown
Shutting down causes the pulses to be cut short, often causing
ESCs to interpret this pulse
2022-01-18 11:06:35 +11:00
Hwurzburg
176de8aa86 AP_HAL_ChibOS: update hwdef,defaults.readme for KakuteH7 2022-01-18 11:05:38 +11:00
Iampete1
86578d5cec AP_Motors: add local loging of MOTB 2022-01-18 10:18:10 +11:00
Iampete1
cf1202ae65 AP_Logger: add MOTB message 2022-01-18 10:18:10 +11:00
Peter Barker
c1c329e2b4 AP_InertialSensor: add and use AP_SIM_INS_ENABLED 2022-01-17 19:14:39 +11:00
Peter Barker
a31ff08f23 AP_AHRS: create and use AP_AHRS_SIM_ENABLED 2022-01-17 19:12:56 +11:00
Peter Barker
ed608d37f6 AP_Compass: add and use AP_SIM_COMPASS_ENABLED 2022-01-17 15:24:02 +11:00
Andrew Tridgell
48abb57a8a AP_EFI: added support for Lutan EFI system 2022-01-17 15:16:24 +11:00
Andrew Tridgell
5cb0d5c188 AP_EFI: use degF_to_Kelvin for megasquirt 2022-01-17 15:16:24 +11:00
Andrew Tridgell
319592a148 AP_Math: added degF_to_Kelvin() 2022-01-17 15:16:24 +11:00
Andrew Tridgell
367503be91 AP_SerialManager: allow for EFI serial option for non-MS protocols 2022-01-17 15:16:24 +11:00
Randy Mackay
cff3794d25 AP_NavEKF3: minor spelling fixes 2022-01-17 11:30:47 +09:00
Randy Mackay
88a3bfeccb AP_NavEKF2: minor spelling fixes 2022-01-17 11:29:39 +09:00
VMsunghwan
3febd78943 SITL : Update Telemetry
telemetery -> telemetry
2022-01-17 11:26:34 +09:00
VMsunghwan
e3c116c9fb AP_PiccoloCAN : Update Telemetry
telemtry -> telemetry
2022-01-17 11:26:34 +09:00
VMsunghwan
5bf24cd54c AP_ESC_Telem : Update Telemetry
telemtry -> telemetry
2022-01-17 11:26:34 +09:00
VMsunghwan
e669902b9f AP_RSSI : Update Telemetry
telemtry -> telemetry
2022-01-17 11:26:34 +09:00
VMsunghwan
599650554c AP_EFI : Update Calculation
calcualtion -> calculation
2022-01-17 11:25:56 +09:00
VMsunghwan
db9c1bbfaf AP_NavEKF3 : correct typo
receverPosDownMax -> receiverPosDownMax
receverPosDownMin -> receiverPosDownMin
calcuate -> calculate
2022-01-17 11:25:56 +09:00
VMsunghwan
b34d28fc7a AP_NavEKF2 : correct comment typo
calcuate -> calculate
2022-01-17 11:25:56 +09:00
VMsunghwan
bd76c30768 AP_NavEKF2 : correct variable typo
receverPosDownMax -> receiverPosDownMax
receverPosDownMin -> receiverPosDownMin
2022-01-17 11:25:56 +09:00
Peter Barker
721ede206d AP_Baro: create and use HAL_SIM_BARO_ENABLED 2022-01-17 13:13:05 +11:00
Jaaaky
20b3add9fb GCS_Common: Fix issue #19599 Failed to build Pixhawk1 with O3 2022-01-17 08:33:27 +11:00
Jaaaky
f80a9ba3ce AP_InertialSensor: Fix issue #19599 Failed to build Pixhawk1 with O3
As suggested by @tridge
2022-01-17 08:33:27 +11:00
Peter Barker
ee341bc4eb SITL: add compilation option AP_SIM_CRSF_ENABLED 2022-01-15 21:56:33 +11:00
Peter Barker
08b8d3ad34 AP_HAL_SITL: correct compilation when SIM options disabled
AP_HAL_SITL: use AP_ASIM_GIMBAL_ENABLED

AP_HAL_SITL: use AP_SIM_ADSB_ENABLED

AP_HAL_SITL: use AP_SIM_RPLIDARA2_ENABLED

AP_HAL_SITL: use AP_SIM_PS_LIGHTWARE_SF45B_ENABLED

AP_HAL_SITL: use AP_SIM_PS_TERRARANGERTOWER_ENABLED

AP_HAL_SITL: use AP_SIM_AIS_ENABLED

AP_HAL_SITL: use AP_SIM_JSON_MASTER_ENABLED
2022-01-15 17:37:24 +11:00
Peter Barker
bff0b6f970 SITL: add and use AP_SIM_GPS_FILE_ENABLED 2022-01-15 17:36:22 +11:00
Peter Barker
e6779e91e6 SITL: allow JEDEC/RAMTRON to be compiled out
SITL: add and use AP_SIM_RAMTRON_ENABLED

SITL: add an use AP_SIM_JEDEC_ENABLED
2022-01-15 13:50:21 +11:00
HefnySco
b80393b2cd AP_HAL_Linux: supporting RPI-Zero 2 W 2022-01-14 00:32:51 -08:00
Tom Pittenger
0475dd1e79 AP_Scripting: add example of arming check for wp index = 1 and is a takeoff 2022-01-14 10:07:11 +09:00
Peter Barker
c5f21664db AP_GPS: correct compilation when SIRF disabled 2022-01-14 11:49:01 +11:00
Jaaaky
22e1ea559c SITL: Fix typo (NFC) 2022-01-13 14:01:21 -08:00
Iampete1
8b54665a48 AP_Motors: example: remove SRV_Channels calls 2022-01-13 23:33:34 +11:00
Peter Barker
19ff65a4ad AP_EFI: make C_TO_KELVIN a function macro; create KELVIN_TO_C 2022-01-13 18:31:46 +11:00
Peter Barker
9ef959b93b SITL: make C_TO_KELVIN a function macro; create KELVIN_TO_C
These are in celsius
2022-01-13 18:31:46 +11:00
Peter Barker
7db723981c AP_UAVCAN: make C_TO_KELVIN a function macro; create KELVIN_TO_C
These are in celsius
2022-01-13 18:31:46 +11:00
Peter Barker
c86ebc7ffb AP_EFI: make C_TO_KELVIN a function macro; create KELVIN_TO_C
These are in celsius
2022-01-13 18:31:46 +11:00
Peter Barker
d028a6efc3 AP_CANManager: make C_TO_KELVIN a function macro; create KELVIN_TO_C
These are in celsius
2022-01-13 18:31:46 +11:00
Peter Barker
a894b93762 AP_BattMonitor: make C_TO_KELVIN a function macro; create KELVIN_TO_C
These are in celsius
2022-01-13 18:31:46 +11:00
Peter Barker
e710969ebb AP_Baro: make C_TO_KELVIN a function macro; create KELVIN_TO_C
These are in celsius
2022-01-13 18:31:46 +11:00
Peter Barker
3969d6d56f AP_Airspeed: make C_TO_KELVIN a function macro; create KELVIN_TO_C
These are in celsius
2022-01-13 18:31:46 +11:00
Peter Barker
e988bf9046 AP_Math: add KELVIN_TO_C define 2022-01-13 18:31:46 +11:00
VMsunghwan
224cea979e SITL : fixed typo
line 1119 in pnet.c : to to -> to
line 198 in SIM_Plane.cpp : to to -> to
2022-01-13 09:45:39 +11:00
VMsunghwan
a49bab158f AP_VideoTX : fixed typo
line 610 : to to -> to
2022-01-13 09:45:39 +11:00
murata
414ca96e5c AP_Math: Move crc16-ibm CRC calculation method to a common class 2022-01-13 09:44:40 +11:00
murata
ddfd4a2e9e AP_RobotisServo: Move crc16-ibm CRC calculation method to a common class 2022-01-13 09:44:40 +11:00
Andrew Tridgell
d22e3a1f52 hwdef: fixed flash double reserve
fixes #19765, an alternative to #19768

the advantage of this approach is it is less error prone, as the
actual position and size of the storage sectors is calculated
2022-01-13 06:44:46 +11:00
Willian Galvani
c285f4c748 AP_Compass: Retry reading MMC5983 ID up to 10 times 2022-01-12 11:03:15 -05:00
Dr.-Ing. Amilcar do Carmo Lucas
87b0db7990 SITL: correct typos in comments 2022-01-12 16:47:42 +09:00
Peter Barker
4c72d0f562 AP_HAL_ChibiOS: disable UART statistics on Hitec-Airspeed 2022-01-12 18:30:49 +11:00
Peter Barker
3a1340236a AP_HAL: add HAL_UART_STATS_ENABLED to disable stats gathering 2022-01-12 18:30:49 +11:00
Peter Barker
cea57f51c1 AP_HAL_Empty: add HAL_UART_STATS_ENABLED to disable stats gathering 2022-01-12 18:30:49 +11:00
Peter Barker
875f9a9497 AP_HAL_ChibiOS: add HAL_UART_STATS_ENABLED to disable stats gathering 2022-01-12 18:30:49 +11:00
Peter Barker
aaf8de88d8 AP_Filesystem: add HAL_UART_STATS_ENABLED to disable stats gathering 2022-01-12 18:30:49 +11:00
Peter Barker
8d17b8dbe7 AP_GPS: use const structure for saving GPS config 2022-01-12 18:29:01 +11:00
Peter Barker
1943de9016 AP_GPS: tidy configuration of UBLOX rates 2022-01-12 18:29:01 +11:00
Andy Piper
368a0c74a1 AP_HAL_ChibiOS: fix UART operation on original OmnibusNanoV6 2022-01-12 18:17:08 +11:00
Joshua Henderson
d77105b3b1 SITL: Gimbal make some printfs #if GIMBAL_DEBUG 2022-01-12 18:03:27 +11:00
Joshua Henderson
dd8daa05fc AP_Mount: add mount mode to MOUNT_STATUS 2022-01-12 18:03:27 +11:00
Hwurzburg
3d4f6cc2c4 AP_GPS: add build options for GPS backends 2022-01-12 16:17:21 +11:00
Randy Mackay
8bbdd4825f AP_Math: minor control spelling and format fixes 2022-01-12 13:07:15 +09:00
Pierre Kancir
6584fef711 AP_HAL_SITL: catch more signal for correct exit
SIGINT is for ctrl-c
SIGHUP and SIGQUIT are use within term. If the term close before SITL, it will trigger one of those and then exit cleanly anyway
2022-01-12 12:31:56 +11:00
Mark Whitehorn
5f7f1cff2b AP_Logger: fix _RATEMAX parameter descriptions 2022-01-12 10:15:45 +11:00
Hwurzburg
21b7a8b682 AP_SerialManager: add metadata for merged new protocols 2022-01-12 08:18:11 +11:00
Hwurzburg
970e5f829b AP_NavEKF3: remove user unintelligible GCS message 2022-01-12 08:11:18 +11:00
Andrew Tridgell
19d2dcb413 SITL: removed unnecessary SIM_GPS_DELAY parameters 2022-01-12 07:54:46 +11:00
Andrew Tridgell
df30d4e723 SITL: support interpolated GPS lag
use SIM_GPS_LAG_MS and SIM_GPS2_LAG_MS for the lag in milliseconds
2022-01-12 07:54:46 +11:00
Andrew Tridgell
09cd7558c3 AP_GPS: drop default GPS lag to 0.1s
this impacts UAVCAN GPS modules, which these days usually have at
least u-blox M8
2022-01-12 07:54:46 +11:00
Randy Mackay
39b0d76121 AC_PID: minor format fix 2022-01-11 13:09:34 +09:00
Peter Barker
fc46fe71f0 AP_Logger: fix memory leak logging files at startup 2022-01-11 14:18:14 +11:00
Peter Barker
ee7e652367 AP_Arming: fix memory leak logging files at startup 2022-01-11 14:18:14 +11:00
Peter Barker
2af5c51ac7 AP_HAL_ChibiOS: save flash on the BeastF7v2
Note that many of these entries are already excluded by BeastF7 which
this hwdef inherits from
2022-01-11 13:25:13 +11:00
Andrew Tridgell
b449e45ed6 AP_Filesystem: fixed a param ftp bug
if param count changes we need to zero the file size
2022-01-11 13:04:53 +11:00
Andrew Tridgell
7242b6e3e5 AP_Param: make accessing var_info() a bit more efficient 2022-01-11 13:04:53 +11:00
Andrew Tridgell
10b1f46997 AP_Scripting: added bindings for adding parameter tables 2022-01-11 13:04:53 +11:00
Andrew Tridgell
1343af85e2 AP_Param: added support for dynamic parameter tables
this allows for up to 10 dynamic tables to be added by scripts. The
parameter tables can have up to 63 float parameters
2022-01-11 13:04:53 +11:00
Andrew Tridgell
1ecb129afa hwdef: fixed 3 incorrect storage sizes
can't do 16384 in 16k sector flash storage
2022-01-11 11:33:30 +11:00
Andrew Tridgell
d4eb2919ef hwdef: fixed HAL_STORAGE_SIZE for MatekF405-TE 2022-01-11 11:33:30 +11:00
Andrew Tridgell
59b2a30c11 HAL_ChibiOS: added check for valid HAL_STORAGE_SIZE 2022-01-11 11:33:30 +11:00
Andrew Tridgell
3b70b3e7a7 AP_HAL: check for existing HAL_STORAGE_SIZE 2022-01-11 11:33:30 +11:00
Andrew Tridgell
de273fb76d hwdef: fixed f405-MatekGPS storage location and CAN
this allows for CAN firmware update using f405-MatekGPS bootloader by
fixing a typo, then moves storage to allow the bootloader with can to
fit on the board

this will allow CAN update of peripheral firmware for Matek GPS and
airspeed sensors
2022-01-11 11:33:30 +11:00
Andrew Tridgell
1236474cfb HAL_ChibiOS: give an error if STORAGE_FLASH_PAGE overflash flash
when storage is between the bootloader and main program flash then the
flash size available to the bootloader needs to stop at the sector for
the storage flash.

Similarly, if storage is at the end of flash, then total flash size
needs to be limit

this ensures we don't try to build a firmware that encroaches on
program space
2022-01-11 11:33:30 +11:00
Peter Barker
99a3d253db AP_RPM: move RPM sensor logging into AP_RPM 2022-01-11 11:09:26 +11:00
Leonard Hall
894b491faa AC_AttitudeControl: AC_PosControl: Clean up init functions and limit initial xy accelerations based on max lean angle 2022-01-11 11:00:41 +11:00
Andy Piper
835e0be245 AP_Logger: support Winbond W25X32 for KakuteH7Mini 2022-01-11 10:58:55 +11:00
Andy Piper
a533fadf1b AP_HAL_ChibiOS: support KakuteH7Mini 2022-01-11 10:58:55 +11:00
Leonard Hall
5a97a232e7 AC_AutoTune: Move rate limit to AC_AttitudeControl 2022-01-11 10:57:53 +11:00
Leonard Hall
0bdf34dc57 AC_AttitudeControl: Respect rate limit in max_rate_step 2022-01-11 10:57:53 +11:00
Peter Hall
1fde5b3ef1 AP_Motors: tailsitter: add external min throttle limit 2022-01-11 10:37:38 +11:00
Andrew Tridgell
135c88d474 AP_GPS: use KSXT for position and alt when available
this gets velocity and position from the same message for more
consistency
2022-01-11 10:34:11 +11:00
Andrew Tridgell
9d21c0b6c1 AP_GPS: added GPS data logging system
for debugging GPS protocols
2022-01-11 10:34:11 +11:00
Andrew Tridgell
27cec48b82 AP_GPS: support KSXT message for Unicore NMEA
this gives both yaw and 3D velocity
2022-01-11 10:34:11 +11:00
Andrew Tridgell
c565b8a84e SITL: support KSXT message for Unicore NMEA 2022-01-11 10:34:11 +11:00
Andrew Tridgell
4733f57102 RC_Channel: don't use avoidance on plane 2022-01-11 09:51:47 +11:00
Andrew Tridgell
06dcd5a16f GCS_MAVLink: don't use avoidance on plane 2022-01-11 09:51:47 +11:00
Andrew Tridgell
2435c9451c AC_Avoidance: don't build avoidance on plane
this catches uses of avoidance which cause it to be linked in
2022-01-11 09:51:47 +11:00
Andrew Tridgell
6e5bb1eb23 AC_WPNav: don't link AC_Avoid on plane
saves about 7k of flash
2022-01-11 09:51:47 +11:00
HefnySco
88f4eb6017 AP_HAL_Linux: RPI-CM4 detection 2022-01-10 12:21:09 -08:00
Joshua Henderson
78819a1c97 AP_Param: fix convert_class when index is 0 2022-01-10 19:31:45 +00:00
Randy Mackay
c0855a0d1e AP_Mission: add ChangeDetector
Detects changes in the next few nav commands in the mission so SCurves and Splines can handle them elegantly
2022-01-10 08:19:16 +09:00
Peter Barker
03e9307bdd AP_HAL_ChibiOS: add MANUFACTURER and BRAND_NAME to PixRacer Pro 2022-01-07 22:46:52 +11:00
Randy Mackay
9d12130689 AC_PID_2D: minor format fix 2022-01-07 13:41:16 +09:00
Randy Mackay
91d40b768c AR_AttitudeControl: get_throttle_speed_pid_info.FF includes base throttle 2022-01-07 09:36:44 +09:00
khanasif786
c50b8597db AP_Proximity: Removed AP_Proximity_LightWareSF40C_v09
deleted older drivers for fixing running out of flash space in some boards
2022-01-07 08:28:59 +09:00
Willian Galvani
dc856f10eb AP_HAL_Linux: set internal/external i2c bus masks for Navigator
This fixes an issue where the internal Compass was being re-detected
as an external one, then as an internal but with wrong orientation
2022-01-06 14:45:42 -05:00
Iampete1
c21ec13719 AP_Scripting: support feild alias s 2022-01-06 22:30:58 +11:00
Iampete1
dad0f0c3c0 AP_Scripting: add binding for AP::fwversion 2022-01-06 22:30:58 +11:00
Iampete1
18d0687847 AP_Scripting: support singleton feild types 2022-01-06 22:30:58 +11:00
Iampete1
9ccf17488d AP_Scripting: allow singleton types as refrence rather than pointer 2022-01-06 22:30:58 +11:00
Peter Barker
d86c1c6fd1 AP_OpticalFlow: fix example when OpticalFlow compiled out 2022-01-06 13:35:51 +11:00
Peter Barker
81d205465c hwdef: remove OpticalFlow from builds in several low-flash boards 2022-01-06 13:35:51 +11:00
李孟晓
94b14ae60b hwdef: CUAV-Nora: Add servo voltage detection pin 2022-01-06 12:39:45 +11:00
Dr.-Ing. Amilcar do Carmo Lucas
d7c2331664 AP_Arming: fix comment (NFC) 2022-01-06 09:15:54 +11:00
Dr.-Ing. Amilcar do Carmo Lucas
95effd59ea AP_FETtecOneWire: Fix spelling in comments (NFC) 2022-01-06 09:15:54 +11:00
phil tokumaru
bfded82da5 AP_HAL_ChibiOS: STM32F777xx.py: correct pincount for J and K 2022-01-06 09:15:14 +11:00
Peter Barker
948e00a072 GCS_MAVLink: make send_system_time const
needed when sending from const functions
2022-01-06 09:14:33 +11:00
Pierre Kancir
a01bd33f69 AP_Logger: fix size compare warning
df_PageSize is uint32_t
2022-01-06 09:13:54 +11:00
Pierre Kancir
7a8cef877b AP_Logger: fix implicit instanciation order, base class first 2022-01-06 09:13:54 +11:00
Pierre Kancir
89e5e7f5c5 AP_Logger: fix clang-tidy warning about non correct check
strncmp return both positive and negative value, therefore is it better to implicitly compare to 0
2022-01-06 09:13:54 +11:00
Pierre Kancir
4add35355e AP_Logger: use nullptr 2022-01-06 09:13:54 +11:00
Peter Barker
fdfdc9f999 AP_OpticalFlow: remove un-needed forward AP_AHRS declaration 2022-01-06 09:12:59 +11:00
Tom Pittenger
c82866dff8 RC_Channel: fix typo, again
correctly fixes https://github.com/ArduPilot/ardupilot/pull/19663
2022-01-05 19:23:46 +00:00
Iampete1
efb04e7f30 AP_AHRS: add video stab log message 2022-01-05 19:56:03 +11:00
Iampete1
cee0503812 AP_Logger: add video stab log structure 2022-01-05 19:56:03 +11:00
Iampete1
cc5a867397 AP_Scripting: add binding for setting motors custom frame string 2022-01-05 19:51:19 +11:00
Iampete1
70897b5e38 AP_Motors: allow custom frame string from scripting 2022-01-05 19:51:19 +11:00
Iampete1
7aca392dad AP_NavEKF2: don't include log structures if not enabled 2022-01-05 19:39:06 +11:00
Andy Piper
c357c1e521 AP_HAL_ChibiOS: hwdef for BeastF7 v2
Fix undef of alt pins
2022-01-05 18:50:41 +11:00
Pierre Kancir
f50f8c7a2a AP_Logger: fix memory leak 2022-01-05 18:07:30 +11:00
Mirko Denecke
763f768c30 RC_Channel: fix typo 2022-01-05 17:00:45 +11:00
Peter Barker
80178f5d07 AP_InertialSensor: mark FTN as a streamed message 2022-01-05 16:34:36 +11:00
Peter Barker
db6bb8d616 AP_Vehicle: move INS notch filter logging into INS 2022-01-05 16:34:36 +11:00
Peter Barker
6084682634 AP_InertialSensor: move INS notch filter logging into INS 2022-01-05 16:34:36 +11:00
Peter Barker
c9eb7e3eda AP_GyroFFT: make vehicles write notch log messages 2022-01-05 16:34:36 +11:00
MallikarjunSE
adff48c3ea hwdef: remove Notify LEDs from Sierra-F405
NTF_LED_BRIGHT 2, NTF_LED_LEN 8 used to cause board to get stuck in bootloader on reboot.
2022-01-05 09:22:45 +11:00
Andrew Tridgell
3f160b4910 Revert "AP_GPS: drop default GPS lag to 0.1s"
This reverts commit 1e60d2557b.
2022-01-04 19:02:54 +00:00
Lucas De Marchi
83f20ac66a AP_Logger: fix build with mavlink debug enabled 2022-01-04 07:25:28 -08:00
Lucas De Marchi
1ab005dc99 AP_Logger: use stderr for debug
Make AP_Logger_MAVLink use stderr, so it's easier to follow the debug
outputs without mixing with normal output.  And this is also what
AP_Logger is using.
2022-01-04 07:25:28 -08:00
Randy Mackay
7744dda4b0 AC_WPNav: add comment above get_wp_radius_cm 2022-01-04 16:44:13 +09:00
Iampete1
ec4949c9e3 AP_Scripting: generator: use depends for singleton strings 2022-01-04 11:40:33 +11:00
Andrew Tridgell
1e60d2557b AP_GPS: drop default GPS lag to 0.1s
this impacts UAVCAN GPS modules, which these days usually have at
least u-blox M8
2022-01-03 16:39:07 -08:00
Iampete1
5e38f34a5d AP_Frsky_Telem: use set_and_save_by_name directly 2022-01-04 11:26:29 +11:00
Iampete1
1711fa9807 AP_Scripting: use alias for param function names 2022-01-04 11:26:29 +11:00
Iampete1
af83b1efd2 AP_Param: remove scripting function name helpers 2022-01-04 11:26:29 +11:00
Peter Barker
f44335371f hwdef: set AP_OPTICALFLOW_ENABLED 0 for SkyViper-v2450 2022-01-04 11:01:40 +11:00
Willian Galvani
1dad7b2d56 HAL_Linux: update SPI speeds for Navigator
As @jaxxzer found out, if SCL goes under 1MHz, the MMC sometimes
glitches out, freezing.
2022-01-03 15:05:47 -03:00
Willian Galvani
725765c1cb AP_HAL: fix navigator ak09915 orientation 2022-01-03 15:05:47 -03:00
Willian Galvani
d3e3922776 AP_HAL: Add HAL_PROBE_EXTERNAL_I2C_COMPASSES to Navigator 2022-01-03 15:05:47 -03:00
Randy Mackay
53135b2df0 AR_AttitudeControl: improve get_turn_lat_accel accessor comments 2022-01-03 09:07:21 +09:00
Peter Barker
295276cd37 AP_Vehicle: pass GyroFFT loop rate in Hz rather than period in us
It just calculates this anyway
2021-12-31 11:15:20 +11:00
Peter Barker
9ea9c15c6a AP_GyroFFT: pass GyroFFT loop rate in Hz rather than period in us
It just calculates this anyway

Also stops assigning a uint16_t value into a uint32_t value
2021-12-31 11:15:20 +11:00
Andy Piper
f9e14ffa30 AP_HAL_ChibiOS: add support BeastF7v2 2021-12-31 09:25:29 +11:00
Andy Piper
3fd79b8ffb AP_InertialSensor: BMI270 driver 2021-12-31 09:25:29 +11:00
Andrew Tridgell
7c8794b0bd AP_InertialSensor: fixed INS_generic example
useful for driver development
2021-12-30 10:02:35 +11:00
Andrew Tridgell
c44b8cf73a AP_Motors: fixed PWM_TYPE range for quadplanes
when motors don't start at SERVO1 we were applying the range to the
wrong output.

This allows users to control the PWM of individual motors precisely
for quadplanes where calibration of motors is difficult
2021-12-29 18:40:41 +11:00
Andrew Tridgell
662327f2ea AP_InertialSensor: added support for more ADIS IMUs
support 32 bit delta angles and velocities
2021-12-29 18:25:18 +11:00
Peter Barker
f361d9b0d0 AP_OpticalFlow: create and use AP_OPTICALFLOW_ENABLED 2021-12-29 18:12:03 +11:00
Peter Barker
d2693e4276 GCS_MAVLink: create and use AP_OPTICALFLOW_ENABLED
Including a define for each backend.
2021-12-29 18:12:03 +11:00
Peter Barker
a741499cff AP_UAVCAN: create and use AP_OPTICALFLOW_ENABLED
Including a define for each backend.
2021-12-29 18:12:03 +11:00
Peter Barker
1b0f21e2a3 AP_Scripting: create and use AP_OPTICALFLOW_ENABLED
Including a define for each backend.
2021-12-29 18:12:03 +11:00
Peter Barker
99ccbee474 AP_OpticalFlow: create and use AP_OPTICALFLOW_ENABLED
Including a define for each backend.
2021-12-29 18:12:03 +11:00
Peter Barker
ca8436ba5d AP_DAL: create and use AP_OPTICALFLOW_ENABLED
Including a define for each backend.
2021-12-29 18:12:03 +11:00
Peter Barker
268032e640 SITL: add missing include file for terrain 2021-12-29 16:10:17 +11:00
Andrew Tridgell
fa2ae44926 AP_BattMonitor: fixed a segv with BATT_MONITOR=14
this causes a hang on boot on some boards
2021-12-29 10:51:35 +11:00
MallikarjunSE
3ff9b76b08 AP_HAL_ChibiOS: Sierra-F405 support 2021-12-29 10:13:54 +11:00
MallikarjunSE
eb8cfea507 AP_HAL_ChibiOS: Sierra-F412 support 2021-12-29 10:12:40 +11:00
Andrew Tridgell
7c57e1521c AP_Filesystem: support formatting of SDcard on ChibiOS 2021-12-28 16:04:57 +11:00
Andrew Tridgell
61ecf0c443 HAL_ChibiOS: cleanup SDMMC enable defines
ensure both are set
2021-12-28 16:04:57 +11:00
Andrew Tridgell
f8e4d7facd GCS_MAVLink: support formatting of SD card 2021-12-28 16:04:57 +11:00
Andrew Tridgell
146f394d64 HAL_ChibiOS: include fatfs format code 2021-12-28 16:04:57 +11:00
Andrew Tridgell
45bfc75e4b AP_Compass: added register checking for AK09916 mode
this allows AK09916 on I2C to recover from a power outage in flight
2021-12-28 16:04:36 +11:00
Andrew Tridgell
a33febd90a AP_NavEKF3: fixed gaps in EKF logging
timestamps should not be static as otherwise some lanes will not be
logged
2021-12-28 16:03:47 +11:00
Andrew Tridgell
52209d9d1a AP_NavEKF2: fixed gaps in EKF logging
timestamps should not be static as otherwise some lanes will not be
logged
2021-12-28 16:03:47 +11:00
Andrew Tridgell
281f041abb hwdef: fixed debug pins on two boards bootloaders 2021-12-28 10:31:25 +11:00
Andrew Tridgell
237e71b95f AP_BoardConfig: disable STLink debug pins by default
this avoids leaving the debug pins in a state where they may be
vulnerable to ESD issues
2021-12-28 10:31:25 +11:00
Peter Barker
d8d73eb44c AP_OpticalFlow: adjust for backend file name change 2021-12-28 10:16:20 +11:00
Peter Barker
3a22ee2cc7 AP_OpticalFlow: rename OpticalFlow_backend files to include AP_ 2021-12-28 10:16:20 +11:00
Peter Barker
20c91c03a2 AP_OpticalFlow: rename OpticalFlow.cpp to AP_OpticalFlow.cpp 2021-12-28 10:16:20 +11:00
Peter Barker
6936a8eb6e GCS_MAVLink: adjust for rename of OpticalFlow.h to AP_OpticalFlow.h 2021-12-28 10:16:20 +11:00
Peter Barker
f99f2bd8ab AP_Scripting: adjust for rename of OpticalFlow.h to AP_OpticalFlow.h 2021-12-28 10:16:20 +11:00
Peter Barker
3030c0b4f8 AP_OpticalFlow: adjust for rename of OpticalFlow.h to AP_OpticalFlow.h 2021-12-28 10:16:20 +11:00
Peter Barker
e8fc4b33e1 AP_OpticalFlow: move OpticalFlow.h to AP_OpticalFlow.h 2021-12-28 10:16:20 +11:00
Andrew Tridgell
6a2303f72d hwdef: enable telem3 (SERIAL5) TX on Pix32v5
this is now safe as we disable the TX/RX pins on ports with
SERIALn_PROTOCOL = -1

as this board defaults to protocol -1 for SERIAL5, we can enable this
if the user wishes to use telem3
2021-12-28 10:13:58 +11:00
Andrew Tridgell
97fee2d1cc AP_VisualOdom: added VOXL backend type
this will make it easier to have custom behaviour for VOXL
2021-12-27 12:32:41 +11:00
Andrew Tridgell
8654ea886d AP_VisualOdom: support error estimates with quaternion 2021-12-27 12:32:41 +11:00
Andrew Tridgell
20dd667fdc GCS_MAVLink: support ODOMETRY message for VIO
used by VOXL
2021-12-27 12:32:41 +11:00
Andrew Tridgell
05f112ea17 SITL: support simulation of ODOMETRY message 2021-12-27 12:32:41 +11:00
Nikolay March
cceae1acf3 hwdef: Redefine DMA priority PH4-mini
BUG.
Without redefining priority there is no DMA on any RX of serial ports.
Now it is.
Without DMA, you cannot normally use the serial port for the CRSF protocol.
2021-12-27 11:25:51 +11:00
Shiv Tyagi
fa6adc0beb SITL: add JEDEC dataflash simulator
We currently use AP_Logger_SITL for this purpose but we can instead add a dataflash simulator which can work with existing AP_Logger_Dataflash backend instead of using AP_Logger_SITL.

Co-Authored-By: Divyateja Pasupuleti <divyateja2004@gmail.com>
2021-12-25 09:14:31 +11:00
Shiv Tyagi
3533e1e0ed AP_Logger: remove AP_Logger_SITL
We now use jedec dataflash simulator for this purpose. Hence, we should remove these files and all references to HAL_LOGGING_SITL_ENABLED

Co-Authored-By: Divyateja Pasupuleti <divyateja2004@gmail.com>
2021-12-25 09:14:31 +11:00
Shiv Tyagi
af950e266b AP_HAL_SITL: add dataflash to spi device table
We simulate jedec flash for logging. Hence, we need to add dataflash to device table. Also, we need to remove HAL_LOGGING_SITL_ENABLED since we no longer need it

Co-Authored-By: Divyateja Pasupuleti <divyateja2004@gmail.com>
2021-12-25 09:14:31 +11:00
Peter Barker
939407a26f AP_NMEA_Output: remove pointless use of intermediate res variables 2021-12-23 21:04:18 +11:00
Peter Barker
97ea8b52af AP_Baro: KellerLD: clean up reading of calibration data
Co-authored-by: Josh Henderson <hendjoshsr71@gmail.com>

Checks all return values from transfer functions to avoid use of
uninitialised data.
2021-12-22 18:50:58 +11:00
yaapu
c0663da918 AP_RCTelemetry: added ExpressLRS support 2021-12-22 18:48:49 +11:00
yaapu
55bfa41d13 AP_RC_Protocol: added ExpressLRS support 2021-12-22 18:48:49 +11:00
yaapu
76bd10bf02 AP_RCProtocol: added custom telemetry frame types and subtypes to debug trace 2021-12-22 18:48:49 +11:00
mateksys
be601acd89 AP_HAL_ChibiOS: add MatekF405-TE hwdef 2021-12-22 18:47:37 +11:00
Peter Hall
98c5704b92 AP_TECS: add reset throttle I function 2021-12-22 18:46:14 +11:00
Andy Piper
fbaa2e7b09 AP_Math: allow selection of inline version of vector operations for performance. 2021-12-22 18:23:33 +11:00
Andy Piper
fbdeea2d03 Filter: optimize hot parts of notch filter updates 2021-12-22 18:23:33 +11:00
Andy Piper
6e3b502110 AP_InertialSensor: inline vector ops for backends and temp cal 2021-12-22 18:23:33 +11:00
Andy Piper
9ba1cbc9d8 AP_Vehicle: log up to 12 harmonic notch frequencies 2021-12-22 18:13:38 +11:00
Andy Piper
c50ccd1d09 AP_GyroFFT: use harmonics for harmonics and number of notches elsewhere
modify energy based on peak width
always log harmonic notch frequencies
2021-12-22 18:13:38 +11:00
Andy Piper
5259272326 AP_HAL_Empty: remove redundant harmonics from DSP 2021-12-22 18:13:38 +11:00
Andy Piper
fa91e74fde AP_HAL_SITL: remove redundant harmonics from DSP 2021-12-22 18:13:38 +11:00
Andy Piper
2fab99d647 AP_HAL_ChibiOS: remove redundant harmonics from DSP 2021-12-22 18:13:38 +11:00
Andy Piper
d4024d9216 AP_HAL: allow configuration of maximum number of notches based on MCU type
increase notch filters in SITL
remove redundant harmonics from DSP
2021-12-22 18:13:38 +11:00
Andy Piper
d44478ff59 AP_InertialSensor: calculate number of notches based on motor count
configure default harmonics if dynamic harmonics
set number of notches correctly for FFT operation
include static notch in filter calculation and allow harmonic options on static notch
2021-12-22 18:13:38 +11:00
Andy Piper
34920ebd60 Filter: allow harmonics and notch-per-motor in harmonic notch
allow default harmonics to be configured
allow combination of harmonics and indpendent centre frequencies
pre-calculate number of harmonics
2021-12-22 18:13:38 +11:00
arbalasquide
fd3c83c0d1 AP_Math: Add AUS_TO_MAH definition 2021-12-22 07:52:03 +11:00
arBalasquide
10b4eebce4 AP_BattMonitor: Add calculate_mah, add unit tests 2021-12-22 07:52:03 +11:00
Andrew Tridgell
08ca708347 AP_SerialManager: fixed AP_Periph GPS
the disable of RX/TX pins broke AP_Periph on boards that don't enable
the GCS, as they don't have the SERIALn parameters, so we disable the
UART pins of the GPS
2021-12-21 20:14:55 +11:00
Andrew Tridgell
ba58558bd1 SITL: fixed default BATT_CAPACITY for SITL
don't override from JSON model unless we have a value
2021-12-21 19:53:43 +11:00
Mingchen Zhang
61e0c5b6e7 AP_SmartAudio: fix a bug that would starve the lower priority thread, such as scripting. 2021-12-21 16:03:44 +09:00
Randy Mackay
e41cad8bd7 SRV_Channel: minor param desc format fix 2021-12-21 14:45:49 +09:00
Brad Stinson
cd39110b68 hwdef: add support for PixC4-Jetson
add support for building IOMCU with F103 and 8MHz clock
2021-12-21 13:05:34 +11:00
Andrew Tridgell
a39040d864 AC_AutoTune: limit autotune target rates to parameter limits
this makes it safer to autotune a large vehicle which may become
unstable at very high target rates
2021-12-21 11:02:51 +09:00
Andrew Tridgell
53f1fc1295 AC_AttitudeControl: added get_ang_vel_yaw_max_rads() 2021-12-21 11:02:51 +09:00
Andrew Tridgell
178ae9e0c1 AP_RCTelemetry: use have_serial when detecting
avoid find_serial() as it changes port options
2021-12-21 11:07:44 +11:00
Andrew Tridgell
366ff24941 AP_RangeFinder: use have_serial when detecting
avoid find_serial() as it changes port options
2021-12-21 11:07:44 +11:00
Andrew Tridgell
93d8a0606f AP_Proximity: use have_serial when detecting
avoid find_serial() as it changes port options
2021-12-21 11:07:44 +11:00
Andrew Tridgell
0da0f6dd37 AP_ADSB: use have_serial when detecting
avoid find_serial() as it changes port options
2021-12-21 11:07:44 +11:00
Andrew Tridgell
47590a55ff AP_RCProtocol: allow changes of serial settings between protocols
if we are searching for new protocols then allow for baudrate table
changes
2021-12-21 11:07:44 +11:00
Andrew Tridgell
deb2d6b782 AP_SerialManager: added have_serial() method
this checks if we have the protocol without setting the options on the
uart
2021-12-21 11:07:44 +11:00
Peter Barker
600b085cf3 AP_Logger: correct constraint of maximum message ID 2021-12-21 10:42:18 +11:00
Peter Barker
168f278959 AP_Logger: reallocate 32 IDs from vehicles to main message area
ArduPlane uses ~18 messages and the list is relatively static, so this
should be a reasonable reallocation.

We're using a lot of Log_Write(...) to create messages dynamically - but
that requires IDs and we only left space for about 18 before this patch

More space is left to ease future use of IDs in some libraries
2021-12-21 10:42:18 +11:00
Jaaaky
db8d08b349 SRV_Channel: Fix multi #include's 2021-12-21 10:38:46 +11:00
Jaaaky
71154105e4 SITL: Fix multi #include's 2021-12-21 10:38:46 +11:00
Jaaaky
e991bff0d5 AP_VisualOdom: Fix multi #include's 2021-12-21 10:38:46 +11:00
Jaaaky
3008a480d5 AP_UAVCAN: Fix multi #include's 2021-12-21 10:38:46 +11:00
Jaaaky
37a08507df AP_ToshibaCAN: Fix multi #include's 2021-12-21 10:38:46 +11:00
Jaaaky
e92c900b56 AP_Scheduler: Fix multi #include's 2021-12-21 10:38:46 +11:00
Jaaaky
8512652511 AP_RCTelemetry: Fix multi #include's 2021-12-21 10:38:46 +11:00
Jaaaky
91e3441c6d AP_RCProtocol: Fix multi #include's 2021-12-21 10:38:46 +11:00
Jaaaky
485227b2c1 AP_Param: Fix multi #include's 2021-12-21 10:38:46 +11:00
Jaaaky
da3b064a31 AP_OSD: Fix multi #include's 2021-12-21 10:38:46 +11:00
Jaaaky
bbb38504d6 AP_InertialSensor: Fix multi #include's 2021-12-21 10:38:46 +11:00
Jaaaky
08d44815f6 AP_HAL_Linux: Fix multi #include's 2021-12-21 10:38:46 +11:00
Jaaaky
f588b08004 AP_HAL_ESP32: Fix multi #include's 2021-12-21 10:38:46 +11:00
Jaaaky
f1f31c1aef AP_HAL_ChibiOS: Fix multi #include's 2021-12-21 10:38:46 +11:00
Jaaaky
60fcfae2de AP_GyroFFT: Fix multi #include's 2021-12-21 10:38:46 +11:00
Jaaaky
6433547592 AP_GPS: Fix multi #include's 2021-12-21 10:38:46 +11:00
Jaaaky
c7b1e05f1d AP_FETtecOneWire: Fix multi #include's 2021-12-21 10:38:46 +11:00
Jaaaky
bfb9b1ac73 AP_Declination: Fix multi #include's 2021-12-21 10:38:46 +11:00
Jaaaky
d27f122295 AP_Compass: Fix multi #include's 2021-12-21 10:38:46 +11:00
Jaaaky
f8f9038092 AP_Baro: Fix multi #include's 2021-12-21 10:38:46 +11:00
Jaaaky
0c16ebec6c AC_PrecLand: Fix multi #include's 2021-12-21 10:38:46 +11:00
Shiv Tyagi
4b7b5a4d90 AP_OSD: fix code causing errors when OSD is compiled out
This fixes the code causing problem in compiling out OSD
2021-12-21 10:06:01 +11:00
Hwurzburg
ff3c4b8bda RC_Channel: add RC option to report CRSF LQ as RSSI
Co-author: Jules Gilson <julesgilson@yahoo.co.uk>
2021-12-21 10:04:33 +11:00
Hwurzburg
a18a4e5719 AP_RCTelemetry: add RC option to report CRSF LQ as RSSI
Co-author: Jules Gilson <julesgilson@yahoo.co.uk>
2021-12-21 10:04:33 +11:00
Hwurzburg
eaa557106a AP_RCProtocol: add RC option to report CRSF LQ as RSSI
Co-author: Jules Gilson <julesgilson@yahoo.co.uk>
2021-12-21 10:04:33 +11:00