..
templates
microRTPS: use FastRTPSGen '-typeros2' option to generate the typenaming required to interface the bridge with ROS2 topics
2020-04-02 14:28:38 +01:00
tools
remove exception in case that ROS is not installed
2020-04-04 08:20:35 +01:00
CMakeLists.txt
Update ecl to add ability to recover from bad magnetic yaw
2020-03-15 12:57:25 -04: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
allow DO_CONTROL_VIDEO in missions
2020-03-30 17:10:36 +02:00
actuator_outputs.msg
beautify some identation
2018-08-09 13:40:48 +02: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
Airspeed Selector: enable airspeed_validated in control modules ( #12887 )
2019-11-21 14:14:25 -05:00
battery_status.msg
battery: check source param inside battery lib
2020-04-06 15:56:54 +02: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
cellular_status.msg
mavlink: handle cellular_status messages for logging
2019-11-13 09:19:02 -05: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
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 add more distance_sensor orientations
2019-10-01 21:05:37 -04:00
ekf2_timestamps.msg
replay: remove GPS relative timestamps
2020-02-07 08:19:22 +01: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
msg: extend field definition in msg/esc_report (arming & failure states)
2020-04-03 09:16:43 +02:00
esc_status.msg
msg: extend field definition in msg/esc_report (arming & failure states)
2020-04-03 09:16:43 +02:00
estimator_innovations.msg
ECL: Clean velPos logging, deprecate ekf2_innovations msg
2019-12-05 11:29:29 +01:00
estimator_sensor_bias.msg
msg: rename sensor_bias -> estimator_sensor_bias
2020-01-27 09:03:27 +01:00
estimator_status.msg
ECL: Clean velPos logging, deprecate ekf2_innovations msg
2019-12-05 11:29:29 +01: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
introduce uORB::PublicationQueued and transition most orb_advertise_queue usage
2019-08-04 10:08:09 -04:00
gps_inject_data.msg
introduce uORB::PublicationQueued and transition most orb_advertise_queue usage
2019-08-04 10:08:09 -04:00
home_position.msg
beautify some identation
2018-08-09 13:40:48 +02:00
hover_thrust_estimate.msg
HoverThrustEstimator: add a new single state estimator
2020-02-07 11:52:52 +01: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
introduce uORB::PublicationQueued and transition most orb_advertise_queue usage
2019-08-04 10:08:09 -04:00
log_message.msg
listener print strings
2019-07-30 10:47:10 -04:00
logger_status.msg
logger: publish initial logger_status orb message
2020-01-29 17:29:30 -05:00
manual_control_setpoint.msg
manual_contol_setpoint: fix mode slot numbering ( #12578 )
2019-08-01 12:27:58 -04:00
mavlink_log.msg
Implemented multipart status message
2020-03-31 09:23:52 +02: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
Collision Prevention: support multiple sensors and frames ( #12883 )
2019-09-06 08:38:56 +02:00
offboard_control_mode.msg
mc_att_ctrl: added yawrate control from offboard.
2019-06-04 08:26:09 +02:00
onboard_computer_status.msg
Add units on message comments
2019-10-27 11:47:10 +00:00
optical_flow.msg
first push on supporting ROS2 Dashing and IDL 4.2
2019-10-04 16:56:03 +01: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
uORB: add bitset for faster orb_exists check and remove uORB::Subscription lazy subscribe hack/optimization
2020-03-11 09:06:33 -04: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
Navigator: make weather vane work in all auto modes, not just mission ( #13761 )
2019-12-28 12:13:15 -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
PWM automatic trigger system (ATS) for parachutes ( #13726 )
2020-01-06 20:14:06 -05:00
qshell_req.msg
qshell: rename qshell sequence fields so they can be parsed on fastrtpsgen
2019-09-04 17:04:28 +01:00
qshell_retval.msg
qshell: rename qshell sequence fields so they can be parsed on fastrtpsgen
2019-09-04 17:04:28 +01: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
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
rpm.msg
Remove duplicite data from RPM message and enable logging of RPM message
2020-03-30 13:08:53 -04: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
sensors: move accel filtering to sensors/vehicle_acceleration
2020-01-29 16:13:38 -05:00
sensor_accel_fifo.msg
sensor_accel_fifo increase to 32 samples
2020-03-31 13:26:50 -04:00
sensor_accel_integrated.msg
create temperature_compensation module
2020-01-20 21:42:42 -05:00
sensor_accel_status.msg
invensense icm20602 improvements
2020-02-18 19:21:20 -05:00
sensor_baro.msg
add timestamp field to uORB msgs; sync timestamp whenever possible
2018-08-09 13:40:48 +02:00
sensor_combined.msg
first push on supporting ROS2 Dashing and IDL 4.2
2019-10-04 16:56:03 +01:00
sensor_correction.msg
create temperature_compensation module
2020-01-20 21:42:42 -05:00
sensor_gyro.msg
sensors: move accel filtering to sensors/vehicle_acceleration
2020-01-29 16:13:38 -05:00
sensor_gyro_fifo.msg
invensense icm20602 improvements
2020-02-18 19:21:20 -05:00
sensor_gyro_integrated.msg
create temperature_compensation module
2020-01-20 21:42:42 -05:00
sensor_gyro_status.msg
invensense icm20602 improvements
2020-02-18 19:21:20 -05: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
Improve magnetometer inconsistency check
2019-08-07 18:44:39 +02:00
sensor_selection.msg
sensors: move baro aggregation to new sensors/vehicle_air_data
2020-03-12 19:06:34 -04: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
Commander: Add reporting of preflight and prearming state
2020-03-17 00:17:11 +01: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
load_mon: update orb_publish to uORB::Publication<>
2019-09-02 20:41:34 -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
Mavlink: Add MAV_x_RADIO_CTL parameter to disable RADIO_STATUS flow control
2020-02-03 09:49:47 -05:00
test_motor.msg
commander: add support for DO_MOTOR_TEST
2019-10-24 09:27:29 +02:00
timesync.msg
mavlink: timesync: readd timesync_status uORB to report Mavlink timesync
2020-03-10 12:15:18 +00:00
timesync_status.msg
mavlink: timesync: readd timesync_status uORB to report Mavlink timesync
2020-03-10 12:15:18 +00: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
ADSB traffic avoidance improvements using UTM_GLOBAL_POSITION ( #13159 )
2020-01-17 14:58:28 -05:00
tune_control.msg
tune_control: use orb queue advertisement consistently
2019-07-25 10:38:57 -04:00
uavcan_parameter_request.msg
drivers/uavcan: remove MAVLINK header dependency
2019-12-31 21:01:21 -05: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
ulog stream msgs: rename 'sequence' fields as they are protected names in fastrtpsgen
2019-10-14 16:37:17 +01: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
sensors: create vehicle_acceleration module ( #12597 )
2019-08-07 05:05:48 -04:00
vehicle_air_data.msg
sensors: move baro aggregation to new sensors/vehicle_air_data
2020-03-12 19:06:34 -04:00
vehicle_angular_acceleration.msg
sensors: compute and publish vehicle_angular_acceleration
2020-01-27 16:44:01 -05:00
vehicle_angular_velocity.msg
sensors: compute and publish vehicle_angular_acceleration
2020-01-27 16:44:01 -05:00
vehicle_attitude.msg
Fixing and simplifying mavlink odometry handling ( #12793 )
2019-08-30 06:33:13 -07: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
Mavlink: Implemented SET_CAMERA_ZOOM
2020-03-30 17:10:36 +02:00
vehicle_command_ack.msg
introduce uORB::PublicationQueued and transition most orb_advertise_queue usage
2019-08-04 10:08:09 -04: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
vehicle_control_mode: fix invalid comment for flag_armed
2020-01-24 08:42:16 +01:00
vehicle_global_position.msg
vehicle_global_position: remove velocity fields (duplicates of local vx, vy, vz)
2020-03-11 23:57:43 -04:00
vehicle_gps_position.msg
msg: Add antenna array heading offset to GPS message
2018-10-17 09:48:38 -04:00
vehicle_imu.msg
sensors/vehicle_imu: incremental step towards multi-EKF
2020-01-22 18:04:29 -05:00
vehicle_land_detected.msg
LandDetector: switch land flags to properies instead of one state
2019-10-16 00:47:01 -04:00
vehicle_local_position.msg
vehicle_local_position: delete unused and redundant dist_bottom_rate
2020-01-18 12:50:57 -05: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
add timestamp field to uORB msgs; sync timestamp whenever possible
2018-08-09 13:40:48 +02:00
vehicle_odometry.msg
Update ECL
2020-01-09 10:36:10 +01: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
delete Outback Challenge (OBC) AUTO_RTGS (datalink loss) and AUTO_RCRECOVER (rc loss)
2020-03-11 22:45:55 -04:00
vehicle_status_flags.msg
commander: unify offboard timeouts
2020-03-04 09:35:14 +01: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
beautify some identation
2018-08-09 13:40:48 +02:00
wheel_encoders.msg
Changed wheel encoder publication to multi-instance
2019-08-05 02:45:33 -07:00
wind_estimate.msg
add timestamp field to uORB msgs; sync timestamp whenever possible
2018-08-09 13:40:48 +02:00
yaw_estimator_status.msg
Update ecl to add ability to recover from bad magnetic yaw
2020-03-15 12:57:25 -04:00