px4-firmware/msg
Mark Whitehorn f24b199775 add HIL_STATE message handler and publish to uORB
add missing break

uorb topics generator: add multi-topics to the list of all topics

topic names with '# TOPICS <name>' were previously not in orb_get_topics().
This means the logger could not find them.

Affects for example actuator_controls_0.

px_generate_uorb_topic_files.py: add multitopics to generate_topics_list_file_from_files method

switch simulated attitude to new topic: vehicle_attitude_groundtruth

logger: add input_rc topic. needed for web plotting

input_rc.msg: remove timestamp_publication, use timestamp instead

mixer.cpp: warnx -> PX4_ERR

logger: initialize timer_call to 0 (hrt_call_every reads some fields)

position_setpoint_triplet topic: set the timestamp when publishing

px_generate_uorb_topic_files.py: add multitopics to generate_topics_list_file_from_files method

add vehicle_attitude_groundtruth to default topics

change to hil_state_quaternion
2016-09-19 13:05:14 +02:00
..
ros uorb autogeneration 2016-05-14 11:27:07 +02:00
templates uorb topics generator: add multi-topics to the list of all topics 2016-09-19 13:03:40 +02:00
CMakeLists.txt vmount: add mount and ROI implementation 2016-09-06 11:33:18 +02:00
actuator_armed.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
actuator_controls.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
actuator_direct.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
actuator_outputs.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
adc_report.msg adc_report remove timestamp 2016-05-14 11:27:07 +02:00
airspeed.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
att_pos_mocap.msg Mocap timestamp cleanup (#5021) 2016-07-11 12:46:29 +02:00
battery_status.msg Battery status: Add valid flag 2016-05-15 15:37:46 +02:00
camera_trigger.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
commander_state.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
control_state.msg added airspeed mode enum to control state topic 2016-06-23 09:08:35 +02:00
cpuload.msg Include memory in CPU load message 2016-08-15 14:53:26 +02:00
debug_key_value.msg Move debug_key_value to generated topics 2015-05-27 15:21:31 -07:00
differential_pressure.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
distance_sensor.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
ekf2_innovations.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
ekf2_replay.msg sensor_combined: replace accel & gyro integral with value, use float for dt 2016-07-07 11:35:50 +02:00
esc_report.msg Move esc_status to generated topics 2015-05-27 15:21:31 -07:00
esc_status.msg Add TAP to vendor list 2016-06-24 00:08:24 +02:00
estimator_status.msg Publishes LPE GPS epv and eph as estimator status. (#5413) 2016-09-03 22:00:51 +02:00
fence.msg Move fence to generated topics 2015-05-27 15:21:31 -07:00
fence_vertex.msg Move fence to generated topics 2015-05-27 15:21:31 -07:00
filtered_bottom_flow.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
follow_target.msg adding lpf based on confidence of linear movement 2016-05-16 15:12:50 -07:00
fw_pos_ctrl_status.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
fw_virtual_attitude_setpoint.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
fw_virtual_rates_setpoint.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
geofence_result.msg geofence violation actions 2015-10-27 09:28:30 +01:00
gps_dump.msg gps file dump: re-implement with an uORB topic & write to the log file (#4987) 2016-07-06 09:32:37 +02:00
gps_inject_data.msg RTCM: use MAVLINK_MSG_ID_GPS_RTCM_DATA mavlink message (supports fragmentation) 2016-06-02 09:26:03 +02:00
hil_sensor.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
home_position.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
input_rc.msg input_rc.msg: remove timestamp_publication, use timestamp instead 2016-09-19 13:02:31 +02:00
log_message.msg logging: publish a message for PX4_{WARN,ERR} & store them to the ulog file 2016-08-24 21:24:35 +02:00
manual_control_setpoint.msg added transition switch 2016-07-29 13:28:09 +02:00
mavlink_log.msg logger: subscribe to mavlink_log messages and write them to the log 2016-06-02 07:32:49 +02:00
mc_att_ctrl_status.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
mc_virtual_attitude_setpoint.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
mc_virtual_rates_setpoint.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
mission.msg orb macros: cleanup some unused code (#4576) 2016-05-19 11:08:37 +02:00
mission_result.msg transition alignment will force heading now and go to RTL if it cannot reach it in time, handle mission failure correctly, reset after mission update, issue message with actual problem 2016-02-15 23:29:38 +01:00
multirotor_motor_limits.msg Converted multirotor motor limits to generated topic 2015-08-10 15:34:08 +02:00
offboard_control_mode.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
optical_flow.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
output_pwm.msg PWM out driver: Move to generated uORB topic 2015-08-20 10:46:59 +02:00
parameter_update.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
position_setpoint.msg Implement MAV_CMD_DO_CHANGE_SPEED throttle 2016-06-23 09:08:35 +02:00
position_setpoint_triplet.msg port more uorb headers to msg 2015-01-28 16:31:19 +01:00
pwm_input.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
qshell_req.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
rc_channels.msg added transition switch 2016-07-29 13:28:09 +02:00
rc_parameter_map.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
safety.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
satellite_info.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
sensor_accel.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
sensor_baro.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
sensor_combined.msg sensor_combined: replace accel & gyro integral with value, use float for dt 2016-07-07 11:35:50 +02:00
sensor_gyro.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
sensor_mag.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
servorail_status.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
subsystem_info.msg uORB: Moved subsystem_info to generated topics 2015-05-27 15:21:32 -07:00
system_power.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
tecs_status.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
telemetry_status.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
test_motor.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
time_offset.msg uORB: Moved time_offset topic to generated topics 2015-05-27 15:21:33 -07:00
transponder_report.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
uavcan_parameter_request.msg Added MAVLink/UAVCAN parameter bridge; implemented UAVCAN ESC enumeration 2015-10-13 21:50:23 +11:00
uavcan_parameter_value.msg Added MAVLink/UAVCAN parameter bridge; implemented UAVCAN ESC enumeration 2015-10-13 21:50:23 +11:00
vehicle_attitude.msg add HIL_STATE message handler and publish to uORB 2016-09-19 13:05:14 +02:00
vehicle_attitude_setpoint.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
vehicle_command.msg vehicle_command topic: use uorb queuing with length 3 2016-09-07 18:47:12 +02:00
vehicle_command_ack.msg vehicle_command topic: use uorb queuing with length 3 2016-09-07 18:47:12 +02:00
vehicle_control_mode.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
vehicle_force_setpoint.msg enable force setpoint message for multiplatform 2015-02-28 18:25:35 +01:00
vehicle_global_position.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
vehicle_global_velocity_setpoint.msg port more uorb headers to msg 2015-01-28 16:31:19 +01:00
vehicle_gps_position.msg gps_position: convert uint64 timestamp_time -> int32 timestamp_time_relative 2016-06-24 00:22:01 +02:00
vehicle_land_detected.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
vehicle_local_position.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
vehicle_local_position_setpoint.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
vehicle_rates_setpoint.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
vehicle_roi.msg vmount: add mount and ROI implementation 2016-09-06 11:33:18 +02:00
vehicle_status.msg added which transition the vtol is in to vehicle status 2016-09-13 14:32:00 +02:00
vision_position_estimate.msg Vision msg: Cleanup timestamp 2016-07-10 12:42:56 +02:00
vtol_vehicle_status.msg added which transition the vtol is in to vehicle status 2016-09-13 14:32:00 +02:00
wind_estimate.msg uorb autogeneration 2016-05-14 11:27:07 +02:00