bresch
986c1a37d1
Parameter update - Rename variables in modules/ekf2
...
using parameter_update.py followed by a make format
6 years ago
bresch
da2deaa0b2
Parameter update - Rename variables in modules/mavlink
...
using parameter_update.py script
6 years ago
bresch
f3990c84fc
Parameter update - Rename variables in modules/navigator
...
using parameter_update.py script
6 years ago
bresch
e575f032e4
Parameter update - Rename variables in modules/mc_att_control
...
using parameter_update.py script
6 years ago
bresch
2197ac883d
Parameter update - Rename variables in modules/wind_estimator
...
using parameter_update.py script
6 years ago
bresch
6c823903bc
Parameter update - Rename variables in modules/simulator
...
using parameter_update.py script
6 years ago
bresch
f08c00f324
Parameter update - Rename variables in modules/fw_pos_control
...
using parameter_update.py script
6 years ago
bresch
ecacf4de46
Parameter update - Rename variables in modules/load_mon
...
using parameter_update.py script
6 years ago
bresch
10ba0801d2
Parameter update - Rename variables in modules/fw_pos_control
...
using parameter_update.py script
6 years ago
bresch
ece49247b6
Parameter update - Rename variables in modules/mc_pos_control
...
using parameter_update.py script
6 years ago
bresch
c6e7c0fa5d
Parameter update - Rename variables in modules/events
...
using parameter_update.py script
6 years ago
bresch
2ca8ddd8af
Parameter update - Rename variables in modules/commander
...
using parameter_update.py script
6 years ago
bresch
2255ab21be
Parameter update - Rename variables in templates
...
using parameter_update.py script
6 years ago
bresch
b14446f0e5
Parameter update - Rename variables in lib
...
using paramter_update.py script
6 years ago
bresch
ec5da55107
Parameter update - Rename variables in drivers
...
using parameter_update.py script
6 years ago
bresch
aa8edbc2ba
Parameter update - add -tcpp flag in rg to check C++ files only
6 years ago
bresch
06ab8570ab
Parameter update - Add parameter_update.py script used to rename the BlockParam variables with the new strict naming convention
6 years ago
Nuno Marques
5da5795433
commander: PreflightCheck replace all differential_pressure sensor checks with airspeed checks ( #11722 )
6 years ago
Roman
d36c0e131d
added aux6 RC channel
...
Signed-off-by: Roman <bapstroman@gmail.com>
6 years ago
Julian Oes
a21242b0e3
FlightTasks: fix mission DO_CHANGE_SPEED
...
This fixes the issue where the DO_CHANGE_SPEED command was ignored and
the drone always travelled at the MPC_XY_CRUISE velocity.
6 years ago
bresch
99fb88ce83
AltitudeSmoothVel - Create new altitude flight task that uses the
...
velocity smoothing library to create a jerk-limited trajectory along the
Z axis. This FlightTask is used when MPC_POS_MODE = 3.
6 years ago
Roman
6c1399b328
multicopter land detector: make threshold for _has_low_thrust
...
configurable
Signed-off-by: Roman <bapstroman@gmail.com>
6 years ago
Daniel Agar
ec3bc4ee5b
fw_pos_control_l1 reset internal takeoff and landing state when arming
6 years ago
mcsauder
e6f1a2db12
Delete trailing whitespace, extra newlines, to quiet git hooks and add an extra = so that it does not appear to git as a merge conflict marker.
6 years ago
David Sidrane
1250fb1b48
RGB order now matchs layout
6 years ago
David Sidrane
eb58dae51b
lights:Remove conditional rgb led starting (do all of them)
...
There is no need to not to start a pwm based led or a
rgbled_ncp5623c if the old TCA62724FMG is started. They
will all work in parallel.
6 years ago
David Sidrane
91e548000f
bmp280:Locate internal to PX4_I2C_BUS_ONBOARD
6 years ago
David Sidrane
fd31091fdb
bmm150:Restored lost internal i2C
6 years ago
David Sidrane
005db51d7f
nxp_fmuk66-v3:Add support for rgbled_ncp5623c
6 years ago
David Sidrane
8504ffd8f2
nxp_fmuk66-v3:Set bmm150 orientation
6 years ago
David Sidrane
bfc704b60a
fmuk66-v3:Add pullup on LPUART0_RX
6 years ago
David Sidrane
ef882989fe
[Breaking Change]fmuk66-v3: Only Support Rev BX11
...
I2C bus chaged I2C0 is external, I2C1 internal
Added BMM150 on I2C1 @ Addr 0x100
Added BMP280 on I2C1 @ Addr 0x76
UART0 (/dev/ttyS1) now used at Telem 2
Chip select added for W25X40CLUXIG Calibration EE prom
Driver is not added at this time
6 years ago
Nico van Duijn
0b548fa684
Update submodule sitl_gazebo
...
This updates the submodule sitl_gazebo to include the iris_obs_avoid
sdf model
6 years ago
Nico van Duijn
b7784a1439
Add MAVLink stream and cmake sitl target
6 years ago
Alessandro Simovic
39d1751bbe
rc loss alarm: stop on RC reconnect
6 years ago
Alessandro Simovic
3d668d871b
tunes: don't let tune interrupt itself
6 years ago
Thijs Raymakers
52542f9802
adis16497: fix TEMP_OUT scaling
6 years ago
DanielePettenuzzo
75f1ad36d1
start px4flow after all rangefinders (including the ones going through rc.serial)
6 years ago
CarlOlsson
9a2617ad33
vtol_att_control: remove unused subscription variable
...
Signed-off-by: CarlOlsson <carlolsson.co@gmail.com>
6 years ago
Beat Küng
fe0c2d1352
mavlink autopilot_version: add vendor version
6 years ago
Julian Oes
be8ad46fc9
px_uploader.py: write timeout workaround
...
This is a workaround for the write timeout that we have seen for some
host computers trying to flash the firmware.
We don't know the root cause of the problem but we do observed the
following:
- For blocking writes with timeout (Pyserial write_timeout=0.5):
write() throws SerialTimeoutException. In systrace we see that the
select() call after write waiting for the write to be finished hangs
and finally times out.
- For blocking writes without timeout (Pyserial write_timeout=None):
write() hangs indefinitely. In systrace we see that the
select() call after write waiting for the write to be finished hangs.
- For non-blocking writes:
write() works but flush() hangs. In systrace we see that
ioctl(fd, TCSBRK, 1) which is (correctly) triggered by termios tcdrain
hangs.
Inspecting USB traffic using usbmon, we can see that the data which is
written actually seems to be sent and looking at responses from the
Pixhawk bootloader and the timings it looks like all the data has
arrived.
This workaround uses non-blocking writes without flushing and this
seemed to prevent the issue from happening so far.
Debugging was done in collaboration with Beat Küng and David Sidrane.
6 years ago
Julian Oes
187f3f2834
SITL: interim fix for replay
...
The replay functionality was broken with lockstep. This is an interim
fix for the replay functionality.
In the longer term it would be nice to leverage the lockstep speedup
for the replay.
6 years ago
Matthias Grob
463d5512d9
mc_att_control: only adapt yaw rate limit on control mode change
...
Put adaption into a method because it needs to be called when
the control mode or the parameter changes.
6 years ago
Matthias Grob
3375ae2c11
mc_att_control: parameter processing refactor
...
- Remove unnecessary in between rate limits member vectors.
- Only switch the yaw rate limit in auto modes,
other values stay the same anyways.
- Fill gain vectors with parameters in one line.
6 years ago
Matthias Grob
5ee1fcaebf
AttitudeControl: address @dagar's review comments
6 years ago
Matthias Grob
7e8cf87d0d
mc_att_control: move attitude control calculations into separate class
...
to modularize and simplify unit testing
6 years ago
Claudio Micheli
0eb4942f66
Commander: renamed print_msg_once variable into a more self-explanatory one.
...
Signed-off-by: Claudio Micheli <claudio@auterion.com>
6 years ago
Claudio Micheli
be6f753022
Fixed CI errors. changed _print_msg_once into private class member.
...
Signed-off-by: Claudio Micheli <claudio@auterion.com>
6 years ago
Claudio Micheli
e14e5b9d73
Commander: Changed COM_ONB_BOOT_T parameter to COM_OA_BOOT_T.
...
Since the time out is only Obstacle-Avoidance related, the new naming is more self explanatory.
Signed-off-by: Claudio Micheli <claudio@auterion.com>
6 years ago
Claudio Micheli
d937a5725b
Commander: reset print once variable if OA is lost.
...
Signed-off-by: Claudio Micheli <claudio@auterion.com>
6 years ago