Matthias Grob
33df8b24f2
Commander: differentiate clearly between to arm and to disarm transition
3 years ago
Matthias Grob
400e1f8214
Commander: only initialize to tablet mode and don't switch back on RC loss
3 years ago
Daniel Agar
002579b3e0
Jenkins: reboot after ostest completes
...
- temporary workaround to ostest apparently leaving the system in a bad state
3 years ago
Daniel Agar
5b6e5a0968
boards: NuttX update all boards to preallocated sem holder list
...
- CONFIG_SEM_PREALLOCHOLDERS=32
- CONFIG_SEM_NNESTPRIO=16 (default)
3 years ago
Beat Küng
0074894637
control_allocator: disable backup schedule with lockstep
...
The backup schedule triggers updates too early and leads to simulator errors:
ERROR [simulator] poll timeout 0, 22
3 years ago
Daniel Agar
132a07f53c
boards: test boards add NuttX ostest and run on Jenkins test rack
3 years ago
Daniel Agar
0420d697e5
update NuttX and apps to latest with sem holder fixes and updated ostest
3 years ago
Daniel Agar
cb8b5ae872
mavlink: MavlinkStatustextHandlerTest ignore Wcast-align
3 years ago
Daniel Agar
d97bb168cf
lib/motion_planning: VelocitySmoothingTest delete set but not used variable
3 years ago
Daniel Agar
095e0f0604
ekf2: sensor_simulator fix enum shadow
3 years ago
PX4 BuildBot
63155b5b01
Update submodule mavlink to latest Sat May 28 00:38:55 UTC 2022
...
- mavlink in PX4/Firmware (56106be4805cb2f70d22ad31b87fbd9774f0d0f3): 99e82cad70
- mavlink current upstream: 0909631552
- Changes: 99e82cad70...0909631552
09096315 2022-05-26 Hamish Willee - Clarify and cross reference home position everywhere (#1836 )
38c1a99f 2022-05-25 Julian Oes - WIND_COV: clarify description and unknown value (#1845 )
3 years ago
David Lechner
995265c95e
vscode: remove terminal settings
...
These terminal settings are a matter of personal preference and should
not be part of the project configuration.
3 years ago
Daniel Agar
c27b9f3b1e
boards: reduce SPI DMA buffers on older STM32F4 boards
...
- on common IMUs like the mpu6000, mpu9250, icm20602, etc each FIFO
sample is only 12 bytes so this is still more than large enough for the
worst case transfer
3 years ago
Daniel Agar
4561cf2ce6
boards: pixhawk 2 cube skip starting low quality l3gd20 gyro to save memory and cpu
...
- free memory is getting tight on these older boards (depending on
configuratoin) and the pixhawk 2 cube still has 2 other superior IMUs, so this is just
dropping dead weight
3 years ago
David Sidrane
74a2930315
px4_fmu-v6X:Added Holybro mini base board
3 years ago
David Sidrane
dd6d7e9979
uc_stm32h7_can:Correct initalization of the mumber of interfaces
...
H7 Only supports 2 not 3 CAN interfaces.
CanInitHelper passes in in the run time configuration of
the number of interfaces. The code was ignoring these!
3 years ago
David Sidrane
9353c15e8a
px4_fmu-v5X:Added Holybro mini base board
3 years ago
David Sidrane
479b52fd02
Update all H7 Bootloders
3 years ago
David Sidrane
645f4c3428
flash_cache:Flush complete cache line
3 years ago
David Sidrane
fd81951391
boards: STM32H7 pad to 256 bit - 32 bytes ( #19724 )
3 years ago
Daniel Agar
1ba3610cfc
boards: delete omnibus_f4sd_ekf2 due to flash overflow
3 years ago
David Sidrane
55cfd8597d
px4_fmu-v6c:Fix mag rotation
3 years ago
Igor Misic
554283655c
Revert "px4io: replace safety_off state with safety button event ( #19558 )"
...
This reverts commit 12a81979a8
.
3 years ago
Igor Misic
6aefcbb6cf
Revert "px4iofirmware: fix for bug introduced with #19558"
...
This reverts commit 79a34b5aed
.
3 years ago
Matthias Grob
c03f5b9481
Commander: fix overlooked rebase naming error
3 years ago
alessandro
29c4119e24
Match commander uORB var names to message names ( #19707 )
...
* match vehicle_status
* match home_position
* match vehicle_command_ack
* match actuator_armed
* match vehicle_control_mode
* match commander_state
3 years ago
Daniel Agar
98354ba10a
Update submodule GPSDrivers to latest Wed May 25 12:38:58 UTC 2022
...
- devices in PX4/Firmware (7cc84e0f9e44697475b0f355df9a29de6ea6b9ff): 58968922b7
- devices current upstream: 181fae1a4b
- Changes: 58968922b7...181fae1a4b
181fae1 2022-05-23 numan - README: add information for definition.h
3 years ago
Daniel Agar
58ea6235fe
ekf2: estimator aid source status (range height)
3 years ago
Daniel Agar
1e25aee6fa
ekf2: estimator aid source status (baro height)
3 years ago
Silvan Fuhrer
4dbe6f0a1c
simulator_mavlink: fix MAV_TYPE_VTOL_TAILSITTER case
...
This type (23) doesn't specify a motor number, so it can't be properly handled.
There are duo (19) and quad (20) tailsitter types that still work in simulation.
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
3 years ago
Daniel Agar
376201e64d
boards: px4_fmu-v5/v5x init all I2C pins
3 years ago
bresch
d04a91a3ae
ekf2_post-processing: use estimator_status_flags instead of bitmasks
3 years ago
Beat Küng
016b8aeb35
MulticopterRateControl: fix thrust sign for acro
...
Regression from fbc109436f
3 years ago
Matthias Grob
44be415e0e
mission_block: make "Delay until" item work while landed
...
To enable landing, waiting and taking off again e.g. for delivery.
3 years ago
Matthias Grob
0be474430c
Commander: don't disarm on landing amid a mission
3 years ago
Matthias Grob
4f34207c4e
battery_params: increase default empty cellvoltage to 3.6v
...
Based on feedback that very often the battery is used down too low.
I observed this happens consistently when the cell voltage is properly
load compensated. The default load compensation before #19429 was very
inaccurate and resulted in unpredictable estimate.
After that if there is a usable current measurement and the battery is
within expected tolerances of the default internal resistance the
compensation is pretty good and 3.5V is too low for an empty compensated
cell voltage. That was seen in various logs where the compensated
cell voltage was already dropping fast after 3.6V.
In case the voltage is not load compensated the vehicle estimates the
state of charge a bit too low which is safer than to high
especially for a default configuration.
3 years ago
Mark Sauder
a1fb9fb7c6
rcS: Keep Mag Cal with AUTOCONFIG param reset in rcS, deprecate rcS AUTOCNF param ( #19693 )
...
* Deprecate the rcS AUTOCNF script param and associated logic.
* Update posix rcS to match previous commit.
3 years ago
Daniel Agar
639222dd65
ekf2: estimator aid source status (GPS pos, GPS vel)
3 years ago
Daniel Agar
1ae467e9cd
ekf2: estimator aid source status (starting with fake position)
3 years ago
Igor Misic
79a34b5aed
px4iofirmware: fix for bug introduced with #19558
3 years ago
Daniel Agar
d25a784a3a
icm42688p: only check configured registers periodically (as intended)
3 years ago
bresch
c57c575cfe
ekf2: use explicit flags instead of bitmask position
...
This prevents bitmask mismatch when a new flag is inserted
3 years ago
Matthias Grob
62edcc7a57
battery: only compensate using sane current
3 years ago
Matthias Grob
2cbdcc9671
battery: default to reasonable internal resistance
...
instead of disabling the load compensation using current.
3 years ago
Matthias Grob
58b1139a21
battery: allow setting precise internal resistance with parameter
3 years ago
Matthias Grob
2c5a7ea118
battery: rather undercompensate for load
...
than over compensate which makes the estimate to high and breaks batteries
beause they get flown for too long.
3 years ago
Serhat Aksun
bc220ddb82
sensors/vehicle_magnetometer: fix multi_mode check
...
Signed-off-by: Serhat Aksun <serhat.aksun@maxwell-innovations.com>
3 years ago
Igor Misic
12a81979a8
px4io: replace safety_off state with safety button event ( #19558 )
...
internal PX4IO safety_off state is removed and replaced with a normal safety button event. From this 'commit' commander is taking care of the PX4IO safety.
3 years ago
Igor Misic
08dcc72e1f
commander/safety: replace safety.msg with Safety class ( #19558 )
3 years ago
Daniel Agar
b800600a6c
boards: px4_fmu-v2_fixeding disable fw_autotune_attitude_control to save flash
3 years ago