Daniel Agar
28956e0399
Github actions: MAVSDK SITL tests fix log upload on failure
4 years ago
Daniel Agar
88c4876bac
Update submodule mavlink v2.0 to latest Thu Oct 8 12:40:37 UTC 2020
...
- mavlink v2.0 in PX4/Firmware (3332f77773460a2a1463d6d7a14e5613eab166e7): cc4220a4d4
- mavlink v2.0 current upstream: 894599e6cb
- Changes: cc4220a4d4...894599e6cb
Co-authored-by: PX4 BuildBot <bot@px4.io>
4 years ago
PX4 BuildBot
9940937636
Update submodule sitl_gazebo to latest Thu Oct 8 12:40:32 UTC 2020
...
- sitl_gazebo in PX4/Firmware (3f56cfe66e
): 9f74919d4d
- sitl_gazebo current upstream: e4e32117df
- Changes: 9f74919d4d...e4e32117df
e4e3211 2020-10-07 Daniel Agar - cmake: support ccache explicitly
97b90df 2020-10-07 Thies Lennart Alff - Add buoyancy in uuv_plugin (#627 )
5e03a40 2020-10-07 JaeyoungLim - Deprecate xacro macros (#623 )
30e3d6a 2020-10-07 JaeyoungLim - Only add accel/gyro turn on bias on startup (#626 )
4 years ago
Daniel Agar
3f56cfe66e
Update submodule mavlink v2.0 to latest Wed Oct 7 12:40:52 UTC 2020
...
- mavlink v2.0 in PX4/Firmware (d3ddca8bf3b409abcf7e0b7cc2b979a00cdbec73): e3d00c4436
- mavlink v2.0 current upstream: cc4220a4d4
- Changes: e3d00c4436...cc4220a4d4
Co-authored-by: PX4 BuildBot <bot@px4.io>
4 years ago
PX4 BuildBot
deee2af7ae
Update submodule ecl to latest Wed Oct 7 12:41:05 UTC 2020
...
- ecl in PX4/Firmware (6a18e45cf8225c6dab2e7c495ed687f449e8c44e): 4c2355a638
- ecl current upstream: f666ebb995
- Changes: 4c2355a638...f666ebb995
f666ebb
2020-10-06 Paul Riseborough - EKF: Code format fix - replace 1E-x with 1e-x
e82d0af
2020-10-06 Paul Riseborough - EKF: Improve code clarity - non functional change
1a7c68e
2020-10-06 Paul Riseborough - EKF: update change indicator
759d217
2020-10-05 Paul Riseborough - EKF: Improve protection for GSF weight collapse
7c81350
2020-10-04 Paul Riseborough - EKF: Don't yaw reset if not yaw induced nav failure
bf0d70f
2020-10-04 Paul Riseborough - EKF: Protect against collapse of GSF weights
4 years ago
Daniel Agar
378cb155d6
simulator: support accel/gyro instances and stuck failure
...
- expand simulator to 3 accels and gyros
- PX4Accelerometer/PX4Gyroscope switch to old param usage due to copy constructor issues with ModuleParams
4 years ago
Daniel Agar
c01fabaf11
FW move altitude first order hold (FOH) and loiter to position special cases from navigator to position controller
...
Co-authored-by: RomanBapst <bapstroman@gmail.com>
4 years ago
Daniel Agar
9838e340e0
systemcmds/tune_control: add play error documentation
4 years ago
JaeyoungLim
e0dc9900aa
Fix mavros tests by updating sdf version of the iris model
...
This commit switches the sdf version of the iris model from 1.7 to 1.6 so that it can be run on ROS melodic, which the MAVROS tests were running in
4 years ago
Silvan Fuhrer
84455ac9e3
logger: increase logging rate of airspeed_validated from 1Hz to 5Hz
...
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
4 years ago
Silvan Fuhrer
5a184d2f5c
Commenting and formating fixes
...
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
4 years ago
Silvan Fuhrer
8f858d95e6
Rename equivalent airspeed (EAS) to calibrated airspeed (CAS)
...
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
4 years ago
Silvan Fuhrer
f8d5b09b56
airspeed: remove duplicated comments from cpp (they should only be in header)
...
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
4 years ago
Daniel Agar
f01c4e769f
sensors/vehicle_imu: vehicle_imu_status add mean accel/gyro
...
- this makes it slightly easier to gather long term data for an Allan Variance
- fixes https://github.com/PX4/Firmware/issues/6250
4 years ago
Daniel Agar
08bf71b73d
drivers/tone_alarm and tune_control small improvements/cleanup
...
- drivers/tone_alarm: move to ModuleBase and purge CDev (/dev/tone_alarm0)
- drivers/tone_alarm: only run on tune_control publication (or scheduled note) rather than continuously
- drivers/tone_alarm: use HRT to schedule tone stop (prevents potential disruption)
- msg/tune_control: add tune_id numbering
- systemcmds/tune_control: add "error" special case tune_id
- move all tune_control publication to new uORB::PublicationQueued<>
- start tone_alarm immediately after board defaults are loaded to fix potential startup issues
- for SITL (or other boards with no TONE output) print common messages (startup, error, etc)
4 years ago
jaeyoung
c7072b61a3
Update jsbsim bridge to latest master
...
Update jsbsim bridge to latest master
4 years ago
jaeyoung
b7c1f6a857
Update sitl_gazebo to latest master
...
Update sitl_gazebo to latest master
4 years ago
Daniel Agar
016ee6ea59
battery: fix duplicate uORB publish and minor cleanup
...
- run battery_status module on adc_report publications rather than a fixed schedule
4 years ago
Daniel Agar
be28c4d309
lib/rc: dsm_bind() add debug output for binding
...
- trivial code style cleanup
4 years ago
Daniel Agar
ddce711acb
drivers/rc_input: command line bind use vehicle_command
4 years ago
Daniel Agar
1bf0218c87
boards: mRo Control Zero F7 fix RC input and cleanup sensors init
4 years ago
Daniel Agar
eabbd19c1c
commander: PreFlightCheck param_find all parameters immediately
...
- this ensures the relevant parameters are marked active immediately
before parameter sync
- fixes https://github.com/PX4/Firmware/issues/15872
4 years ago
blazczak
57da61dc17
posix-configs/rpi: Fix mavlink over UART (/dev/ttyAMA0)
...
UART is the primary interface for telemetry radio: https://docs.emlid.com/navio2/ardupilot/hardware-setup/#uart-radio
Check first if /dev/ttyUSB0 exists (https://docs.emlid.com/navio2/ardupilot/hardware-setup/#usb-radio ); if not, fall back to configuring over UART (/dev/ttyAMA0).
Use stricter check for character special file (-c) rather than just file (-f).
'console=serial0,115200' needs to be removed from /cmdline.txt as additional configuration step. This should be documented in the Navio2 section of docs.px4.io. Presumably, this is already performed as part of the Raspberry Pi OS prebuilt image Emlid spins.
4 years ago
Beat Küng
91fa2002e3
kakutef7: fix output ordering
...
Regression from d2254c2e44
, I overlooked that they were defined in
reverse order.
4 years ago
Daniel Agar
8ee0c62e57
examples: add Gyro FFT using CMSIS 5 on Cortex-m ( #15104 )
...
- this is a work in progress experiment to compute real time FFTs from raw gyro FIFO data on Cortex-m hardware (stm32f4/f7/h7, etc)
4 years ago
Daniel Agar
23aa9ac70f
cmake nuttx add STM32H7 debug helpers
4 years ago
Alex Mikhalev
c648d52909
uavcan: Increase uavcan main stack size
...
I observed stack overflows when executing `uavcan params list`, so the
stack size probably needs to be increased.
Signed-off-by: Alex Mikhalev <alexmikhalevalex@gmail.com>
4 years ago
SalimTerryLi
25eca31e3a
New board Scumaker AirPi HAT for Raspberry Pi B series
4 years ago
Nicolas MARTIN
967f741a0e
commander: add parameter COM_REARM_GRACE to optionally disable re-arming grace period
4 years ago
Daniel Agar
c1936dab1f
commander: accel & gyro subsystem health set within IMU check
4 years ago
Daniel Agar
25c537bae9
commander: don't impose additional timeouts in sensor checks
...
- the sensors hub is responsible for sensor timeouts
4 years ago
CarlOlsson
98c8cbb27f
ekf2: fix odom body rate sign bug
4 years ago
Julian Oes
b454095776
commander: fix switch to loiter
...
Sometimes, the mission_result timestamp is the same as the
internal_state timestamp which would meant that we would not switch to
LOITER even though the takeoff is clearly done at that point.
4 years ago
David Sidrane
46f0388fc7
Reanable BL Update - Reverts b5267c06073023893d5a11b9011ef009b5291097
4 years ago
David Sidrane
68703135c3
bl_update:Respect page size if it matters
...
Track Changes in NuttX stm32h7 flash driver:
The STM32H7 flash driver uses up_progmem_pagesize to
describe minimum write size to satify the block size
requierment for ECC.
Therefore, the image size needs to be padded to a multiple
of up_progmem_pagesize()
4 years ago
JaeyoungLim
ff6b82cb6b
Replace xacro macros to jinja templates for multivehicle ( #15831 )
...
This commit switches xacro macros to jinja templates for multivehicle simulations.
4 years ago
JaeyoungLim
9d3e159e65
Make mavsdk test runner handle generated sdf files ( #15797 )
...
Update sitl_gazebo
Fix indent errors
Fix syntax error
Fix indentation errors
Fix syntax errors
use autopep8
4 years ago
Daniel Agar
c9c20666a2
sensors: sanity check differential pressure temperature ( #15845 )
...
- if valid temperature unavailable then use ICAO Standard Atmosphere 15 degrees celcius
4 years ago
Nicolas Martin
da4d0e650a
mc_pos_control: fix acc Z sign
4 years ago
Daniel Agar
24ffed827f
ROMFS: 50000_generic_ground_vehicle remove fmu-v2 exclude
...
- this allows px4_fmu-v2_rover to function until we have a better mechanism for including or excluding ROMFS dependencies #15711
4 years ago
David Sidrane
59f20a26eb
motor_params:Move to mixer_module
...
sensors having mixer_module creates a dependency on sensors for
the param MOT_SLEW_MAX. Things that do not uses sensors.
IE. PWM only device should not have to include them.
4 years ago
Daniel Agar
f1feaf45d3
EKF2: move vehicle_odometry publish to method
4 years ago
Daniel Agar
faccb0d948
Jenkins: HIL script minor improvements
...
- periodically send newline while checking for output or command completion (back to nsh prompt)
- mtd test
- fix adc test (now board_adc)
4 years ago
JaeyoungLim
c342ab91b3
Fix the world path being corrupting when spawning none-default world
...
This fixes a bug, where the world file path was being corrupted when using non-default world paths
4 years ago
JaeyoungLim
f7356d0286
Update jsbsim_bridge to latest master
4 years ago
Daniel Agar
fe6a1ce882
simulator: fix airspeed temperature
...
- HIL_SENSOR temperature is only being sent with barometer data
4 years ago
Daniel Agar
828134c56f
sensor_calibration: add link dependencies
4 years ago
David Sidrane
529d816a39
px4_fmu-v6x:Support ETM Hardware Trace
4 years ago
PX4 BuildBot
1822a678f6
Update submodule ecl to latest Mon Sep 28 12:39:19 UTC 2020
...
- ecl in PX4/Firmware (2b34fec0844646d13a57f78dbbed44b53813919e): 6b99ea2a60
- ecl current upstream: 4c2355a638
- Changes: 6b99ea2a60...4c2355a638
4c2355a
2020-09-25 Daniel Agar - EKF: use GPS to lookup declination from WMM before full GPS checks pass
4 years ago
Daniel Agar
cf26f24387
msg: add quaternion euler angle pretty print
4 years ago