Daniel Agar
b88c8eb245
Jenkins: hardware stop commander before sensors module to avoid errors
...
- this is only done to silence timeouts during small benchmarks
3 years ago
Daniel Agar
d35cf78e4a
commander: PX4_ERR if attitude or angular velocity become invalid
3 years ago
Daniel Agar
4559230de6
drivers/imu/invensense: adjust icm20602/icm20649/icm20948 rescheduling logic
...
- this handles the case where the driver might be more than one full
transfer cycle behind
3 years ago
Daniel Agar
ef4d4c3093
sensors/vehicle_imu: fix timestamp_sample increasing check
3 years ago
Jaeyoung-Lim
4535b18a80
Set setpoint type as const
3 years ago
Jaeyoung-Lim
07d72f8604
Fix comments
3 years ago
Jaeyoung-Lim
443666199e
Move setmode outside of control_position
...
This commit moves the position controller mode handling outside of the control_position method.
The control_method is renamed to control_auto
3 years ago
Jaeyoung-Lim
ae9e91f90c
FW Pos controller: fix format in new switch
...
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
3 years ago
Silvan Fuhrer
c3e961a1ed
FW Pos C: move setting of control_mode_current to separate function and minor clean ups
...
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
3 years ago
Silvan Fuhrer
0cf3ef87e3
FW Position Controller: move nav_speed_2d calculation to function
...
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
3 years ago
Jaeyoung-Lim
581ec224be
Encapsulate loiter and position setpoint handling
...
This commit encapsulates the position setpoint and loiter setpoint handling into a single method, in order to make the code easier to understand
4be452
3 years ago
Thomas Debrunner
f08f2a340d
motion_planning: In VelovitySmoothing, mark const functions const
3 years ago
Thomas Debrunner
fed234de81
flight_mode_manager: Extracted position trajectory motion planning into a library
...
Extract the functionality to plan smooth position motion trajectories into a
motion planning library, such that it can be used in other parts of the code as well.
3 years ago
Peter van der Perk
07303af8f8
UAVCANv1 Fix typo in #define
3 years ago
Peter van der Perk
ed394027b1
UAVCANv1 Include Kconfig & Fix #18396
3 years ago
mcsauder
a732ddaefb
Deprecate 4250_teal from CMakeLists.txt.
3 years ago
mcsauder
c1b0d78077
Minimize flash by migrating MIXER quad_x and PWM_OUT 1234 to rc.mc_defaults. Deprecate 4250_teal config file.
3 years ago
Matthias Grob
8b37db7825
Functions: fix corner case x_low == x_high == value resulting in NAN
...
and added unit test to cover it
3 years ago
alexklimaj
f5e1da5b0f
Fix broadcom afbrs50 build
3 years ago
Daniel Agar
7de00469a6
platforms: nuttx px4_init fix USB serial mavlink autodetect
3 years ago
Julian Oes
f91aa76645
boards: add v5x RTPS version again
...
I just copied this from v5 and removed the heater.
3 years ago
David Lechner
426efb515f
setup: fix installing in virtual env on Ubuntu
...
This fixes running the Ubuntu setup script in a Python virtual
environment. This was failing because pip doesn't allow the --user
option in virtual environments.
3 years ago
Jukka Laitinen
351f679c2f
parameters: Use px4::atomic_bool instead of px4::atomic<bool>
...
This enables us to define the actual atomic bool type in px4_platform
Signed-off-by: Jukka Laitinen <jukkax@ssrc.tii.ae>
3 years ago
Jukka Laitinen
e6658547cf
sensors/vehicle_imu: Fix compiler warning for implicit INFINITY double->float cast
...
This pops up on some newer compilers
Signed-off-by: Jukka Laitinen <jukkax@ssrc.tii.ae>
3 years ago
Jukka Laitinen
5509235517
commander: Fix implicit NaN conversion from double to float compiler warning
...
Signed-off-by: Jukka Laitinen <jukkax@ssrc.tii.ae>
3 years ago
Daniel Agar
41a4045630
boards: nxp_fmuk66 fix serial_dma_poll
3 years ago
Daniel Agar
49a4283d0d
boards: px4_fmu-v5x restore rc.board_mavlink
...
- this was unintentionally removed in https://github.com/PX4/PX4-Autopilot/pull/16180
3 years ago
alexklimaj
ffb47466df
Add ARK GPS passthrough
3 years ago
Mathieu Bresciani
56b0c46444
ekf2: improve optical flow angular rate compensation
3 years ago
Daniel Agar
fab053d33b
mavlink: receiver battery_status prevent out of bounds access
...
- fixes https://github.com/PX4/PX4-Autopilot/issues/18385
3 years ago
Daniel Agar
12670b70f4
Jenkins: hardware quick cal skip sleeps
3 years ago
Silvan Fuhrer
801ef2d520
VTOL main: add local variable for int(vehicle_command.param1 + 0.5)
...
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
3 years ago
Silvan Fuhrer
342e9900f8
vtol main: only guard against transition to FW in certain flight modes, never to MC
...
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
3 years ago
SalimTerryLi
5ebe41efbf
pilotpi: fix upload cmake
3 years ago
RomanBapst
8f8304f31e
FixedWingPositionController: Set l1 variables to NAN if no l1 guidance
...
took place
Signed-off-by: RomanBapst <bapstroman@gmail.com>
3 years ago
RomanBapst
ae5d3103f4
fw l1 controller: added a flag to indicate if navigation has updated
...
- can be used to check if l1 controller ran during a cycle
Signed-off-by: RomanBapst <bapstroman@gmail.com>
3 years ago
Jaeyoung-Lim
e2f048f608
Add sitl glider model
...
Add airframe configs for SITL glider model
This commit adds an airframe config for a glider model
3 years ago
Shubham Shah
99b098f608
Update FixedwingAttitudeControl.cpp
3 years ago
Shubham Shah
c92cd65831
Update EKF2.cpp
3 years ago
Shubham Shah
6576e1fda9
Update battery_status.cpp
3 years ago
Shubham Shah
b56bd7cb21
Update AirspeedValidator.cpp
3 years ago
Shubham Shah
47a72a6b7b
Update vtol_att_control_main.cpp
3 years ago
Shubham Shah
9fd19a2c83
Update standard.cpp
3 years ago
Shubham Shah
af34b21ba8
Update tiltrotor.cpp
3 years ago
Jacob Dahl
98f655815a
mavlink: add LAND_TARGET stream
3 years ago
Daniel Agar
4be45229bf
fw_pos_control_l1: fix launch detector dt update
...
- fixes https://github.com/PX4/PX4-Autopilot/issues/18354
3 years ago
Daniel Agar
089f96f800
lib/drivers/{accelerometer,gyroscope} skip obselete Vector3f construction
...
- FIFO clip count only check if value is INT16_MIN/MAX rather than abs() call
3 years ago
Jacob Dahl
fd39d5b9a1
drivers/distance_sensor/lightware_laser_serial: add LW20/C support
3 years ago
Igor Mišić
47dc2ae5a5
Revert "protocol_splitter: delete non rtps or mavlink data from buffer"
...
This reverts commit 0cae3c129d
.
3 years ago
alexklimaj
2ba369dd54
Add uavcannode fix2 mode and submode
3 years ago