px4-firmware/msg
Matthias Grob d0f1a551e9 manual_contol_setpoint: fix mode slot numbering (#12578)
* This fix is necessary because usually uORB structs get initialized with
all zeros and then get filled with the fields that are actually in use.
 * The number 0 for the mode slot was already commanding to switch to the
mode in slot one even though for example the joystick input via mavlink
does not use this mechanism at all.
2019-08-01 12:27:58 -04:00
..
templates urtps templates: minor cleanup 2019-07-26 15:05:54 +02:00
tools listener print strings 2019-07-30 10:47:10 -04:00
CMakeLists.txt rename empy templates (*.template) to proper file extension (.em) 2019-06-10 10:42:00 -07:00
actuator_armed.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
actuator_controls.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
actuator_direct.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
actuator_outputs.msg beautify some identation 2018-08-09 13:40:48 +02:00
adc_report.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
airspeed.msg beautify some identation 2018-08-09 13:40:48 +02:00
battery_status.msg batt_smbus rework 2018-11-01 10:49:26 -04:00
camera_capture.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
camera_trigger.msg camera_capture: change topic namings to make logging, mavlink streaming and geotagging easier 2019-02-10 18:07:44 -05:00
collision_constraints.msg publish a minimal message for logging/debugging 2019-06-04 16:47:33 +02: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 msg: add orbit main and navigation state 2018-12-08 22:34:57 +01: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 CollisionPrevention: address https://github.com/PX4/Firmware/pull/12179 2019-07-15 10:58:00 +02:00
ekf2_innovations.msg beautify some identation 2018-08-09 13:40:48 +02:00
ekf2_timestamps.msg ekf2: add vehicle_odometry usage and data validation check; update replay as well 2018-09-18 09:52:33 +02:00
ekf_gps_drift.msg msg: Create message for GPS drift rates 2018-08-17 10:44:07 +10:00
ekf_gps_position.msg msg: Add heading data to GPS blending output log data 2018-10-17 09:48:38 -04:00
esc_report.msg beautify some identation 2018-08-09 13:40:48 +02:00
esc_status.msg beautify some identation 2018-08-09 13:40:48 +02:00
estimator_status.msg msg: add gps_yaw and mag_aligned to estimator_status 2019-02-05 19:31:30 -05:00
follow_target.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
geofence_result.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
gps_dump.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
gps_inject_data.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
home_position.msg beautify some identation 2018-08-09 13:40:48 +02:00
input_rc.msg Fixing some typos 2019-01-25 11:58:17 -05: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 add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
log_message.msg listener print strings 2019-07-30 10:47:10 -04:00
manual_control_setpoint.msg manual_contol_setpoint: fix mode slot numbering (#12578) 2019-08-01 12:27:58 -04:00
mavlink_log.msg listener print strings 2019-07-30 10:47:10 -04: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
multirotor_motor_limits.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
obstacle_distance.msg add uORB message obstacle_distance_fused with data from offboard 2019-07-15 10:58:00 +02:00
offboard_control_mode.msg mc_att_ctrl: added yawrate control from offboard. 2019-06-04 08:26:09 +02:00
optical_flow.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
orbit_status.msg orbit_status: fix type for radius 2018-12-18 14:40:07 +01:00
parameter_update.msg beautify some identation 2018-08-09 13:40:48 +02: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 rename position_controller_status field from altitude_acceptance_radius 2018-09-24 11:23:01 +02:00
position_setpoint.msg removed unnecessary new-lines 2019-01-25 11:58:17 -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
pwm_input.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
qshell_req.msg listener print strings 2019-07-30 10:47:10 -04:00
qshell_retval.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02: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 add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
rc_channels.msg added aux6 RC channel 2019-04-03 08:20:47 -04:00
rc_parameter_map.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
safety.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
satellite_info.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
sensor_accel.msg beautify some identation 2018-08-09 13:40:48 +02:00
sensor_baro.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
sensor_bias.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
sensor_combined.msg beautify some identation 2018-08-09 13:40:48 +02:00
sensor_correction.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
sensor_gyro.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
sensor_mag.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
sensor_preflight.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
sensor_selection.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
servorail_status.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
subsystem_info.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
system_power.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
task_stack_info.msg task_stack_info increase task_name length to match NuttX CONFIG_TASK_NAME_SIZE 2019-07-30 10:47:10 -04:00
tecs_status.msg tecs msg: changed flight_path_angle to height rate as clearly we are 2018-09-17 10:27:08 -04:00
telemetry_status.msg telemetry_status: Changed "type" comment. 2019-03-12 11:24:33 +01:00
test_motor.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
timesync_status.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
trajectory_waypoint.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
transponder_report.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
tune_control.msg tune_control: use orb queue advertisement consistently 2019-07-25 10:38:57 -04:00
uavcan_parameter_request.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +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 beautify some identation 2018-08-09 13:40:48 +02:00
ulog_stream_ack.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
vehicle_air_data.msg beautify some identation 2018-08-09 13:40:48 +02:00
vehicle_attitude.msg beautify some identation 2018-08-09 13:40:48 +02:00
vehicle_attitude_setpoint.msg remove the landing gear from the attitude setpoint 2018-12-10 16:17:23 +01:00
vehicle_command.msg beautify some identation 2018-08-09 13:40:48 +02:00
vehicle_command_ack.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
vehicle_constraints.msg mc_pos_control/FlightTasks: trigger takeoff based on task 2019-05-22 22:05:38 +02:00
vehicle_control_mode.msg MAVLink/Commander: @Pedro-Roque's offboard yawrate handling 2019-06-04 08:26:09 +02:00
vehicle_global_position.msg EKF: Estimate WGS84 altitude with filtered AMSL offset 2018-11-22 16:55:30 +01:00
vehicle_gps_position.msg msg: Add antenna array heading offset to GPS message 2018-10-17 09:48:38 -04:00
vehicle_land_detected.msg added ground effect reporting to land detector 2019-03-21 10:07:12 +01:00
vehicle_local_position.msg purge vehicle_vision_position alias 2018-09-18 09:52:33 +02:00
vehicle_local_position_setpoint.msg Auto traj - Add Trajectory logging 2018-11-06 22:17:00 +01:00
vehicle_magnetometer.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
vehicle_odometry.msg add a local frame of reference field to vehicle_odometry 2018-09-18 09:52:33 +02: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 Changed constant name to UNMANNED_GROUND_VEHICLE 2019-06-13 10:04:26 +02:00
vehicle_status_flags.msg Commander: Improved logic for OA prearm checks. 2019-03-27 09:56:32 +01:00
vehicle_trajectory_waypoint.msg TRAJECTORY message renamed 2018-11-13 12:13:01 -05:00
vtol_vehicle_status.msg beautify some identation 2018-08-09 13:40:48 +02:00
wind_estimate.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00