Commit Graph

2217 Commits

Author SHA1 Message Date
Lorenz Meier 6cd669836c ROMFS: Exclude uncommon board configs (Firefly 6) 2020-03-16 23:40:29 +01:00
Lorenz Meier af9b073c9a ROMFS: Exclude uncommon board configs (Steadidrine Mavrik) 2020-03-16 23:40:29 +01:00
Lorenz Meier 440067870a ROMFS: Exclude uncommon board configs (Octo COX) 2020-03-16 23:40:29 +01:00
Lorenz Meier f3e4aec45a ROMFS: Exclude uncommon board configs (Hexa COX) 2020-03-16 23:40:29 +01:00
Lorenz Meier 079772823a ROMFS: Exclude uncommon board configs (TBS Endurance) 2020-03-16 23:40:29 +01:00
Lorenz Meier 65052717fe ROMFS: Exclude uncommon board configs (Steadidrone Q4D) 2020-03-16 23:40:29 +01:00
Lorenz Meier 83c0d4607e ROMFS: Exclude uncommon board configs (3DR Iris) 2020-03-16 23:40:29 +01:00
Lorenz Meier df49d1d815 ROMFS: Exclude uncommon board configs (TBS Dicovery) 2020-03-16 23:40:29 +01:00
Lorenz Meier 4f2d39cb15 SITL plane: Do not configure trigger
We have a plane_cam configuration for survey applications instead.
2020-03-14 17:50:40 +01:00
Lorenz Meier 39e473f988 Gazebo plane model: Enable tighter turns
This helps to fly smaller / faster test missions.
2020-03-14 17:50:40 +01:00
Lorenz Meier 76b3c18625 Add dedicated survey camera plane model
This is to allow us to test triggering properly in SITL
2020-03-14 17:50:40 +01:00
Lorenz Meier 320cc8bae6 POSIX SITL: Enable trigger control in plane model
This allows to test plane survey missions with the camera trigger included in SITL.
2020-03-14 17:50:40 +01:00
Daniel Agar 0eca583ecf sensors: move baro aggregation to new sensors/vehicle_air_data 2020-03-12 19:06:34 -04:00
Daniel Agar 093e9ba1ce
mc_rate_control: use vehicle_angular_acceleration topic instead of differentiating
* mc_rate_control: use vehicle_angular_acceleration topic
* IMU_DGYRO_CUTOFF change default to 30 Hz
* improve IMU_DGYRO_CUTOFF param documentation (updated from MC_DTERM_CUTOFF)
2020-03-12 15:07:03 -04:00
Daniel Agar 5d33b9e999
delete Outback Challenge (OBC) AUTO_RTGS (datalink loss) and AUTO_RCRECOVER (rc loss) 2020-03-11 22:45:55 -04:00
Daniel Agar f9794e99f8
move hover_thrust_estimator to new module (mc_hover_thrust_estimator)
* MC_HTE: unitialize with hover_thrust parameter
* MC_HTE: constrain hover thrust setter between 0.1 and 0.9
* MC_HTE: integrate with land detector and velocity controller
* MCHoverThrustEstimator: Always publish an estimate even when not fusing measurements. This is required as the land detector and the position controller need to receive a hover thrust value.

* MC_HTE: use altitude agl threshold to start the estimator
local_position.z is relative to the origin of the EKF while dist_bottom
is above ground

Co-authored-by: bresch <brescianimathieu@gmail.com>
2020-03-11 21:20:54 -04:00
Beat Küng e627fed117 fmu-v2: disable perf command and some airframes
to reduce FLASH size
2020-03-10 10:11:43 -04:00
Matej Frančeškin b8970673c6 Fixed Mavlink FTP tests 2020-03-08 21:43:54 +01:00
Katrin 116de6d25f
Airframe and mixer for rover DF Robot GPX:Asurada (#14244)
Added Airframe and mixer for rover DF Robot GPX:Asurada

Co-authored-by: Julian Oes <julian@oes.ch>
Co-authored-by: Lorenz Meier <lorenz@px4.io>
2020-03-08 14:35:24 +01:00
Julian Oes 874c6f385b commander: unify offboard timeouts
The implementation before this change had two timeouts, a hard-coded
timeout of 0.5 seconds as well as a by param configurable timeout with
certain failsafe actions set.

This change aims to fix two problems:
1. The hard-coded offboard timeout can be triggered easily with sped up
   lockstep simulation. Since i t is hard-coded it can't be adapted to
   the speed factor.
2. The offboard signal can time out but no action will be taken just
   yet. This means we end up in an in-between stage where no warning or
   failsafe action has happened yet, even though certain flags are set
   to a timeout state.

This patch aims to fix this by unifying the two timeouts to the existing
configurable param. The convoluted double timeout logic is replaced by a
simple hysteresis.

For anyone that has previously not changed the default timeout param (0),
the param will now be changed to 0.5 seconds which reflects the
previously hardcoded time. For anyone with a specific timeout
configured, the behaviour should remain the same.

Also, going forward, timeouts lower than 0.5 seconds should be possible.
2020-03-04 09:35:14 +01:00
Julian Oes 43a1257843 ROMFS: prevent auto-disarm before takeoff in CI
Sometimes in CI for VTOL we saw disarms before the spoolup and ramp were
over and the takeoff would actually happen. By raising the auto-disarm
time we should be able to work around this and get CI less flaky.
2020-02-21 09:58:21 -05:00
JaeyoungLim e0d6f94318 Add boat(usv) sitl target 2020-02-21 00:30:15 -08:00
JaeyoungLim c89766c8ab Fix gcs udp port to support more vehicles in multivehicle sitl
Limit remote udp port to 14549


Fix


Cleanup port handling


Fix bash syntax


Fix
2020-02-19 14:23:17 +01:00
JaeyoungLim 7a1464d992
Revert port change (#14177)
Reverts #14126 and #14176 until CI failures can be resolved
2020-02-18 14:56:04 +01:00
JaeyoungLim b365fbf1e9 Fix bash syntax 2020-02-18 13:55:24 +01:00
JaeyoungLim 30cc3a1243 Cleanup port handling 2020-02-18 13:06:46 +01:00
JaeyoungLim fc61d1c43d Limit remote udp port to 14549
Fix
2020-02-18 13:06:46 +01:00
JaeyoungLim 2bcd8490ff Fix gcs udp port to support more vehicles in multivehicle sitl 2020-02-18 13:06:46 +01:00
Daniel Agar d7c3e1066a
uavcannode updates and px4_fmu-v4_cannode example
- drivers/uavcannode add baro, mag, gps publications
 - delete old px4_cannode-v1 board
 - add stripped down simple rcS for CAN nodes
2020-02-16 12:11:54 -05:00
Beat Küng 73bd90ddd5 crazyflie: fix PWM channel ordering
Channels belonging to a certain timer were not all grouped together.
This is required by the .first_channel_index and .last_channel_index data
members.

We introduce a new mixer geometry to solve the problem.
2020-02-13 03:49:16 -08:00
Daniel Duecker 36f836be79
add support for unmanned underwater vehicles (#14079)
* add support for unmanned underwater vehicles:
* airframe uuv_generic + uuv_hippocammpus including mav_type = 12 for submarines
* mixer for UUVs with X-shaped thruster setup similar to quadcopter
* add module  uuv_att_control for underwater robot attitude control
* add rc.uuv_defaults/apps for autostarting e.g. ekf2 and uuv_att_control app
2020-02-04 23:24:37 -05:00
JaeyoungLim 6dc3cbbd95
SITL add catapult plane target for new gazebo model (plane_catapult) 2020-02-02 11:59:17 -05:00
kritz 92e75452f5
Flow mockup (#14054)
* Add optical flow mockup model

* Update Tools.sitl_gazebo
2020-01-29 14:06:46 +01:00
Daniel Agar dc5e10c3b1 airframes: delete 4004 H4 680mm
- this doesn't include any actual airframe configuration
2020-01-28 07:43:26 +01:00
Daniel Agar b95442b38f airframes: delete 4012 quad x can 2020-01-28 07:43:26 +01:00
Daniel Agar 4ac3ce9f54 airframes: delete 4002 quad x mount
- the mount can be enabled via parameter
2020-01-28 07:43:26 +01:00
Roman Dvořák 497ab07daf airframes: add ThunderFly Auto-G2 autogyro (#14015) 2020-01-27 16:21:52 +01:00
Daniel Agar dc05ceaad2
create temperature_compensation module
- this is a new module for temperature compensation that consolidates the functionality previously handled in the sensors module (calculating runtime thermal corrections) and the events module (online thermal calibration)
 - by collecting this functionality into a single module we can optionally disable it on systems where it's not used and save some flash (if disabled at build time) or memory (disabled at run time)
2020-01-20 21:42:42 -05:00
Julian Oes 735749e341 Revert "SITL shell: Do math using the shell"
This reverts commit be35c4857b.

This would only work for integer math, so for simulation speed-up. For
speeds slower than realtime we need floating point.
2020-01-17 10:32:21 +01:00
Daniel Agar d32a80df3a
simulator: replace gpssim with simple orb publication
- this is one of the last pieces of the system that still depend on DriverFramework
 - add new SIM_GPS_NOISE_X parameter for optionally increasing the GPS noise multiplier (was previously a gpssim command line option)
 - add SIM_x_BLOCK parameters to block sensor publication
   - SIM_GPS_BLOCK
   - SIM_ACCEL_BLOCK
   - SIM_GYRO_BLOCK
   - SIM_MAG_BLOCK
   - SIM_BARO_BLOCK
   - SIM_DPRES_BLOCK
2020-01-09 10:30:20 -05:00
Jacob Dahl d08ec05bab PWM automatic trigger system (ATS) for parachutes (#13726)
* parameter and logic to commander for triggering failsafe from external automatic trigger system.
* logic to startup script for enabling ATS. Added uORB publishing to pwm_input module.
* Refactored out CDev usage from pwm_input and ll40ls. Refactored out ll40ls specifics from pwm_input and cleaned up dead code.
2020-01-06 20:14:06 -05:00
Daniel Agar 44f9de5e37
delete parrot bebop board support
This target was never fully supported and is heavily dependent on a number of DriverFramework drivers that have no in tree equivalents (bebop bus, flow, rangefinder, etc). Deleting this will make it easier to fully drop DriverFramework shortly.
2020-01-05 19:46:51 -05:00
Lorenz Meier f5ce40e434 FMUv2: Exclude some multicopter targets
These are rarely used airframes that should not be missed.
2019-12-26 10:16:58 +01:00
Lorenz Meier 0c85c5d18e FMUv2: Exclude some fixed wing targets
These are rarely used airframes that should not be missed.
2019-12-26 10:16:58 +01:00
Lorenz Meier 02119c1832 FMUv2: Exclude rover targets
This is reasonable as these boards are very old and rovers are a new area of activity.
2019-12-26 10:16:58 +01:00
Lorenz Meier be35c4857b SITL shell: Do math using the shell
Bash or zsh from the last 10 years or so do math using the $((a + b)) syntax. This saves us from having bc as dependency.
2019-12-26 10:16:58 +01:00
Julian Oes 81809d8234 ROMFS: prevent high accel bias in SITL 2019-12-26 10:16:58 +01:00
JaeyoungLim 4bcdf560be airframes: add config for px4vision devkit drone (#13683)
* Added configuration file for Pixhawk Vision

Signed-off-by: RomanBapst <bapstroman@gmail.com>
2019-12-16 08:21:17 +01:00
Ricardo Marques 86d3453343 Fix rover_sitl mixer call in CMakeLists.txt 2019-12-12 13:43:08 -05:00
Daniel Agar f769b80fde cmake px4_add_romfs_files FATAL_ERROR if file doesn't exist 2019-12-12 13:42:30 -05:00
Matthias Grob 904ab16558 Fix trailing whitespace, EOF newline, indentation 2019-12-09 13:22:19 +01:00
RomanBapst 634e8d206a tiltrotor SITL config: increase transition time from 1.5 to 5 seconds
- avoids tilting the motors forward too fast

Signed-off-by: RomanBapst <bapstroman@gmail.com>
2019-12-03 13:57:58 +03:00
Daniel Agar 0cc250194d
VTOL: explicitly start all FW & MC controllers in VTOL mode 2019-11-30 12:58:36 -05:00
Daniel Agar bc182e94e6
sensors split rc_update into new standalone module 2019-11-24 13:25:11 -05:00
Matthias Grob 6589aa5f71 posix rcS: remove overwriting default altitude 2019-11-22 13:36:05 -05:00
Julien Lecoeur 053ede6ca5 SITL: create a parameter file for each airframe 2019-11-21 15:55:49 +00:00
Julien Lecoeur be99064133 SITL: add SYS_AUTOCONFIG support 2019-11-21 15:55:49 +00:00
Daniel Agar 84fe64b1c2
create new multicopter rate controller module (mc_rate_control) split out of mc_att_control 2019-11-19 17:03:11 -05:00
Nik Langrind ba5efa5642 px4io: When running HITL, don't publish actuator_outputs. Fixes #13471.
When running in HITL mode, pwm_out_sim publishes actuator_outputs.

px4io unconditionally publishes the uOrb actuator_outputs. When HITL
is configured, the px4io copy of the uOrb has all zeros.

The result is that there are two publications, one valid, and one
all-zeros. This causes the HIL_ACTUATOR_CONTROLS mavlink message
to be incorrect (all-zeros) and the SERVO_OUTPUTS_RAW mavlink
message to be inconsistent, as it takes the data from one or the
other uOrb randomly each cycle.

The fix is to let px4io know that HITL is in effect when it is
started, and modify px4io to suppress publication in this case.

This is a bigger more complicated fix than I would like, but I
think it is conceptually correct.

Signed-off-by: Nik Langrind <langrind@gmail.com>
2019-11-17 11:19:35 +01:00
Daniel Agar a694f0bbdd bl_update: build and include board bootloader if config available 2019-11-16 11:43:42 +01:00
Daniel Agar 2af262ed1d NuttX cmake build wrapper thorough dependencies 2019-11-16 11:43:42 +01:00
TSC21 d4ddabdf52 SITL: adds 'iris_rtps' target 2019-11-13 18:24:11 +00:00
Oleg Kalachev 942cdb1fa5 Add COEX Clover 4 airframe 2019-11-11 22:45:52 -05:00
Daniel Agar 668984b6b0 boards: start adc in rc.board_sensors 2019-11-11 17:08:24 -05:00
xdwgood f984c4e450 ROMS: delete caipirinha_vtol.main.mix and instead use vtol_tailsitter_duo.main.mix 2019-11-11 10:40:20 +01:00
Pandacoolcool ec0244906f fix yaw control error 2019-11-11 10:40:20 +01:00
Pandacoolcool 5c7da88265 remove unuse param 2019-11-11 10:40:20 +01:00
Daniel Agar 7a82df3872
UVify Core and Draco-R updates
* Draco-R sensor orientation correction
* LL40LS sensor is not stable during I2C probing. More trials have been implemented.
* px4flow execution has been removed as rc script already running it
* GPS LED script repaired
* Off ICM20608 due to some bug?
* Removed i2c speed adjustment due to SMBUS.
* ms5611 test2 does not exist
* Baud rate has changed.
* Draco-R airframe parameters are updated.
* IFO and Draco parameters are updated
* Draco-R sensor orientation corrected
* Draco-R DSHOT supports
2019-11-02 11:39:41 -04:00
Jacob Dahl 66b3a4269b updated maintainer on 4250_teal 2019-10-30 15:31:04 +00:00
JaeyoungLim 4c8f27cf57 Fix typhoon h480 parameter (#13263) 2019-10-25 10:46:27 +02:00
Jaeyoung-Lim f7871ec9de Retune h480 2019-10-23 16:55:30 +01:00
RomanBapst 06a902f598 rcS: do not wipe next flight UUID parameter when resetting parameters
Signed-off-by: RomanBapst <bapstroman@gmail.com>
2019-10-23 16:54:17 +01:00
Daniel Agar 6a0f5249f8
sensors: split out analog battery handling to new standalone battery_status module 2019-10-21 13:40:23 -04:00
Beat Küng 349469cf75 refactor pwm_out_sim: use mixer_module and run on work queue
Tested with SITL + HITL
2019-10-21 09:42:08 +02:00
Daniel Agar bde36f0f4a
ROMFS: rc.vtol_defaults limit inner loop rate (#13196)
- temporary remedy for https://github.com/PX4/Firmware/issues/13149
2019-10-16 12:27:06 -04:00
Beat Küng b080679146 kakutef7, kopis airframe: enable dshot & telemetry 2019-10-11 08:14:17 +02:00
Beat Küng 132dcdaf25 beta75x airframe: enable DShot600 2019-10-11 08:14:17 +02:00
Beat Küng d8ef1b59b9 ROMFS: add dshot startup support 2019-10-11 08:14:17 +02:00
BazookaJoe1900 02e861b16e enable silent compare of parameter (#12850)
Remove false errors after comparing parameters that doesn't exists.
as described in #12832
2019-10-07 09:50:11 +02:00
garfieldG bbb96cbd0c Mavlink startup script per board
-moved rc.mavlink to the boards optional rc additions (now it's called rc.board_mavlink) to handle board specific mavlink needs (mavlink over usb, ethernet, additional streams, etc.)
-mavlink module will be responsible to usb defaults, therefore less args are needed to be passed to mavlink module if one wants to use mavlink over usb.
-the way to check if connection is usb is by it's designated variable and not by config mode.
2019-09-29 10:46:08 -04:00
mcsauder 7b16c3482d Refactor the ll40ls namespace driver methods to more closely match the cm8jl65, mappydot, leddar_one, and other distance sensor driver implementations. 2019-09-27 07:55:53 +01:00
bazooka joe 49c74ab021 add new parameter LIGHT_EN_BLINKM to start blinkm lights 2019-09-02 20:02:00 -04:00
BazookaJoe1900 8a45c6145b add new parameter SENS_EN_PMW3901 to start pmw3901 optical flow 2019-09-02 11:08:51 -04:00
mcsauder 0817ee40f8 Add generic vtol tailsitter airframe/mixer and incorporate modifications from PR 9849 in 4001_quad_x and 13001_caipirinha_vtol. 2019-09-01 18:35:14 -04:00
Matthias Grob 328544ae2e deltaquad: remove deprecated parameter MAN_R_MAX 2019-09-01 14:56:59 -04:00
Daniel Agar 10ed88db57
VTOL airframes update legacy VT_MOT_COUNT parameter 2019-09-01 13:09:48 -04:00
BazookaJoe1900 e3b60cd9e7 rc.sensors: moved common ms5611 start to rc.board_sensors per board 2019-09-01 12:55:50 -04:00
Silvan Fuhrer db4b4719c3 BabyShark VTOL: update config file
- increased transition throttle
 - enable airmode
 - increased max roll angle

Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
2019-08-29 09:58:20 -04:00
Hyon Lim 0262a699c1 UVify Core board support and airframes (Draco, Draco-R, IFO) (#12337)
* also includes minor changes to make it easy to keep in sync with px4_fmu-v4
2019-08-23 17:02:25 -04:00
Claudio Micheli f3eafdc296 Fix wrong initialization of PWM_AUX_RATE.
Signed-off-by: Claudio Micheli <claudio@auterion.com>
2019-08-23 15:37:57 +02:00
Todd Colten b55ae09f00 FW: set default RTL_TYPE = 1 for fixed wing
This change adds the line "param set RTL_TYPE 1" to the default init scripts for fixed wing.  Similar to the other PR that sets default RTL_TYPE=1 for VTOLs, RTL_TYPE=1 should be default for normal fixed wings as well.  Reference: https://github.com/PX4/Firmware/pull/12746/files
2019-08-22 08:47:50 +02:00
Silvan Fuhrer 536f073d02 VTOL: set RTL_TYPE default for VTOL to 1 (return to home via mission landing if available) 2019-08-21 10:15:06 +02:00
Silvan Fuhrer 5a736c9af8 update babyshark VTOl config
Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
2019-08-21 05:23:25 +02:00
Daniel Agar 7d248e0f45
px4fmu: move to WQ with uORB callback scheduling (#12224) 2019-08-20 20:24:12 -04:00
Beat Küng a7eed520b4 commander: refactor module usage output 2019-08-19 10:54:56 +02:00
Silvan Fuhrer cedf14e2ba Airspeed Selector: repurpose wind estimator into an airspeed (selection, validation) module.
This new airspeed module does:
  -runns an airspeed validator for every airspeed sensor present, which checks measurement validity and estimates an airspeed scale
  -selects another airspeed sensor if for the current one a failure is detected
  -estimates airspeed with groundspeed-windspeed if no valid airspeed sensor is present
  -outputs airspeed_validated topic

Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
2019-08-09 10:55:05 +02:00
Matthias Grob 45187e1aa8 Improve magnetometer inconsistency check
To check directional difference between the magnetometer field vectors
instead of vector component difference.
2019-08-07 18:44:39 +02:00
Daniel Agar bf474028ff px4flow add parameter to enable (SENS_EN_PX4FLOW)
- fixes https://github.com/PX4/Firmware/issues/12571
2019-08-06 10:55:35 -04:00
RomanBapst cfba41d2f4 posix configs: set trigger interface to mavlink as it's the only one
supported on posix

Signed-off-by: RomanBapst <bapstroman@gmail.com>
2019-08-06 08:08:56 +02:00
Timothy Scott 3850322046 Added module.yaml and serial port configuration. 2019-08-05 02:45:33 -07:00
Timothy Scott 2406aa8b50 Further fixing up parameters 2019-08-05 02:45:33 -07:00
Timothy Scott 6ea03bee58 Ongoing work to update RoboClaw driver 2019-08-05 02:45:33 -07:00
Daniel Agar 77694183b2 delete position_estimator_inav 2019-08-02 17:38:28 -04:00
Beat Küng 8e5aaff76b airframes: add Kopis 2 2019-07-25 10:38:57 -04:00
Julien Lecoeur 8f47535b54 ROMFS: fix airframe incremental build 2019-07-24 05:40:53 -07:00
Julien Lecoeur 24c2846750 ROMFS: add explicit dependency to parser scripts 2019-07-24 05:40:53 -07:00
Julien Lecoeur daeba4e75f Add airframe .post scripts on NuttX targets 2019-07-22 13:02:45 +02:00
Matthias Grob e964af9262 commander_params: enable RC override by default
It doesn't affect fixed wing flying anymore. I disabled it for the
deltaquad since I presume @sanderux prefers to have the feature disabled
even when flying in multicopter mode.
2019-07-22 09:57:37 +02:00
Matthias Grob aaad71faab commander_params: enable automatic disarming after land detection by default 2019-07-18 14:36:50 +02:00
Mark Sauder 4a02475dd1 rcS: reduce a few LOC in AUTOCNF logic (#12467)
* Set/unset rcS vars at beginning and end of rcS script and reduce a few LOC checking SYS_AUTOCONFIG with improved logic.

* Restore current placement of set/unset vars in rcS script to leave only the SYS_AUTOCONFIG logic modification.

* Replace set AUTOCNF no after inadvertent deletion.
2019-07-16 16:48:25 +02:00
Beat Küng 84bca7e4d0 shellcheck: disable SC2181
The combination of 'if mycmd' and a logical expression is not supported in
NuttX.
2019-07-16 08:09:22 +02:00
Beat Küng 92c2d7ae36 CBRK_BUZZER: allow to disable startup sound
The 'if [ $LOG_FILE = /dev/null ]' block can be removed, because
STARTUP_TUNE is already set in that case.
2019-07-16 08:09:22 +02:00
Beat Küng 5fe4c61b42 rc_input: add RC_PORT_CONFIG param to configure RC port
The parameter will only be available if the board defines an 'RC' serial
port in SERIAL_PORTS (in default.cmake).
2019-07-16 08:09:22 +02:00
Beat Küng a3c920db7d board_defaults: remove unnecessary 'set MIXER_AUX none'
On all of these boards '$USE_IO = no' will hold.
2019-07-16 08:09:22 +02:00
Timothy Scott 2ed00c9cb6 Rover: Rewrote gnd_pos_control and removed gnd_att_control (#12239) 2019-07-11 09:39:13 -04:00
Daniel Agar d4cd1d0d2e
NuttX stm32f7 fully re-enable dcache with write back (#12435)
- fixes https://github.com/PX4/Firmware/issues/12216
 - includes latest PX4/NuttX and apps update 7.29+
2019-07-10 19:08:12 -04:00
Silvan Fuhrer fdcb0f06d6 Babyshark VTOL: updated config file (new smooth flight task, detuned position control,
improved land detector, included autopilot rotation)

Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
2019-07-09 15:38:40 +02:00
Daniel Agar aff13f6f64 rc.fw_defaults: reduce EPH/EPV failsafe values from 5x to 3x MC 2019-07-08 17:50:54 -04:00
BazookaJoe1900 df45124d02 black sheep telemetry add new TEL_BST_EN parameter to enable 2019-07-08 16:30:22 -04:00
Timothy Scott f7a460427b Changed name of mixer to be shorter 2019-07-05 18:00:15 +02:00
Silvan Fuhrer 9b46c1d8a9 Upated Babyshark VTOL config and vtol_defaults
Updated the babyshark default  parameters for improved flight performance,
as well as two MPC parameters in vtol_defaults for smoother hovering with VTOLS"

Signed-off-by: Silvan Fuhrer <silvan@auterion.com>
2019-07-04 11:26:01 -04:00
Fabian Schilling d139bc5a7c Use bc to support floating point PX4_SIM_SPEED_FACTOR 2019-07-03 16:54:29 +02:00
RomanBapst 7bba5a7287 vtol_configs: replaced VT_MOT_COUNT with VT_MOT_ID
Signed-off-by: RomanBapst <bapstroman@gmail.com>
2019-06-27 20:14:10 +02:00
Daniel Agar 6d9bf18ca6 Revert "VTOL: add parameter to prevent flight if roll direction was not checked"
This reverts commit 5f06c6a1aa.
2019-06-25 09:26:20 +02:00
Matthias Grob 443381327e Airframes: rename normal S500 to generic and remove PX4 defaults 2019-06-24 18:26:27 +02:00
Matthias Grob c22825ee45 Airframes: add Holybro S500 Kit which was tested at dev summit 2019-06-24 18:26:27 +02:00
Ildar Sadykov fb8630c267 Adding VTOL Octoplane airframe type (#12303)
* Srcparser updated, default script for VTOL octoplane added.
2019-06-22 14:13:29 +02:00
Beat Küng 64ac8c18d2 mc airframes: increase I gains a bit
Previous commit allows to increase them again.
Partially reverts commit 6c3e79f361.
2019-06-22 13:23:19 +02:00
Kabir Mohammed ce784d1ef0 Sensordots Mappydot+ driver (#12147)
* Add MappyDot+ driver capable of utilizing multiple sensors on a single i2c bus.
2019-06-15 21:13:51 -04:00
David Sidrane 6eb4cf0ceb Add CUAV 5+ and Nano to fmu-v5 manifest
* rcS: Set SYS_USE_IO for Nano
2019-06-14 13:19:41 -04:00
Timothy Scott 327354705b Fixed filename 2019-06-13 10:04:26 +02:00
Timothy Scott 21760a5856 Changed constant name to UNMANNED_GROUND_VEHICLE 2019-06-13 10:04:26 +02:00
Beat Küng 73102dc3c4 SYS_MC_EST_GROUP: add q estimator only option and activate on omnibus 2019-06-06 11:11:44 -04:00
Beat Küng 5c715978e8 param compare/greater: do not print 'parameter not found' message
Reduces clutter in the boot output (now that we have it in the log).
On omnibus for example we see:
ERROR [param] Parameter SENS_EN_BATT not found
ERROR [param] Parameter SENS_EN_LL40LS not found
ERROR [param] Parameter SENS_EN_LL40LS not found
ERROR [param] Parameter SENS_EN_MB12XX not found
ERROR [param] Parameter SENS_EN_PGA460 not found
ERROR [param] Parameter SENS_EN_SF1XX not found
ERROR [param] Parameter SENS_EN_TRANGER not found
2019-06-06 09:16:49 -04:00
bresch e8705f08c4 quad_x_main - rename parachute output to failsafe output 2019-06-05 16:53:08 +02:00
bresch c73875cbf8 quad x mixer - Add null mixer for parachute triggering 2019-06-05 16:53:08 +02:00
Daniel Agar 43e3fc707d
simulator move to PX4Accelerometer, PX4Gyroscope, PX4Magnetometer, PX4Barometer helpers (#12081) 2019-05-30 21:07:26 -04:00
Beat Küng ed9d25a75a logger: add arming/disarming via AUX1 RC channel logging mode 2019-05-29 11:41:22 +02:00
Beat Küng 6da78c956e SYS_COMPANION: remove this parameter
It was already deprecated.
2019-05-29 09:15:52 +02:00
Beat Küng 5d6cc7d033 ekf2: reduce GPS initialization time for SITL from 10s to 0.5s
Speeds up SITL startup.
2019-05-28 10:45:38 +02:00
Timothy Scott d78a842ca8 Rover: add airframe configuration for Aion R1 Rover (#12026)
* Added Aion R1 airframe
* Tuned PID values for Aion R1
* Changed to generic mixer and cleaned up configuration
2019-05-17 08:51:16 -04:00
Julian Oes 01fdd00c41 init.d-posix: $ is apparently not needed here 2019-05-14 11:04:04 +02:00
Julian Oes ffeeedc310 init.d-posix: raise timeouts for fast SITL
When simulating with lockstep we can raise the speed by setting the env
variable `PX4_SIM_SPEED_FACTOR`. Some inputs like RC, MAVLink heartbeats
from a ground station, or offboard controls via MAVLink are still at the
normal speed which leads to timeouts getting detected in PX4.

To work around this issue we can automatically multiply the timeout
parameters by the speed factor.
2019-05-14 11:04:04 +02:00
Beat Küng 2448a84c36 SITL: add if750a model 2019-05-03 13:32:48 +02:00
Claudio Micheli e7075a6660 rcS: Fix multiple set IO_PRESENT.
Signed-off-by: Claudio Micheli <claudio@auterion.com>
2019-05-03 12:20:49 +02:00
Julian Oes 611417acd2 ROMFS: use auto-disarm in HITL Gazebo with Iris
It is expected that Iris auto-disarms the same as in SITL.
2019-04-30 06:39:35 -05:00
Daniel Agar f032d0d9fc
SYS_MC_EST_GROUP mark LPE unsupported and update airframes (#11925) 2019-04-29 11:50:36 -04:00
Julian Oes 4ef59e0a59 standard_vtol: transition at airspeed of 16 m/s
This way we prevent a big dip due to TECS in altitude when the
transition happens at 10 m/s already. Apparently the rule of thumb
is to set this transition speed at the same as airspeed cruise speed.
2019-04-28 18:22:21 -04:00
bresch 89bc68e12b Auto - Rename MC_YAWRAUTO_MAX -> MPC_YAWRAUTO_MAX 2019-04-26 12:43:26 +02:00
sfuhrer 3d36dbfba3 added babyshark VTOL config file and mixer 2019-04-16 11:05:35 -04:00
Beat Küng 744b50b478 send MAVLink GROUND_TRUTH at 25 Hz, only in SIH mode. And minor cleanup 2019-04-12 09:25:07 +02:00
romain e1d9438f79 sih: remove SYS_SIH parameter and extend SYS_HITL 2019-04-12 09:25:07 +02:00
romain 6ff228c2ff sih module implemented with hrt_call_every and semaphore_wait 2019-04-12 09:25:07 +02:00
Beat Küng 914a9b78b6 new airframe for sih, HIL_STATE_QUATERION sent through MAVLink 2019-04-12 09:25:07 +02:00
Daniel Agar 5a50f96bcf
move icm20948 (Here GPS compass) to Cube sensors start (#11838) 2019-04-11 11:15:53 -04:00
Julian Oes 98857b4b94 ROMFS: don't check for UAVCAN_ENABLE param in SITL
This prevents a warning message being printed to SITL users because the
UAVCAN_ENABLE param does not exist.
2019-04-05 08:18:17 +02:00
Julian Oes 82682ac716 init.d-posix: re-use rc.logging
With this change the param SDLOG_MODE can be used for SITL as well.
2019-04-05 08:18:17 +02:00
Beat Küng 0bb5225370 rcS: add airframe parameter versioning and extend SYS_AUTOCONFIG 2019-04-05 08:08:47 +02:00
Daniel Agar 0c226e9b64 cmake fix ROMFS build dependencies 2019-04-03 12:33:12 -04:00
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. 2019-04-02 15:31:37 -04:00
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.
2019-04-02 13:40:17 -04:00
Nico van Duijn b7784a1439 Add MAVLink stream and cmake sitl target 2019-04-02 08:17:13 +02:00
DanielePettenuzzo 75f1ad36d1 start px4flow after all rangefinders (including the ones going through rc.serial) 2019-03-28 06:04:10 -04:00
Beat Küng 14ef009aab logging: add SDLOG_MODE = -1 to disable logging completely 2019-03-21 08:15:48 +01:00
Julien Lecoeur 5f06c6a1aa VTOL: add parameter to prevent flight if roll direction was not checked
Mark V19_VT_ROLLDIR @category system

Throttle down mavlink critical msg

Send 0 actuator_output for safety

VTOL: unset v1.9 roll direction safety check param for builtin airframes
2019-03-15 00:48:23 -04:00
Julien Lecoeur e28f8a7f2e VTOL mixers: invert FW roll sign in builtin mixers
This inversion matches the fixed sign in the commands generated
by the VTOL attitude controller.
This commit, combined with the previous commit, should have no effect.
For safety, it is recommended to check the direction of roll control
surfaces before flight.
2019-03-15 00:48:23 -04:00
Martina Rivizzigno 09b795161e Obstacle Avoidance testing in CI (#10780) 2019-03-15 00:37:23 -04:00
Beat Küng 6c3e79f361 mc airframes: reduce I gains a bit
A side-effect of the previous commit is that the integral is loaded up
during a flip, which leads to visible bounce-backs after a flip.
Reducing the I helps, but there's a trade-off and we'll need a better
solution.
2019-03-01 07:42:18 +01:00
Hamish Willee 5132368378 Flying Wing init files: Fix up main output docs 2019-02-25 12:01:27 +01:00
Hamish Willee e5dbd39ca6 Fx79 Frame: Reverse aileron outputs 2019-02-25 12:01:27 +01:00
DanielePettenuzzo 24f77ec5a4 rcS: start camera_capture later in script 2019-02-10 18:07:44 -05:00
DanielePettenuzzo 6b65eb2225 camera feedback: remove CAM_FBACK_MODE param. CAM_CAP_FBACK from camera capture driver will be used instead. 2019-02-10 18:07:44 -05:00
DanielePettenuzzo d49752141d rename camera capture feedback param and move it from camera_feedback module to camera capture driver 2019-02-10 18:07:44 -05:00
DanielePettenuzzo 42afc88285 add camera trigger feedback (input capture when camera actually takes the photo) 2019-02-10 18:07:44 -05:00
bresch faa8b6fe6d Camera Capture - enable capture at startup 2019-02-10 18:07:44 -05:00
Mohammed Kabir 94bb02a9c7 Add camera_capture driver 2019-02-10 18:07:44 -05:00
Daniel Agar 2d922b5cb4
FW airframe defaults relax EKF2 GPS checks 2019-02-04 11:02:38 -05:00
Beat Küng aa020eb28e airframes: add Holybro QAV250 2019-02-04 09:31:02 -05:00
Julien Lecoeur fe83378db4 Tiltrotor: Do not lock elevons in multirotor mode
The behaviour is unchanged because VT_ELEV_MC_LOCK was not implemented for tiltrotors
2019-02-03 22:33:42 -05:00
Julien Lecoeur 6c1d85716c Convergence: Do not lock elevons in multirotor mode
The behaviour is unchanged because VT_ELEV_MC_LOCK was not implemented for tiltrotors
2019-02-03 22:33:42 -05:00
Julien Lecoeur 15f9b70431 Claire: Do not lock elevons in multirotor mode
The behaviour is unchanged because VT_ELEV_MC_LOCK was not implemented for tiltrotors
2019-02-03 22:33:42 -05:00
Julien Lecoeur 9b5dd1596f FireFly6: Do not lock elevons in multirotor mode
The behaviour is unchanged because VT_ELEV_MC_LOCK was not implemented for tiltrotors
2019-02-03 22:33:42 -05:00
Anthony Lamping 77ea5249a1 startup: add plane_cam 2019-02-03 22:32:24 -05:00
Daniel Agar 115c31451c SITL use EKF2_MAG_TYPE default value 2019-01-31 09:23:12 -05:00
Daniel Agar 8dc0509989 mpu9250: split icm20948 support out into new separate driver 2019-01-30 09:29:08 +01:00
Daniel Agar 489ea68b8d ROMFS fix pruned dependency and cleanup 2019-01-29 15:34:36 -05:00
David Sidrane 78619514b7 ROMFS/CMakeLists build gencromfs 2019-01-25 06:32:37 -08:00
David Sidrane 5036a09e22 Add support from cromfs generation 2019-01-25 06:32:37 -08:00
Daniel Agar 1ded189f58 ROMFS rcS execute (optional) rc.board_defaults after AUTOCNF set 2019-01-18 11:23:01 -05:00
Daniel Agar fef65bf5c8 ROMFS split rc.board into defaults, sensors, and extras 2019-01-15 23:52:46 -08:00
Claudio Micheli d1da46ef46 Added generic UART configuration.
Signed-off-by: Claudio Micheli <claudio@auterion.com>
2019-01-15 09:17:24 +01:00
Claudio Micheli 7124cbf3af Fixed CI broken build. Made TELEM2 default port.
Device port can be set via SENS_EN_CM8JL65 parameter:
SENS_EN_CM8JL65 = 0 -> Disabled
SENS_EN_CM8JL65 = 1 -> Enabled on TELEM2
SENS_EN_CM8JL65 = 2 -> Enabled on TELEM1

Signed-off-by: Claudio Micheli <claudio@auterion.com>
2019-01-15 09:17:24 +01:00
Claudio Micheli e4381bfc87 Added sensor enable/disable parameter (SENS_EN_CM8JL65).
Disabled by default.

Signed-off-by: Claudio Micheli <claudio@auterion.com>
2019-01-15 09:17:24 +01:00
bresch 766f911005 beta75 - Reduce MC_YAWRATE_P to avoid oscillations when battery is fully charged 2019-01-14 18:38:31 +01:00
bresch 118848d261 beta75 - Adjust PWM_MIN and set number of cells 2019-01-14 18:38:31 +01:00
Jake Dahl 1699c577c3 Fixed an issue with a local variable that should have been a member variable. Increased the P term to reduce rise time. Removed feedforward as it was not neccessary. Removed some custom commands that didn't serve much of a purpose. 2019-01-08 22:36:09 +01:00
Daniel Agar 1b8c2c82d5
px4flow start in rc.sensors instead of per board (#11123)
- fixes #11009
2019-01-01 11:39:40 -05:00
Daniel Agar 1f9b833342 ROMFS 4041 change nsh shebang to /bin/sh 2018-12-24 19:27:04 +00:00
Beat Küng 2790cace4f beta75X aiframe: exclude on most boards (only used on Omnibus) 2018-12-23 15:49:37 -05:00
Beat Küng 9f642c7ea7 airframes: add a config for the BetaFPV Beta75X 2S Brushless Whoop 2018-12-23 15:49:37 -05:00
Matthias Grob 95b472277c TBS Caipirinha: Prevent ESC beeping all the time
Setting PWM_DISARMED to 0 results in no PWM output to the ESC for the pusher motor.
Most ESCs start beeping endless in short intervals if they don't get a signal.
I remove changing this parameter which is 900 by default to always command the motor to stand still.
2018-12-23 12:21:30 +01:00
Julian Oes 73578a593f simulator: bring -t argument back
The -t argument had been deleted because I didn't realize that it was
actually being used. Therefore, this brings it back and we now use -c
for TCP.
2018-12-22 10:32:18 +01:00
Julian Oes b436f3dd56 ROMFS/Tools: switch to TCP connection for SITL
This switches from UDP to TCP to connect to jMAVSim.
2018-12-22 10:32:18 +01:00
Nuno Marques cfd1be584e Feature: VIO: add ODOMETRY stream (#11084)
* mavlink_messages: remove LOCAL_POSITION_NED_COV stream

* mavlink_messages.cpp: add ODOMETRY stream

* add MAV_ODOM_LP parameter to activate odometry loopback

* EKF2: add vehicle_odometry publisher

* Replace VISION_POSITION_ESTIMATE loopback with ODOMETRY

* LPE: add vehicle_odometry publisher

* set vehicle_odometry local_frame field

* mavlink_messages.cpp: ODOMETRY frame_id depends on MAV_ODOM_LP
2018-12-21 12:54:04 -05:00
Julian Oes 35f2c39f30 ROMFS: remove leftover CMakeLists.txt files
These files are copied by accident and then discovered by shellcheck.
2018-12-19 07:36:43 +00:00
Julian Oes 63ee101c51 rcS: fix exit value
Shellcheck complained about returning -1 because that's essentially 255.
2018-12-19 07:36:43 +00:00
Julian Oes 3ebf030a02 ROMFS: change shebang from #!zsh to #!/bin/sh
This was required for shellsheck.
2018-12-19 07:36:43 +00:00
Julian Oes d265aaab41 ROMFS: don't forget to prune rc.board
The startup file rc.board is copied to the build/../genromfs folder
after the pruning of the files happened. Thus, about 2000 bytes of
comments and whitespace were included in the ROMFS.

This commit moves pruning of the files in ROMFS to a separate cmake
custom command which happens after the ROMFS files have been copied and
the extra files have been added.

Testing showed that this change only affected the rc.board file as
expected.
2018-12-19 07:36:43 +00:00
Beat Küng 6a5108269e rcS tone_alarm: fix CBRK_BUZZER
tone_alarm was started before the parameters were loaded, and the first
tune was played before that as well. CBRK_BUZZER was then read as default,
ignoring the user-configured value.

We now start tone_alarm after we load the parameters. Note that a
previously published startup tone or SD card error will still be played.
2018-12-15 10:01:02 -05:00
David Sidrane 11f9925b02 rcS,rc.serial.jinja:ensure proper unset hygiene
Delete auto generated vars, and others that were missed.
2018-12-12 15:14:11 -05:00
Beat Küng dc49e259b3 logger: add separate profile for vision/avoidance
Keeps things more modular.
2018-12-07 11:51:59 +01:00
dakejahl 311c0941c9 Teal One airframe improvements for full support (#10860)
* added a parameter for enabled the smart battery
* start tel1 and tel2 at 921600 and max rate
* turned up the max tx rate on mavlink streams for telem1 and telem2
* turned off mavlink stream for tel1 in 4250_teal. This is connected to TX1 FTDI UART and has issues.
* moved check to 4250 board ID to start mpu9250s for Teal airframe into fmuv4 rc.board.
2018-12-05 09:49:58 -05:00
Daniel Agar 3a036021ba ROMFS defaults drop floating point decimal 2018-12-04 22:57:53 -05:00
Daniel Agar ecbf6ea77b ROMFS multicopter airframes don't call other airframes (4001/4002)
- fixes #10980
2018-12-04 22:57:53 -05:00
flochir ab9e9793a0 ICM20948 integration into MPU9250 driver (#10116)
* Integrated preliminary ICM20948 support into MPU9250 driver.
Fixed temperature conversion for MPU9250/ICM20948.
* Included missing check for PX4_I2C_OBDEV_MPU9250 in main.cpp.
* Added explicit bus for internal MPU9250 on Pixhawk 2.1 to avoid implicit start
of an externally attached device with wrong orientation.
2018-12-04 22:15:02 -05:00
Daniel Agar d4e06e517a delete drv_gpio.h, modules/gpio_led, and fmu GPIO ioctls 2018-12-03 16:30:39 +01:00
Daniel Agar 38c84e6e9d rc.autostart restart shellcheck fix (161cf7) and exclude check
- fixes #10972
2018-12-03 15:11:45 +01:00
Daniel Agar 161cf7f5d9 shellcheck fix rc.autostart return and improve globbing 2018-12-01 10:03:19 -05:00
Daniel Agar 3e9e5ed372 ROMFS move airframes to subdirectory 2018-12-01 10:03:19 -05:00
Daniel Agar 7f0d2f23b7 move atmel_same70xplained init to rc.board 2018-12-01 10:03:19 -05:00
Daniel Agar 4240abad73 move bitcraze_crazyflie init to rc.board 2018-12-01 10:03:19 -05:00
Daniel Agar 0e980c1f83 move gumstix_aerocore2 init to rc.board 2018-12-01 10:03:19 -05:00
Daniel Agar a3fed608a6 move airmind_mindpx-v2 init to rc.board 2018-12-01 10:03:19 -05:00
Daniel Agar c9a2033c5b move auav_x21-v1 init to rc.board 2018-12-01 10:03:19 -05:00
Daniel Agar a8b91c7ac9 move intel_aerofc-v1 init to rc.board 2018-12-01 10:03:19 -05:00
Daniel Agar a4830f8d7b move omnibus_f4sd init to rc.board 2018-12-01 10:03:19 -05:00
Daniel Agar 60ade5d82b move av_x1-v1 init to rc.board 2018-12-01 10:03:19 -05:00
Daniel Agar aab08ad6fc move nxp_fmuk66-v3 init to rc.board 2018-12-01 10:03:19 -05:00
Daniel Agar c6a502f150 move fmu-v2/v3 init to rc.board 2018-12-01 10:03:19 -05:00
Daniel Agar 6c2436c2ca move fmu-v4pro init to rc.board 2018-12-01 10:03:19 -05:00
Daniel Agar d940f500f6 move fmu-v4 init to rc.board 2018-12-01 10:03:19 -05:00
Daniel Agar 25799c6e75 create board specific init script and use with fmu-v5 2018-12-01 10:03:19 -05:00
David Sidrane 729d1c32d3 Rename nxphlite-v3 to NXP fmuk66-v3 (#10927) 2018-11-28 12:13:21 -05:00
Daniel Agar ba6b71e619 px4fmu-v4 start ist8310 mag (optional external) 2018-11-27 09:29:48 -05:00
David Sidrane cadda8c263 px4fmu_test:rcS use correct name for px4io bin 2018-11-26 14:40:14 -08:00
Daniel Agar abb3817d31 boards new split VENDOR_MODEL naming convention 2018-11-26 14:40:14 -08:00
Daniel Agar f692ad04d0 boards organization 2018-11-26 14:40:14 -08:00
CUAVcaijie eb8a3de987 add rgbled_ncp5623c driver (#10889)
Co-Authored-By: CUAVcaijie <caijie@cuav.net>
2018-11-25 13:40:51 -05:00
TSC21 e3af000fdb init.d-posix: make 1013_iris_vision independent of 1010_iris_opt_flow 2018-11-21 12:21:16 +01:00
TSC21 dcdddacdb2 init.d-posix: vision: set the appropriate parameters 2018-11-21 12:21:16 +01:00
Daniel Agar 8566b6b53e AV-X increase logger buffer 2018-11-21 09:13:40 +01:00
Eric Babyak 560a9b45ed Fix for initializing Landing Target Estimator in SITL 2018-11-20 18:16:45 +01:00
David Sidrane 8d15da379b nxphlite-v3:Add HolyBro GPS on I2C 2 using ist8310 2018-11-09 15:04:51 -05:00
bresch 4f668c0c2d SITL - update default velocity PID gains 2018-11-06 22:17:00 +01:00
Daniel Agar 5d3d120705 delete unused IOCTL ACCELIOCSRANGE 2018-11-06 07:43:43 +08:00
Daniel Agar cf4b19d153 delete unused FMU_pass mixer 2018-10-30 09:18:39 -04:00
Daniele Pettenuzzo d2e2b5e8ce add pmw3901 optical flow support for fmu-v5 (#10750) 2018-10-24 10:25:41 -04:00
Daniel Agar d832b4fe28 rc.mavlink AV-X reduce companion baudrate 2018-10-23 08:15:11 +02:00
dakejahl dce4d75f5a TealOne airframe config file (#10713) 2018-10-19 20:27:50 -04:00
Daniel Agar 0c698baca7 AV-X mavlink network and companion defaults
- start mavlink on network by default (port 14570)
 - start mavlink for TX2 companion by default
2018-10-17 00:22:53 -04:00