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
Thomas Stastny
3b6c9448aa
npfg: fix format CMakeLists
3 years ago
Thomas Stastny
13c36155ce
fw_pos_ctrl: allow npfg to operate without wind estimate, dont switch controllers
3 years ago
Thomas Stastny
082e320191
integrate optional NPFG library for wind-aware fixed-wing guidance
3 years ago
Beat Küng
66cbbf9f2e
control_allocator: use 'bidirectional' to clarify reversible motors
3 years ago
Beat Küng
9ca58f5e97
actuator outputs: always add reverse range param
...
and remove the possibility to set min > max to reverse.
Initially the idea was to add the checkbox on the UI side, to avoid adding
another param, but I don't think I'll go through the extra effort on the
QGC side.
3 years ago
Daniel Agar
98a9748bb8
drivers/dshot: use uORB::PublicationMulti for ORB_ID(esc_status)
...
- there can be multiple different outupt modules publishing esc_status (eg dshot & uavcan)
3 years ago
Daniel Agar
81ecd130fc
uavcan: ESC publish esc_status in callback instead of timer
...
- this ensures every ESC status gets published with minimal latency
- also prevents publishing ORB_ID(esc_status) when there's no actual
data (bug)
3 years ago
David Sidrane
25099ce11f
fmurt1062-v1:Added GPS driver dropped in move to boardconfig
3 years ago
Julian Oes
651702c2c1
setup: don't install ccache
...
I don't think the PX4 setup script should decide whether a user is to
use ccache or not. Anecdotally, I've heard from some in the dev team
that they are not using it themselves, so I don't think there is a good
basis to push it onto others.
That being said, we can of course still use ccache as part of the CI
builds nevertheless.
3 years ago
Roman Bapst
dc6067ed12
Update src/modules/fw_att_control/fw_att_control_params.c
...
Co-authored-by: Silvan Fuhrer <silvan@auterion.com>
3 years ago
RomanBapst
34bb671a73
improve parameter descriptions for fw maximum/minimum roll/pitch angles
...
Signed-off-by: RomanBapst <bapstroman@gmail.com>
3 years ago
RomanBapst
555ee371e8
FixedWingPositionControl: consistently use the same roll and pitch angle
...
limits for autonomous and semi-autonomous modes (altitude & position control)
Signed-off-by: RomanBapst <bapstroman@gmail.com>
3 years ago
Thomas Stastny
f8c2ee73db
handle line segment termination in navigator
...
- if following line segment (fixed-wing position control) switch waypoint when in acceptance radius OR passed the second waypoint. this handles the case of being beyond the second waypoint but not within the acceptance radius without the need to fly back to the waypoint (e.g. after a loiter up to waypoint alt)
- sync navigator and fw pos ctrl waypoint acceptance altitude
3 years ago
Claudio Micheli
8a01135a93
Commander: more changes to use events with escs and battery failures
...
Signed-off-by: Claudio Micheli <claudio@auterion.com>
3 years ago
Claudio Micheli
d122513197
extend support for Battery status message
...
Signed-off-by: Claudio Micheli <claudio@auterion.com>
3 years ago
Daniel Agar
bb1177d504
sensor_calibration: refactor and centralize calibration slot logic
...
- centralize logic for selecting a preferred calibration slot
- automatically use existing calibration slot if it exists, otherwise
find first available slot, with a preference for a requested index
- existing commander calibration methods rewrite all calibration slots
to match current sensor ordering
3 years ago
alexklimaj
d1304e1ceb
Add CANNODE_GPS_RTCM
3 years ago
Silvan Fuhrer
3cd1e0ce19
MCLandDetector: clean up logic for ground effect
...
Before: in_ground_effect was always true with the default settings (LNDMC_ALT_GND =-1)
and when a distance sensor was present with valid data.
Now: default of LNDMC_ALT_GND is set to 2m by default, and if set to a negative value
then in_ground_effect is never set to true
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
3 years ago
Matthias Grob
443406ea2b
FlightTaskAuto: use longerThan() when possible in vector calculations
3 years ago
bresch
4fc7348582
mpc: leave room for altitude error control during descent and descent
...
Since the same parameter is used to generate the trajectory and to
saturate the controller, there is no additional space for the output of
the position controller once it is filled with the feedforward, letting
the altitude grow uncontrolled.
3 years ago
bresch
ea7d2334c9
mpc: add parameter for ascent/descent speed in auto modes
3 years ago
Daniel Agar
463513f31f
Jenkins: hardware disable auto cal before on board tests
3 years ago
Daniel Agar
2eec7842ae
sensors/vehicle_imu: fix SENS_IMU_AUTOCAL saving logic
...
- on cycles that don't check for updated calibraton (estimated bias) we
check if there's anything valid to save (when disarmed)
3 years ago
romain-chiap
4e06b40e2b
sih: add tailsitter support, disable UAVCAN
3 years ago
Julian Oes
6ed48ad0c0
ROMFS: Remove now unused variable
3 years ago
Julian Oes
b52972f3f8
ROMFS: remove duplicate startup tune
...
This must have come back in a rebase.
3 years ago
Julian Oes
1baecf07ad
Mantis: remove startup tune volume
...
Let's just leave it at the default like the rest of the beeps.
3 years ago
Julian Oes
38439256e5
Mantis: move MIXER vars to airframe init
...
The two were actually conflicting and are now consolidated.
3 years ago
Julian Oes
14fb019821
Mantis: move SYS_DM_BACKEND to board_defaults
...
Otherwise it is set too late and not used during startup.
3 years ago
Julian Oes
feb2987fa8
Mantis: remove unused transition script
...
When coming from the previous stack there are no params anywhere, so
this will not execute anyway.
3 years ago
Julian Oes
a061d7a02a
Mantis: use dataman in RAM
3 years ago
Julian Oes
b3d830dd11
Mantis: move power off tune to commander
...
This way we don't allocate inside the interrupt context.
3 years ago
Julian Oes
372a0da987
Mantis: move upload.sh into boards/atl/mantis-edu
3 years ago
Julian Oes
73044c51f9
vmount: only send CONFIGURE cmd if type changes
...
We don't always have to send MOUNT_CONFIGURE but really only when the
control data type actually changes.
3 years ago
Julian Oes
22180a2639
mavlink: make range params optional
...
If there is no range sensor compiled in, these two params do not seem to
be available. Hence, we need to make them optional.
3 years ago
Julian Oes
0ffdccbd60
Mantis: Add MPC2520 again
3 years ago
Julian Oes
b44f5b49ca
Mantis: add tap_esc to Kconfig
3 years ago