Matthias Grob
fc90e235f1
Rename differential drive setpoint topics
2024-02-12 14:29:10 +01:00
Matthias Grob
f7baeae1a0
DifferentialDriveControl: only save required parts of uORB message
2024-02-12 14:29:10 +01:00
PerFrivik
e457a5baed
Differential Drive Guidance: Add guidance
...
also add dependency on control allocation parameter CA_R_REV
Differential Drive Guidance: Added mission logic
Differential Drive Guidance
Differential Drive Guidance
Differential Guidance: Inlcude library
Differential Guidance: Compiles, does not work though
Differential Guidance: Works somewhat
Differential Guidance: Temp
Differential Guidance: Tuning
Differeital Drive Guidance: Remove waypoint mover
Differential Guidance: Fixed accuracy issue by converting from float to double
Differential Guidance: rebased on differentialdrive and improved waypoint accuracy
Temp
Differential Guidance: cleanup
temp
2024-02-12 14:29:10 +01:00
muramura
f636414ca7
tuning_tools: Change 1G to a more accurate value
2024-02-09 10:26:57 -05:00
muramura
00a9e4c76b
Auto: Change 1G to a more accurate value
2024-02-09 10:26:57 -05:00
Alex Klimaj
31bbda0b58
boards: new ARK Septentrio GPS CAN node(ark_septentrio-gps)
...
* update gps submodule with sbf fix
* ARK Septentrio GPS initial commit
2024-02-09 10:26:09 -05:00
Matthias Grob
b355c16141
Lanbao driver: correct rangefinder type to IR
2024-02-09 06:19:12 +01:00
Matthias Grob
7fdb5ef3cb
PWMOut/px4io: correct automatic servo/motor configuration messages
2024-02-09 06:19:12 +01:00
Matthias Grob
97cb933cff
FLightTaskAuto: limit nudging speed based on distance sensor
2024-02-07 11:23:55 +01:00
Silvan Fuhrer
584d8abe1e
params: change return type of param_modify_on_import to enum
...
Return early in param_import_callback() with 1 if we do a param_set in the param translation.
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
2024-02-07 08:08:37 +01:00
Silvan Fuhrer
982c998ab9
mc_attitude_control: move attitude setpoint pulling to right before usage
...
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
2024-02-06 17:54:22 -05:00
Silvan Fuhrer
e5cfbbb1ee
mc_att_control: remove direct setting of att sp in Stabilized
...
Instead of directly setting the attitude setpoint for usage inside the same module
only publish it to the uorb topic, which is subscribed to in the same module.
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
2024-02-06 17:54:22 -05:00
KonradRudin
3576d513cd
battery: make time remaining estimation dependent on level flight cha… ( #22401 )
...
* battery: make time remaining estimation dependent on level flight characteristis for FW
* battery: fix that FW flight is also correctly detected when vehicle_status is not updated
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
* FixedwingPositionControl: Move constant to header file
* flight phase estimation: use tecs height rate reference to check for level flight
---------
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
Co-authored-by: Silvan Fuhrer <silvan@auterion.com>
2024-02-06 17:32:09 +01:00
Andrew Brahim
bf52d8adc9
drivers/uavcannode: add indicated airspeed
...
Signed-off-by: dirksavage88 <dirksavage88@gmail.com>
2024-02-06 11:01:15 -05:00
Alessandro Simovic
a6fcb8ef1e
bat_sim: parameter for disabling battery simulator
2024-02-06 10:21:21 -05:00
PerFrivik
1917c138f7
Bugfix removed conversion from rpm to rad s
2024-02-06 13:25:25 +01:00
bresch
17d55dddd6
ekf2-drag: do not generate Kalman gain to save flash
2024-02-06 12:16:33 +01:00
bresch
1efb08375a
ekf2: let drag fusion affect the complete state vector
...
This improves tilt estimation and can extend the inertial dead-reckoning
validity period
2024-02-06 12:16:33 +01:00
Beat Küng
c78389a855
commander: send ack for VEHICLE_CMD_DO_SET_ACTUATOR
2024-02-02 09:38:28 -05:00
Beat Küng
8b422c5ed6
fix FunctionActuatorSet: if a param is set to NaN, it should be ignored
...
MAVLink spec: https://mavlink.io/en/messages/common.html#MAV_CMD_DO_SET_ACTUATOR
Previously, a command was overwriting all other indexes.
2024-02-02 09:38:28 -05:00
cuav-liu1
75d6e523b5
ICP201: Fix B2 version not return in bootup config
2024-02-02 09:37:18 -05:00
Niklas Hauser
103ddb5b3d
cpuload: Fix wrong idle thread load
...
When the CPU load monitor is started while already running, then the
idle thread last_times[0] is reset to the last 1 second, rather than
since when the CPU load monitor was last started. The remaining threads
are not impacted, since their last_times[i] is reset to zero here.
This results in the idle thread having a lower than real CPU load, with
the remaining CPU time being wrongly attributed as scheduler load.
2024-01-31 07:52:59 +01:00
Matthias Grob
3e183feb49
matrix: Slice templated on const and non-const matrix cases
...
to avoid casting const to non-const with
`const_cast<Matrix<Type, M, N>*>(data)`
2024-01-30 11:46:33 -05:00
Matthias Grob
88102d82db
matrix: return value simplifications
2024-01-30 11:46:33 -05:00
Matthias Grob
44a8c553fb
AxisAngle use Vector3<T> instead of Vector<T, 3>
2024-01-30 11:46:33 -05:00
Matthias Grob
ea4fdfd637
matrix: fix internal include chain
2024-01-30 11:46:33 -05:00
muramura
c5757e0799
gimbal: Change the IF statement to a SWITCH statement
2024-01-30 11:28:20 -05:00
Roman Bapst
380841563f
ina238: set shunt calibration to desired value if readback is incorrect ( #22237 )
...
* refactor driver to dynamically check registers and do reset if register does not match desired value
* have seen various times where shunt calibration was reset in air
---------
Signed-off-by: RomanBapst <bapstroman@gmail.com>
2024-01-30 11:28:05 -05:00
Konrad
169d2dd286
mission_base: fix validity on abort landing
2024-01-30 11:25:37 -05:00
Konrad
0a153efb9d
mission_base: make sure to always update state on mission topic update
2024-01-30 11:25:37 -05:00
Konrad
97ce599b1f
mavlink_mission: publish mission topic at startup
2024-01-30 11:25:37 -05:00
Konrad
9fd137e88e
mavlink_mission: add alternating storage for geofence and safe points on upload
...
This way the old points are kept on an upload error.
2024-01-30 11:25:37 -05:00
Konrad
50f1abaef1
dataman: extend for double storage geofence and safe points
2024-01-30 11:25:37 -05:00
Konrad
dfa56d474a
mission: renaming dataman_id to mission_dataman_id
2024-01-30 11:25:37 -05:00
Konrad
cac858cb24
dataman: use correct size for dataman compat key
2024-01-30 11:25:37 -05:00
bresch
9c02e384e6
ekf2-agp: follow measurement reset
2024-01-30 11:23:55 -05:00
bresch
5d9081b0dd
ekf2-agp: ensure logging of AGP aid_src topic
2024-01-30 11:23:55 -05:00
bresch
4268759d4a
ekf2-agp: reset to measurement on fusion timeout
2024-01-30 11:23:55 -05:00
muramura
23ae769e46
check: Changing the order of messages and events
2024-01-30 11:20:19 -05:00
muramura
3c444c2f2a
dataman: Move before using variable definitions
2024-01-30 11:19:29 -05:00
David Sidrane
c4e8faeacb
PX4:ver Add base type compare
2024-01-30 11:15:03 -05:00
David Sidrane
136e08652f
PX4:comon Support BOARD_HAS_HW_SPLIT_VERSIONING
2024-01-30 11:15:03 -05:00
cuav-liu1
df8a8af34c
ICP201: increase startup delay with B2 version
2024-01-30 10:06:28 -05:00
Silvan Fuhrer
24debb5ff2
logged_topics: log all instances of torque/thrust setpoints in high rate
...
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
2024-01-29 20:44:55 -05:00
Silvan Fuhrer
09b7cffca5
logged_topics: add actuator_servos to high rate logging
...
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
2024-01-29 20:44:55 -05:00
Igor Mišić
23cebd6cf2
temperature_compensation: use set_sensor_id_mag for Mag
2024-01-29 20:44:12 -05:00
bresch
80f20e619c
ekf2: zvup sequential fusion
2024-01-29 12:12:37 -05:00
murata,katsutoshi
e8b3778f81
uuv_att_control: Variable definition in processing ( #22697 )
2024-01-29 17:04:10 +01:00
Roman Bapst
077baeae52
Avoid waypoint following during backtransition which can lead to strong banking ( #22642 )
...
* avoid waypoint following during backtransition
- if vehicle overshoots transition, make controller track the prev/current
waypoint line, this avoids large banking maneuvers that delay the transition further
Signed-off-by: RomanBapst <bapstroman@gmail.com>
* navigator: use SETPOINT_TYPE_LAND as setpoint type for VTOL_LAND waypoints
such that fixed wing position controller can distinguish from other types
Signed-off-by: RomanBapst <bapstroman@gmail.com>
* FixedWingPositionControl: split vtol backtransition logic into separate method
Signed-off-by: RomanBapst <bapstroman@gmail.com>
* review changes
Signed-off-by: RomanBapst <bapstroman@gmail.com>
* prevent loiter when approaching vtol backtransition and invalidate previous waypoint during mission landing
Signed-off-by: RomanBapst <bapstroman@gmail.com>
* removed unused parameter
Signed-off-by: RomanBapst <bapstroman@gmail.com>
* small renaming of transition mode
Signed-off-by: RomanBapst <bapstroman@gmail.com>
---------
Signed-off-by: RomanBapst <bapstroman@gmail.com>
2024-01-29 09:45:40 +01:00
somebody-once-told-me
f40ede6087
Control Allocation Sequential Desaturation unit tests ( #22612 )
...
* [control_allocation] add unit tests for ControlAllocationSequentialDesaturation
* complete first 2 unit tests
* add yaw test
* add more unit tests
* improve comments
* format
* address review comments
* submodule update
* Update src/modules/control_allocator/ControlAllocation/ControlAllocationSequentialDesaturationTest.cpp
Co-authored-by: Silvan Fuhrer <silvan@auterion.com>
* Update src/modules/control_allocator/ControlAllocation/ControlAllocationSequentialDesaturationTest.cpp
Co-authored-by: Silvan Fuhrer <silvan@auterion.com>
* Update src/modules/control_allocator/ControlAllocation/ControlAllocationSequentialDesaturationTest.cpp
Co-authored-by: Silvan Fuhrer <silvan@auterion.com>
* remove float suffix for logical integers, add missing float suffixes for logical float zeros, and make YAW_MOTORS an int
---------
Co-authored-by: Master Chief <master-chief@the-void.com>
Co-authored-by: Silvan Fuhrer <silvan@auterion.com>
2024-01-26 15:17:54 +01:00