Daniel Agar
8217e0f335
drivers/magnetometer/bosch/bmm150: add self test fail perf counter to status
3 years ago
Daniel Agar
5ded1aedcb
sensors/vehicle_angular_velocity: add IMU_GYRO_DNF_HMC to configure number of ESC RPM notch filter harmonics
3 years ago
SungTae Moon
4c6e746360
uorb graph: fix the link problem for multi topics ( #19062 )
3 years ago
Jaeyoung-Lim
ee98a3336d
Spawn at different height for multivehicle simulation
...
This commit fixes the spawn location of the multivehicle gazebo sitl script
3 years ago
Daniel Agar
07e6c274d5
uavcan/uavcannode: bridge LogMessage and PX4 ORB_ID(log_message_s)
3 years ago
PX4 BuildBot
ed28b216c7
Update submodule sitl_gazebo to latest Sat Jan 22 12:38:57 UTC 2022
...
- sitl_gazebo in PX4/Firmware (6203ad25c7
): 27298574ce
- sitl_gazebo current upstream: 831aa36fea
- Changes: 27298574ce...831aa36fea
831aa36 2021-10-09 Shaochang Tan - fix imu noise model.
3 years ago
PX4 BuildBot
6203ad25c7
Update submodule mavlink to latest Sat Jan 22 00:39:17 UTC 2022
...
- mavlink in PX4/Firmware (a16a8dceb1b2d234ae963c74621c147f521abce9): 3d8092006e
- mavlink current upstream: 51abf3c82b
- Changes: 3d8092006e...51abf3c82b
51abf3c8 2022-01-21 Julian Oes - Component information: add note (#1785 )
f5694b29 2022-01-19 Julian Oes - component_info: re-use protocol capabilities (#1786 )
3 years ago
Beat Küng
92769bd2b2
dshot: remove BOARD_DSHOT_MOTOR_ASSIGNMENT & handle timer channel gaps
3 years ago
Daniel Agar
4de9c598fa
bmm150: retry probe up to 3 times
3 years ago
David Sidrane
a11fe60135
imxrt:ADC extend timeout
3 years ago
Daniel Agar
7cb8ed3a1f
sensors/vehicle_gps_position: don't work with 64 time with 32 bit floats
3 years ago
JaeyoungLim
0607982b23
Publish orbit status also when the waypoint is a loiter waypoint ( #19048 )
...
* Publish orbit status also when the waypoint is a loiter waypoint
* Remove redundant orbit status publishing
3 years ago
Beat Küng
bcd057ac3e
uORB: fix copy-paste mistake in orb_print_message_internal
...
Could have led to invalid memory access.
3 years ago
bresch
a2260e53da
ekf2: replace yaw failure detection criteria
...
The existing logic using the angle between velocity vectors failed to
determine a yaw failure in practice because the state velocity is often
too small compared to its uncertainty to be used. In all the failures
reported, the yaw emergency estimator converged properly and yaw reset
would have fixed the issue.
A much simpler check using the yaw difference between the main EKF
and the emergency estimator is now used to tell if the vel/pos update
failure is most likely caused by a wrong heading.
3 years ago
Daniel Agar
446729566d
platforms/nuttx: px4io_serial always cleanup DMA before next bus exchange
...
- this really shouldn't be necessary, but worst case it's harmless and
much better than potentially falling out of the sky
3 years ago
Jaeyoung Lim
0dea56f88b
Use current_sp for publishing orbit status
3 years ago
Jaeyoung-Lim
dec5e7e9c8
Publish orbit status whenever the vehicle is in loiter
...
This commit moves the publish orbit status to be published whenever the vehicle is considering a loiter setpoint
3 years ago
Thomas Stastny
19c98b8841
npfg: fix typo in Vector2f indexing
3 years ago
bresch
e89e3c1b0c
ekf2: extract logic to test yaw emergency estimate quality
3 years ago
bresch
ea80c5027e
ekf2: split yaw estimator state getter into several functions
3 years ago
dagar
476c1e5c09
[AUTO COMMIT] update change indication
3 years ago
bresch
ffebd8e771
ekf2: initialize cos tilt variable assuming no tilt
3 years ago
Daniel Agar
92a5bbe97f
ekf2: improve ring buffer sizing and dynamically allocate
3 years ago
Daniel Agar
36605bfff6
sensors: lower SENS_MAG_RATE default
...
- reduce estimator 3D mag fusion cpu load (-3% on Pixhawk4)
3 years ago
Matthias Grob
c9f7c20d46
MulticoperPositionController: time failsafe messages together
...
The following output instead of printing the
action "stop and wait" just once:
WARN [mc_pos_control] invalid setpoints
WARN [mc_pos_control] invalid setpoints
WARN [mc_pos_control] Failsafe: stop and wait
WARN [mc_pos_control] invalid setpoints
WARN [mc_pos_control] Failsafe: stop and wait
WARN [mc_pos_control] invalid setpoints
WARN [mc_pos_control] Failsafe: stop and wait
3 years ago
Matthias Grob
d4e356a1ac
PosititionControl: fix integrator windup with invalid setpoint
3 years ago
Matthias Grob
8811482f1d
PositionControlTest: add integrator windup with invalid setpoint combination unit test
...
This bug was by chance found during simulation testing and debugging.
The unit test is to easily reproduce and cover this case.
3 years ago
Silvan Fuhrer
632dfa55e6
FW Pos C: add option to disable airspeed setpoint via stick input
...
-rename FW_POSCTL_INV_ST to FW_POS_STK_CONF and make bitmask out of it:
- bit 0: alternative mapping (height rate on throttle stick, airspeed on pitch)
- bit 1: enable/disable airspeed setpoints via stick
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
3 years ago
Silvan Fuhrer
cbb8c90245
ControlAllocation: fix calculation of roll/pitch normalization scale
...
Take into account the actual number of roll and pitch acutators,
instead of assuming that all actuators have a roll/pitch component.
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
3 years ago
Silvan Fuhrer
0950bb81ab
ControlAllocation: update normalization scale only if matrix updated is forced
...
The forced flag is used to distinguish between updates due to a configuration
(parameter) change (only enabled when disarmed), and matrix updates due to motor
tilt change. Only update the normalization scale if the forced flag is true, and
use a tilt angle of vertical position for it to have the scales tilt-invariant.
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
3 years ago
CUAVmengxiao
258a563dd5
barometer: Add ICP10100 and ICP1011
3 years ago
FARHANG
fe44e281e5
ROMFS: Holybro X500 v2 airframe addition
3 years ago
Daniel Agar
dd6b7fa98f
sensors: switch status PX4_INFO -> PX4_INFO_RAW
3 years ago
Daniel Agar
b1d2a0cc4e
sensors: simplify timestamp data validator handling
3 years ago
Daniel Agar
8067207ea6
px4_work_queue: rename serial port WQs
3 years ago
bresch
953c90d3a6
failure detector: change imbalanced propeller metric
...
Use standard deviations instead of variances to get a linear metric
3 years ago
bresch
408cf011b2
failure detector: fix dt computation
3 years ago
Daniel Agar
7eee949a81
Jenkins: hardware tolerate irrelevant uorb status failure
3 years ago
Daniel Agar
548b7d5ece
sensors/vehicle_imu: on calibration change don't resume in flight calibration learning immediately
3 years ago
Daniel Agar
ece09064c4
parameters: perform verification pass twice
...
- on NuttX with MTD storage this is to ensure we are verifying what's
actually stored on ramtron or eeprom, not just what's cached by bchlib
3 years ago
alexklimaj
cdb6a437a0
Fix UAVCAN beep not started
3 years ago
PX4 BuildBot
0bb9cce1ce
Update submodule mavlink to latest Tue Jan 18 00:39:07 UTC 2022
...
- mavlink in PX4/Firmware (37e04f56da3916dcb518eeba66b0888db1cd8c32): 75204adad2
- mavlink current upstream: 3d8092006e
- Changes: 75204adad2...3d8092006e
3d809200 2022-01-14 Hamish Willee - MAV_PROTOCOL_CAPABILITY_FLIGHT_INFORMATION - mark as reserved capability (#1775 )
68ff649f 2022-01-13 Hamish Willee - MAV_PROTOCOL_CAPABILITY_MISSION_FLOAT - deprecate (#1768 )
ae531d97 2022-01-13 Peter Barker - Move "external" dialects to be normal dialects (#1761 )
00a3f8ed 2022-01-12 Julian Oes - Revert "Delete unused cmake tree (#1760 )" (#1782 )
aa0764bd 2022-01-12 Hamish Willee - MAV_PROTOCOL_CAPABILITY_PARAM_UNION - rename/reserved (#1771 )
c3b46620 2022-01-12 Hamish Willee - Update mavlink_udp.c example readme to use mavlink 2 (#1780 )
0449a5ec 2022-01-12 Tatsuya Yamaguchi - add extended sensor status bits to MAVLink UDP example (#1778 )
fc3539e1 2022-01-10 Josh Henderson - ardupilotmega: Sync to ArduPilot downstream 10-JAN-2022 (#1777 )
27395aa7 2022-01-06 Julian Oes - pymavlink: update submodule to latest master (#1776 )
2180611b 2022-01-06 Hamish Willee - MAV_WINCH_STATUS_CLUTCH_ENGAGED: Winch clutch is engaged allowing motor to move freely
7c6f104f 2022-01-05 Jacob Dahl - Extend WINCH_STATUS_FLAG and WINCH_ACTION (#1766 )
dcb44e75 2022-01-06 Hamish Willee - Delete unused cmake tree (#1760 )
5b8bec5b 2022-01-05 Hamish Willee - common.xml: AUTOTUNE_AXIS_YAW - fix value to correct one for bitmask (#1767 )
3 years ago
Julian Oes
be9385ef06
cmake: use at least 1 core to build SITL
...
If we use -j 0, ninja fails with invalid argument.
3 years ago
Daniel Agar
2fb82789fe
lib/wind_estimator: pass q_att as const reference
3 years ago
Beat Küng
4cbee44220
rc.mc_defaults: only set IMU_GYRO_RATEMAX if default
...
Allows boards to set a higher rate.
3 years ago
Beat Küng
425b268feb
boards: add holybro/kakuteh7
...
known issues:
- flash-based params does not work on H7 (due to ECC), so params are on
SD card. The last flash sector is still reserved however.
- output channel 6 does not support DShot (the implementation does not
handle channel gaps)
- flashing of the 2. flash bank is much slower (around 3x), than the 1.
bank for some unknown reason.
- after the BL jumps to the app, there's several seconds passing until
stm32_boardinitialize() is called.
3 years ago
Beat Küng
cd2bb14f9b
stm32h7/micro_hal.h: add RCC_APB1ENR_TIM4EN
3 years ago
Berker Canatar
9249d3ae3d
Update current year in LICENSE
3 years ago
Silvan Fuhrer
0ce44cebb7
WindEstimator: use vehicle heading instead of ground course for initialisation
...
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
3 years ago
Silvan Fuhrer
1a4b2b37bb
AirspeedValidator: remove unused variable _tas_gate
...
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
3 years ago