px4-firmware/msg
Daniel Agar f3e2a197ad
move vehicle at rest detection ekf2 -> land_detector
- move vehicle at reset detection ekf2 -> land_detector
 - ekf_unit: reduce init period
   - Fake fusion is when at rest is quite strong and makes the variance reduce rapidly. Reduce the amount of time we wait before checking if the variances are still large enough.
 - ekf_unit: reduce minimum vel/pos variance required after init
   - Fake pos fusion has a low observation noise, making the vel/pos variances reduce quickly.

Co-authored-by:: bresch <brescianimathieu@gmail.com>
2022-02-01 17:50:19 -05:00
..
templates microRTPS_agent_CMakeLists.txt.em: add install section 2021-12-10 09:03:08 -05:00
tools topic_listener: avoid code generation, use existing metadata at runtime 2021-10-20 08:10:05 +02:00
CMakeLists.txt Enable logging of mavlink tunnel messages 2022-01-26 11:10:43 -05:00
action_request.msg Use action_request to command RC VTOL transitions 2021-11-09 16:05:25 +01:00
actuator_armed.msg Mavlink FLIGHT_INFORMATION fix arming time (ms -> us) and add takeoff time 2020-12-16 09:38:05 -05:00
actuator_controls.msg control_allocator: remove direct mixer, add actuator_{motors,servos} instead 2021-10-18 18:45:19 -04:00
actuator_controls_status.msg mc_rate: compute control energy and publish to status msg 2021-10-02 18:12:05 -04:00
actuator_motors.msg actuator_motors.msg: add reversible flags & implement in mixer_module 2021-12-24 20:06:13 -05:00
actuator_outputs.msg beautify some identation 2018-08-09 13:40:48 +02:00
actuator_servos.msg Whitespace cleanup. 2021-10-19 13:29:26 -04:00
actuator_servos_trim.msg control_allocator: implement trim + slew rate limits configuration 2021-12-24 20:06:13 -05:00
actuator_test.msg mixer_module: add testing for SYS_CTRL_ALLOC=1 with actuator_test cmd+uorb msg 2021-11-23 12:40:22 -05:00
adc_report.msg ADC: replace ioctl with uorb message (#14087) 2020-03-20 11:23:32 +01:00
airspeed.msg beautify some identation 2018-08-09 13:40:48 +02:00
airspeed_validated.msg Commenting and formating fixes 2020-10-06 09:31:58 +02:00
airspeed_wind.msg AirspeedSelector: add _CAS_scale_validated to airspeed_wind for logging 2021-10-22 17:00:35 +02:00
autotune_attitude_control_status.msg mc atune: add multicopter attitude auto-tuner module 2021-10-02 18:12:05 -04:00
battery_status.msg msg: Add full_charge_capacity_wh 2022-01-26 13:44:48 -05:00
camera_capture.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
camera_status.msg mavlink: use dynamic camera comp id instead of hardcoded value 2021-07-31 12:41:49 -04:00
camera_trigger.msg Fix camera trigger via MAVLink when camera capture feedback is enabled 2021-12-17 07:56:08 +01:00
cellular_status.msg Update mavlink with cellular status message fixes 2020-07-09 15:12:02 -04:00
collision_constraints.msg first push on supporting ROS2 Dashing and IDL 4.2 2019-10-04 16:56:03 +01:00
collision_report.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
commander_state.msg Commander: fix mode initialization with RC 2021-11-09 16:05:25 +01:00
control_allocator_status.msg fix control_allocator_status: torque_setpoint_achieved and thrust_setpoint_achieved are bool 2021-01-18 11:25:37 -05:00
cpuload.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
debug_array.msg Add support for mavlink message DEBUG_FLOAT_ARRAY 2018-09-27 12:33:12 -04:00
debug_key_value.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
debug_value.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
debug_vect.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
differential_pressure.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
distance_sensor.msg Drivers: Distance Sensors: Add proper device IDs 2021-01-27 17:02:20 -05:00
ekf2_timestamps.msg ekf2_timestamps.msg - make first line a complete sentence 2021-08-16 08:29:44 +02:00
ekf_gps_drift.msg move vehicle at rest detection ekf2 -> land_detector 2022-02-01 17:50:19 -05:00
esc_report.msg Commander: more changes to use events with escs and battery failures 2022-01-13 08:40:34 +01:00
esc_status.msg msg: extend field definition in msg/esc_report (arming & failure states) 2020-04-03 09:16:43 +02:00
estimator_baro_bias.msg ekf2: baro bias publish minor cleanup 2021-08-02 13:59:38 -04:00
estimator_event_flags.msg commander: report GNSS yaw fault to user 2021-08-05 11:10:02 +02:00
estimator_innovations.msg estimator_innovations: remove unimplemented fake vel & pos fields 2020-11-11 20:17:52 -05:00
estimator_optical_flow_vel.msg OpticalFlow: add optical flow velocity logging 2020-10-26 14:10:25 -04:00
estimator_selector_status.msg Multi-EKF support (ekf2) 2020-10-27 10:56:11 -04:00
estimator_sensor_bias.msg save significant IMU bias changes learned by the EKF 2021-11-07 15:34:27 -05:00
estimator_states.msg estimator messages add explicit timestamp_sample 2020-09-04 10:48:26 -04:00
estimator_status.msg move vehicle at rest detection ekf2 -> land_detector 2022-02-01 17:50:19 -05:00
estimator_status_flags.msg commander: report GNSS yaw fault to user 2021-08-05 11:10:02 +02:00
event.msg events interface: chance uORB 'sequence' to 'event_sequence' 2021-07-09 13:24:13 +02:00
failure_detector_status.msg FD: use flags union instead of bitmask 2021-11-05 09:45:52 -04:00
follow_target.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
generator_status.msg mavlink: handle receiving GENERATOR_STATUS 2020-09-25 11:36:58 -04:00
geofence_result.msg Format whitespace and group checkall() methods together in geofence class. 2022-01-31 21:01:03 -05:00
gimbal_device_attitude_status.msg Support for gimbal v2 protocol 2021-02-17 13:54:34 -05:00
gimbal_device_information.msg vmount/mavlink: update gimbal information message 2021-02-17 13:54:34 -05:00
gimbal_device_set_attitude.msg Support for gimbal v2 protocol 2021-02-17 13:54:34 -05:00
gimbal_manager_information.msg vmount/mavlink: update gimbal information message 2021-02-17 13:54:34 -05:00
gimbal_manager_set_attitude.msg vmount/navigator/mavlink: gimbal v2 changes 2021-02-17 13:54:34 -05:00
gimbal_manager_set_manual_control.msg vmount/navigator/mavlink: gimbal v2 changes 2021-02-17 13:54:34 -05:00
gimbal_manager_status.msg vmount/navigator/mavlink: gimbal v2 changes 2021-02-17 13:54:34 -05:00
gps_dump.msg GPS_DUMP_COMM: dump all gps instances 2020-12-08 11:45:24 +01:00
gps_inject_data.msg UAVCAN Moving Baseline Working 2021-11-30 15:59:08 -05:00
heater_status.msg Create publish_status() method in the heater driver, add a status field to indicate if the temperature setpoint has been met within 2.5C, breakout update_params() method from the Heater::Run() method and simplify logic. 2021-04-16 08:09:51 -04:00
home_position.msg Commander: set home position in air 2020-12-07 10:24:23 -05:00
hover_thrust_estimate.msg mc_hover_thrust_estimator: validity flag and other small improvements/fixes 2020-08-03 10:30:52 -04:00
input_rc.msg px4io: moving mixing to FMU side 2021-09-25 19:15:05 -04:00
internal_combustion_engine_status.msg Add internal combustion engine status uavcan bridge and mavlink EFI_STATUS stream 2021-07-30 22:31:43 -04:00
iridiumsbd_status.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
irlock_report.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
landing_gear.msg vehicle constraints: remove landing gear 2018-12-10 16:17:23 +01:00
landing_target_innovations.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
landing_target_pose.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
led_control.msg msg:led_control Extend to support 8 LEDS 2021-01-23 09:30:59 -05:00
log_message.msg log_message increase queue depth 2->4 2021-01-09 11:04:32 -05:00
logger_status.msg logger: record message gaps 2020-07-29 13:36:22 -04:00
mag_worker_data.msg Add logging of mag calibration data (mag_worker_data) 2021-01-20 09:44:45 -05:00
magnetometer_bias_estimate.msg magnetometer allow setting initial calibration from bias if available and stable 2021-12-01 20:24:56 -05:00
manual_control_setpoint.msg Use backwards compatible manual_control_setpoint instead of manual_control_input 2021-11-09 16:05:25 +01:00
manual_control_switches.msg manual_control: enable sending camera commands 2022-01-10 23:04:10 -05:00
mavlink_log.msg mavlink: STATUSTEXT directly use mavlink_log subscription 2020-11-17 19:47:06 -05:00
mavlink_tunnel.msg Enable logging of mavlink tunnel messages 2022-01-26 11:10:43 -05:00
mission.msg beautify some identation 2018-08-09 13:40:48 +02:00
mission_result.msg beautify some identation 2018-08-09 13:40:48 +02:00
mount_orientation.msg beautify some identation 2018-08-09 13:40:48 +02:00
navigator_mission_item.msg navigator: publish navigator mission item changes for logging 2020-10-13 12:12:03 -04:00
npfg_status.msg integrate optional NPFG library for wind-aware fixed-wing guidance 2022-01-14 22:05:53 +01:00
obstacle_distance.msg Collision Prevention: support multiple sensors and frames (#12883) 2019-09-06 08:38:56 +02:00
offboard_control_mode.msg Enable offboard actuator setpoints 2021-11-07 15:38:42 -05:00
onboard_computer_status.msg Add units on message comments 2019-10-27 11:47:10 +00:00
optical_flow.msg paw3902: fixes and improvements 2021-03-16 15:52:03 -04:00
orb_test.msg uORB: add bitset for faster orb_exists check and remove uORB::Subscription lazy subscribe hack/optimization 2020-03-11 09:06:33 -04:00
orb_test_large.msg uORB: add bitset for faster orb_exists check and remove uORB::Subscription lazy subscribe hack/optimization 2020-03-11 09:06:33 -04:00
orb_test_medium.msg fix: uORB topics lost messages when publications overflow 2020-10-19 08:52:55 +02:00
orbit_status.msg Orbit: Add RC controlled yaw mode 2020-07-13 20:26:13 +02:00
parameter_update.msg parameter_update.msg: add basic status info 2021-02-12 08:27:47 -05:00
ping.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
position_controller_landing_status.msg generic position controller status/feedback message 2018-08-31 14:43:51 -04:00
position_controller_status.msg position_controller_status message: added comments regarding NAN 2021-03-31 11:23:33 +02:00
position_setpoint.msg update UUV and rover controllers to use trajectory_setpoint and cleanup unused position_setpoint fields 2021-03-09 10:36:34 -05:00
position_setpoint_triplet.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
power_button_state.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
power_monitor.msg Added TI ina226 I2C power monitor (#11755) 2019-05-17 13:33:48 -04:00
pps_capture.msg Fix PPS based UTC timestamp in camera trigger and capture messages 2021-12-17 07:56:08 +01:00
pwm_input.msg PWM automatic trigger system (ATS) for parachutes (#13726) 2020-01-06 20:14:06 -05:00
px4io_status.msg px4io: moving mixing to FMU side 2021-09-25 19:15:05 -04:00
radio_status.msg radio_status: change 'fixed' field name to 'fix' so it does not clash with 'fixed' floating-point notation on the IDL generation 2018-10-08 10:58:45 +02:00
rate_ctrl_status.msg sensors: create vehicle_angular_velocity module (#12596) 2019-08-06 12:55:25 -04:00
rc_channels.msg px4io: moving mixing to FMU side 2021-09-25 19:15:05 -04:00
rc_parameter_map.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
rpm.msg Remove duplicite data from RPM message and enable logging of RPM message 2020-03-30 13:08:53 -04:00
rtl_time_estimate.msg Compute RTL time and react if lower than flight time 2021-11-24 14:10:24 +01:00
safety.msg px4io: moving mixing to FMU side 2021-09-25 19:15:05 -04:00
satellite_info.msg Add MavlinkStreamGPSStatus status class stream via GPS_STATUS.hpp and add PRN code to satellite_info.msg. 2020-10-14 08:26:42 +02:00
sensor_accel.msg sensors/vehicle_imu: vehicle_imu_status include accel/gyro full raw FIFO sample rate 2021-02-24 08:13:53 -05:00
sensor_accel_fifo.msg rotate accel/gyro FIFO before publish and fix angular velocity filter resets 2021-03-22 12:01:12 -04:00
sensor_baro.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
sensor_combined.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
sensor_correction.msg sensor calibration: save temperature at calibration time for monitoring 2021-08-15 11:19:24 -04:00
sensor_gps.msg UAVCAN Moving Baseline Working 2021-11-30 15:59:08 -05:00
sensor_gyro.msg sensors/vehicle_imu: vehicle_imu_status include accel/gyro full raw FIFO sample rate 2021-02-24 08:13:53 -05:00
sensor_gyro_fft.msg gyro_fft: change default length 1024 -> 512 to decrease latency 2021-07-06 21:54:18 -04:00
sensor_gyro_fifo.msg rotate accel/gyro FIFO before publish and fix angular velocity filter resets 2021-03-22 12:01:12 -04:00
sensor_hygrometer.msg msg: new sensor_hygrometer msg 2021-12-27 12:13:09 -05:00
sensor_mag.msg sensors (accel/gyro/mag) determine if external with device id 2022-01-10 10:31:07 -05:00
sensor_preflight_mag.msg sensors: move mag aggregation to new VehicleMagnetometer WorkItem 2020-08-21 10:12:13 -04:00
sensor_selection.msg sensors: move mag aggregation to new VehicleMagnetometer WorkItem 2020-08-21 10:12:13 -04:00
sensors_status_imu.msg sensors: add accel/gyro current priority to sensors_status_imu 2021-07-30 21:20:01 -04:00
system_power.msg adc: add support for multiple sensor voltage channels 2021-01-15 10:57:20 -05:00
takeoff_status.msg MulticopterPositionControl: publish stricter tilt limit during takeoff 2021-04-20 18:18:21 +02:00
task_stack_info.msg load_mon: update orb_publish to uORB::Publication<> 2019-09-02 20:41:34 -04:00
tecs_status.msg log raw airspeed derivative, pitch setpoint and airspeed innovation for TECS 2021-05-31 23:56:23 +02:00
telemetry_status.msg Add optional preflight check for healthy MAVLink parachute system 2021-11-19 17:15:04 +01:00
test_motor.msg commander: add support for DO_MOTOR_TEST 2019-10-24 09:27:29 +02:00
timesync.msg timesync: remove system ID field from the timesync message 2021-08-12 08:44:53 +02:00
timesync_status.msg microRTPS: agent: publish timesync status 2021-08-12 08:44:53 +02:00
trajectory_bezier.msg Add documenation to uORB message 2020-03-09 09:51:49 +01:00
trajectory_waypoint.msg add point type (mavlink command associated with wp) in Obstacle Avoidance interface 2019-08-05 16:05:40 +02:00
transponder_report.msg fix: uORB topics lost messages when publications overflow 2020-10-19 08:52:55 +02:00
tune_control.msg tunes: add tune to power off 2022-01-10 23:04:10 -05:00
uavcan_parameter_request.msg fix: uORB topics lost messages when publications overflow 2020-10-19 08:52:55 +02:00
uavcan_parameter_value.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
ulog_stream.msg fix: uORB topics lost messages when publications overflow 2020-10-19 08:52:55 +02:00
ulog_stream_ack.msg ulog stream msgs: rename 'sequence' fields as they are protected names in fastrtpsgen 2019-10-14 16:37:17 +01:00
vehicle_acceleration.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
vehicle_air_data.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
vehicle_angular_acceleration.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
vehicle_angular_acceleration_setpoint.msg initial control allocation support 2021-01-18 11:25:37 -05:00
vehicle_angular_velocity.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
vehicle_attitude.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
vehicle_attitude_setpoint.msg vehicle_attitude_setpoint: get rid of unused q_d_valid flag 2020-02-27 09:17:52 +01:00
vehicle_command.msg manual_control: enable sending camera commands 2022-01-10 23:04:10 -05:00
vehicle_command_ack.msg ekf2 support SET_GPS_GLOBAL_ORIGIN and remove globallocalconverter usage 2021-03-05 18:25:14 -05:00
vehicle_constraints.msg vehicle_constraints: remove deprecated speed_xy constraint 2021-11-09 21:47:06 -05:00
vehicle_control_mode.msg px4io: moving mixing to FMU side 2021-09-25 19:15:05 -04:00
vehicle_global_position.msg Multi-EKF support (ekf2) 2020-10-27 10:56:11 -04:00
vehicle_gps_position.msg vehicle_gps_position: add jamming_state 2021-01-30 11:26:42 +01:00
vehicle_imu.msg save significant IMU bias changes learned by the EKF 2021-11-07 15:34:27 -05:00
vehicle_imu_status.msg sensors/vehicle_imu: use WelfordMean for online mean and variance 2021-11-09 15:19:35 +01:00
vehicle_land_detected.msg move vehicle at rest detection ekf2 -> land_detector 2022-02-01 17:50:19 -05:00
vehicle_local_position.msg small typo in vehicle_local_position msg 2021-12-17 15:45:07 +01:00
vehicle_local_position_setpoint.msg vehicle_local_position_setpoint: make acceleration and jerk arrays 2019-10-24 14:58:57 +02:00
vehicle_magnetometer.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
vehicle_odometry.msg add odometry reset counter (ekf2, mavlink, etc) 2022-01-31 09:19:36 -05:00
vehicle_rates_setpoint.msg VTOL rate control architecture improvements (#10819) 2018-11-21 20:32:40 -05:00
vehicle_roi.msg beautify some identation 2018-08-09 13:40:48 +02:00
vehicle_status.msg health-flags: Increase health flags to 64 bit bit field to support extended sys status mavlink message 2021-12-14 09:41:12 -05:00
vehicle_status_flags.msg Commander: avoid RC actions during calibration 2021-12-22 09:08:23 -05:00
vehicle_thrust_setpoint.msg initial control allocation support 2021-01-18 11:25:37 -05:00
vehicle_torque_setpoint.msg initial control allocation support 2021-01-18 11:25:37 -05:00
vehicle_trajectory_bezier.msg Add uORB messages for bezier curve trajectories 2020-03-09 09:51:49 +01:00
vehicle_trajectory_waypoint.msg TRAJECTORY message renamed 2018-11-13 12:13:01 -05:00
vtol_vehicle_status.msg update Quadchute trigger from mavlink PR 1569 2021-05-03 21:44:27 +03:00
wheel_encoders.msg Changed wheel encoder publication to multi-instance 2019-08-05 02:45:33 -07:00
wind.msg select single system-wide wind estimate message (current best) 2021-02-20 13:15:01 -05:00
yaw_estimator_status.msg estimator messages add explicit timestamp_sample 2020-09-04 10:48:26 -04:00