Skip to content

Instantly share code, notes, and snippets.

@tfoote
Created March 13, 2020 20:20
Show Gist options
  • Star 0 You must be signed in to star a gist
  • Fork 0 You must be signed in to fork a gist
  • Save tfoote/9a9525ed69c3dd79914d0f7e255a872e to your computer and use it in GitHub Desktop.
Save tfoote/9a9525ed69c3dd79914d0f7e255a872e to your computer and use it in GitHub Desktop.
Foxy Message API Review Reference Diff (Melodic -> Eloquent)
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/msg/BatteryState.msg /opt/ros/eloquent/share/sensor_msgs/msg/BatteryState.msg
--- /opt/ros/melodic/share/sensor_msgs/msg/BatteryState.msg 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/msg/BatteryState.msg 2019-10-23 15:06:18.000000000 -0700
@@ -31,8 +31,9 @@
uint8 POWER_SUPPLY_TECHNOLOGY_NICD = 5
uint8 POWER_SUPPLY_TECHNOLOGY_LIMN = 6
-Header header
+std_msgs/Header header
float32 voltage # Voltage in Volts (Mandatory)
+float32 temperature # Temperature in Degrees Celsius (If unmeasured NaN)
float32 current # Negative when discharging (A) (If unmeasured NaN)
float32 charge # Current charge in Ah (If unmeasured NaN)
float32 capacity # Capacity in Ah (last full capacity) (If unmeasured NaN)
@@ -45,5 +46,7 @@
float32[] cell_voltage # An array of individual cell voltages for each cell in the pack
# If individual voltages unknown but number of cells known set each to NaN
+float32[] cell_temperature # An array of individual cell temperatures for each cell in the pack
+ # If individual temperatures unknown but number of cells known set each to NaN
string location # The location into which the battery is inserted. (slot number or plug)
string serial_number # The best approximation of the battery serial number
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/msg/CameraInfo.msg /opt/ros/eloquent/share/sensor_msgs/msg/CameraInfo.msg
--- /opt/ros/melodic/share/sensor_msgs/msg/CameraInfo.msg 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/msg/CameraInfo.msg 2019-10-23 15:06:18.000000000 -0700
@@ -27,7 +27,7 @@
#######################################################################
# Time of image acquisition, camera coordinate frame ID
-Header header # Header timestamp should be acquisition time of image
+std_msgs/Header header # Header timestamp should be acquisition time of image
# Header frame_id should be optical frame of camera
# origin of frame should be optical center of camera
# +x should point to the right in the image
@@ -49,19 +49,19 @@
# The projection matrix P projects 3D points into the rectified image.#
#######################################################################
-# The image dimensions with which the camera was calibrated. Normally
-# this will be the full camera resolution in pixels.
+# The image dimensions with which the camera was calibrated.
+# Normally this will be the full camera resolution in pixels.
uint32 height
uint32 width
# The distortion model used. Supported models are listed in
-# sensor_msgs/distortion_models.h. For most cameras, "plumb_bob" - a
-# simple model of radial and tangential distortion - is sufficient.
+# sensor_msgs/distortion_models.hpp. For most cameras, "plumb_bob" - a
+# simple model of radial and tangential distortion - is sufficent.
string distortion_model
# The distortion parameters, size depending on the distortion model.
# For "plumb_bob", the 5 parameters are: (k1, k2, t1, t2, k3).
-float64[] D
+float64[] d
# Intrinsic camera matrix for the raw (distorted) images.
# [fx 0 cx]
@@ -70,13 +70,13 @@
# Projects 3D points in the camera coordinate frame to 2D pixel
# coordinates using the focal lengths (fx, fy) and principal point
# (cx, cy).
-float64[9] K # 3x3 row-major matrix
+float64[9] k # 3x3 row-major matrix
# Rectification matrix (stereo cameras only)
# A rotation matrix aligning the camera coordinate system to the ideal
# stereo image plane so that epipolar lines in both stereo images are
# parallel.
-float64[9] R # 3x3 row-major matrix
+float64[9] r # 3x3 row-major matrix
# Projection/camera matrix
# [fx' 0 cx' Tx]
@@ -102,7 +102,7 @@
# x = u / w
# y = v / w
# This holds for both images of a stereo pair.
-float64[12] P # 3x4 row-major matrix
+float64[12] p # 3x4 row-major matrix
#######################################################################
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/msg/ChannelFloat32.msg /opt/ros/eloquent/share/sensor_msgs/msg/ChannelFloat32.msg
--- /opt/ros/melodic/share/sensor_msgs/msg/ChannelFloat32.msg 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/msg/ChannelFloat32.msg 2019-10-23 15:06:18.000000000 -0700
@@ -3,7 +3,7 @@
# array should be the same as the length of the points array in the
# PointCloud, and each value should be associated with the corresponding
# point.
-
+#
# Channel names in existing practice include:
# "u", "v" - row and column (respectively) in the left stereo image.
# This is opposite to usual conventions but remains for
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/msg/CompressedImage.msg /opt/ros/eloquent/share/sensor_msgs/msg/CompressedImage.msg
--- /opt/ros/melodic/share/sensor_msgs/msg/CompressedImage.msg 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/msg/CompressedImage.msg 2019-10-23 15:06:18.000000000 -0700
@@ -1,8 +1,8 @@
-# This message contains a compressed image
+# This message contains a compressed image.
-Header header # Header timestamp should be acquisition time of image
+std_msgs/Header header # Header timestamp should be acquisition time of image
# Header frame_id should be optical frame of camera
- # origin of frame should be optical center of camera
+ # origin of frame should be optical center of cameara
# +x should point to the right in the image
# +y should point down in the image
# +z should point into to plane of the image
@@ -10,4 +10,5 @@
string format # Specifies the format of the data
# Acceptable values:
# jpeg, png
+
uint8[] data # Compressed image buffer
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/msg/FluidPressure.msg /opt/ros/eloquent/share/sensor_msgs/msg/FluidPressure.msg
--- /opt/ros/melodic/share/sensor_msgs/msg/FluidPressure.msg 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/msg/FluidPressure.msg 2019-10-23 15:06:18.000000000 -0700
@@ -1,12 +1,12 @@
- # Single pressure reading. This message is appropriate for measuring the
- # pressure inside of a fluid (air, water, etc). This also includes
- # atmospheric or barometric pressure.
+# Single pressure reading. This message is appropriate for measuring the
+# pressure inside of a fluid (air, water, etc). This also includes
+# atmospheric or barometric pressure.
+#
+# This message is not appropriate for force/pressure contact sensors.
- # This message is not appropriate for force/pressure contact sensors.
-
- Header header # timestamp of the measurement
+std_msgs/Header header # timestamp of the measurement
# frame_id is the location of the pressure sensor
- float64 fluid_pressure # Absolute pressure reading in Pascals.
+float64 fluid_pressure # Absolute pressure reading in Pascals.
- float64 variance # 0 is interpreted as variance unknown
\ No newline at end of file
+float64 variance # 0 is interpreted as variance unknown
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/msg/Illuminance.msg /opt/ros/eloquent/share/sensor_msgs/msg/Illuminance.msg
--- /opt/ros/melodic/share/sensor_msgs/msg/Illuminance.msg 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/msg/Illuminance.msg 2019-10-23 15:06:18.000000000 -0700
@@ -1,21 +1,20 @@
- # Single photometric illuminance measurement. Light should be assumed to be
- # measured along the sensor's x-axis (the area of detection is the y-z plane).
- # The illuminance should have a 0 or positive value and be received with
- # the sensor's +X axis pointing toward the light source.
+# Single photometric illuminance measurement. Light should be assumed to be
+# measured along the sensor's x-axis (the area of detection is the y-z plane).
+# The illuminance should have a 0 or positive value and be received with
+# the sensor's +X axis pointing toward the light source.
+#
+# Photometric illuminance is the measure of the human eye's sensitivity of the
+# intensity of light encountering or passing through a surface.
+#
+# All other Photometric and Radiometric measurements should not use this message.
+# This message cannot represent:
+# - Luminous intensity (candela/light source output)
+# - Luminance (nits/light output per area)
+# - Irradiance (watt/area), etc.
- # Photometric illuminance is the measure of the human eye's sensitivity of the
- # intensity of light encountering or passing through a surface.
-
- # All other Photometric and Radiometric measurements should
- # not use this message.
- # This message cannot represent:
- # Luminous intensity (candela/light source output)
- # Luminance (nits/light output per area)
- # Irradiance (watt/area), etc.
-
- Header header # timestamp is the time the illuminance was measured
+std_msgs/Header header # timestamp is the time the illuminance was measured
# frame_id is the location and direction of the reading
- float64 illuminance # Measurement of the Photometric Illuminance in Lux.
+float64 illuminance # Measurement of the Photometric Illuminance in Lux.
- float64 variance # 0 is interpreted as variance unknown
\ No newline at end of file
+float64 variance # 0 is interpreted as variance unknown
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/msg/Image.msg /opt/ros/eloquent/share/sensor_msgs/msg/Image.msg
--- /opt/ros/melodic/share/sensor_msgs/msg/Image.msg 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/msg/Image.msg 2019-10-23 15:06:18.000000000 -0700
@@ -1,10 +1,9 @@
# This message contains an uncompressed image
# (0, 0) is at top-left corner of image
-#
-Header header # Header timestamp should be acquisition time of image
+std_msgs/Header header # Header timestamp should be acquisition time of image
# Header frame_id should be optical frame of camera
- # origin of frame should be optical center of camera
+ # origin of frame should be optical center of cameara
# +x should point to the right in the image
# +y should point down in the image
# +z should point into to plane of the image
@@ -17,10 +16,10 @@
# The legal values for encoding are in file src/image_encodings.cpp
# If you want to standardize a new string format, join
-# ros-users@lists.sourceforge.net and send an email proposing a new encoding.
+# ros-users@lists.ros.org and send an email proposing a new encoding.
string encoding # Encoding of pixels -- channel meaning, ordering, size
- # taken from the list of strings in include/sensor_msgs/image_encodings.h
+ # taken from the list of strings in include/sensor_msgs/image_encodings.hpp
uint8 is_bigendian # is this data bigendian?
uint32 step # Full row length in bytes
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/msg/Imu.msg /opt/ros/eloquent/share/sensor_msgs/msg/Imu.msg
--- /opt/ros/melodic/share/sensor_msgs/msg/Imu.msg 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/msg/Imu.msg 2019-10-23 15:06:18.000000000 -0700
@@ -7,12 +7,12 @@
# A covariance matrix of all zeros will be interpreted as "covariance unknown", and to use the
# data a covariance will have to be assumed or gotten from some other source
#
-# If you have no estimate for one of the data elements (e.g. your IMU doesn't produce an orientation
-# estimate), please set element 0 of the associated covariance matrix to -1
+# If you have no estimate for one of the data elements (e.g. your IMU doesn't produce an
+# orientation estimate), please set element 0 of the associated covariance matrix to -1
# If you are interpreting this message, please check for a value of -1 in the first element of each
# covariance matrix, and disregard the associated estimate.
-Header header
+std_msgs/Header header
geometry_msgs/Quaternion orientation
float64[9] orientation_covariance # Row major about x, y, z axes
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/msg/JointState.msg /opt/ros/eloquent/share/sensor_msgs/msg/JointState.msg
--- /opt/ros/melodic/share/sensor_msgs/msg/JointState.msg 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/msg/JointState.msg 2019-10-23 15:06:18.000000000 -0700
@@ -17,8 +17,7 @@
# This is the only way to uniquely associate the joint name with the correct
# states.
-
-Header header
+std_msgs/Header header
string[] name
float64[] position
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/msg/JoyFeedback.msg /opt/ros/eloquent/share/sensor_msgs/msg/JoyFeedback.msg
--- /opt/ros/melodic/share/sensor_msgs/msg/JoyFeedback.msg 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/msg/JoyFeedback.msg 2019-10-23 15:06:18.000000000 -0700
@@ -1,3 +1,4 @@
+
# Declare of the type of feedback
uint8 TYPE_LED = 0
uint8 TYPE_RUMBLE = 1
@@ -12,4 +13,3 @@
# Intensity of the feedback, from 0.0 to 1.0, inclusive. If device is
# actually binary, driver should treat 0<=x<0.5 as off, 0.5<=x<=1 as on.
float32 intensity
-
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/msg/Joy.msg /opt/ros/eloquent/share/sensor_msgs/msg/Joy.msg
--- /opt/ros/melodic/share/sensor_msgs/msg/Joy.msg 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/msg/Joy.msg 2019-10-23 15:06:18.000000000 -0700
@@ -1,4 +1,10 @@
-# Reports the state of a joysticks axes and buttons.
-Header header # timestamp in the header is the time the data is received from the joystick
-float32[] axes # the axes measurements from a joystick
-int32[] buttons # the buttons measurements from a joystick
+# Reports the state of a joystick's axes and buttons.
+
+# The timestamp is the time at which data is received from the joystick.
+std_msgs/Header header
+
+# The axes measurements from a joystick.
+float32[] axes
+
+# The buttons measurements from a joystick.
+int32[] buttons
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/msg/LaserScan.msg /opt/ros/eloquent/share/sensor_msgs/msg/LaserScan.msg
--- /opt/ros/melodic/share/sensor_msgs/msg/LaserScan.msg 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/msg/LaserScan.msg 2019-10-23 15:06:18.000000000 -0700
@@ -4,7 +4,7 @@
# array), please find or create a different message, since applications
# will make fairly laser-specific assumptions about this data
-Header header # timestamp in the header is the acquisition time of
+std_msgs/Header header # timestamp in the header is the acquisition time of
# the first ray in the scan.
#
# in frame frame_id, angles are measured around
@@ -23,7 +23,8 @@
float32 range_min # minimum range value [m]
float32 range_max # maximum range value [m]
-float32[] ranges # range data [m] (Note: values < range_min or > range_max should be discarded)
+float32[] ranges # range data [m]
+ # (Note: values < range_min or > range_max should be discarded)
float32[] intensities # intensity data [device-specific units]. If your
# device does not provide intensities, please leave
# the array empty.
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/msg/MagneticField.msg /opt/ros/eloquent/share/sensor_msgs/msg/MagneticField.msg
--- /opt/ros/melodic/share/sensor_msgs/msg/MagneticField.msg 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/msg/MagneticField.msg 2019-10-23 15:06:18.000000000 -0700
@@ -1,22 +1,21 @@
- # Measurement of the Magnetic Field vector at a specific location.
+# Measurement of the Magnetic Field vector at a specific location.
+#
+# If the covariance of the measurement is known, it should be filled in.
+# If all you know is the variance of each measurement, e.g. from the datasheet,
+# just put those along the diagonal.
+# A covariance matrix of all zeros will be interpreted as "covariance unknown",
+# and to use the data a covariance will have to be assumed or gotten from some
+# other source.
- # If the covariance of the measurement is known, it should be filled in
- # (if all you know is the variance of each measurement, e.g. from the datasheet,
- #just put those along the diagonal)
- # A covariance matrix of all zeros will be interpreted as "covariance unknown",
- # and to use the data a covariance will have to be assumed or gotten from some
- # other source
-
-
- Header header # timestamp is the time the
+std_msgs/Header header # timestamp is the time the
# field was measured
# frame_id is the location and orientation
# of the field measurement
- geometry_msgs/Vector3 magnetic_field # x, y, and z components of the
+geometry_msgs/Vector3 magnetic_field # x, y, and z components of the
# field vector in Tesla
# If your sensor does not output 3 axes,
# put NaNs in the components not reported.
- float64[9] magnetic_field_covariance # Row major about x, y, z axes
+float64[9] magnetic_field_covariance # Row major about x, y, z axes
# 0 is interpreted as variance unknown
\ No newline at end of file
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/msg/MultiDOFJointState.msg /opt/ros/eloquent/share/sensor_msgs/msg/MultiDOFJointState.msg
--- /opt/ros/melodic/share/sensor_msgs/msg/MultiDOFJointState.msg 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/msg/MultiDOFJointState.msg 2019-10-23 15:06:18.000000000 -0700
@@ -18,7 +18,7 @@
# This is the only way to uniquely associate the joint name with the correct
# states.
-Header header
+std_msgs/Header header
string[] joint_names
geometry_msgs/Transform[] transforms
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/msg/MultiEchoLaserScan.msg /opt/ros/eloquent/share/sensor_msgs/msg/MultiEchoLaserScan.msg
--- /opt/ros/melodic/share/sensor_msgs/msg/MultiEchoLaserScan.msg 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/msg/MultiEchoLaserScan.msg 2019-10-23 15:06:18.000000000 -0700
@@ -4,7 +4,7 @@
# array), please find or create a different message, since applications
# will make fairly laser-specific assumptions about this data
-Header header # timestamp in the header is the acquisition time of
+std_msgs/Header header # timestamp in the header is the acquisition time of
# the first ray in the scan.
#
# in frame frame_id, angles are measured around
@@ -23,7 +23,8 @@
float32 range_min # minimum range value [m]
float32 range_max # maximum range value [m]
-LaserEcho[] ranges # range data [m] (Note: NaNs, values < range_min or > range_max should be discarded)
+LaserEcho[] ranges # range data [m]
+ # (Note: NaNs, values < range_min or > range_max should be discarded)
# +Inf measurements are out of range
# -Inf measurements are too close to determine exact distance.
LaserEcho[] intensities # intensity data [device-specific units]. If your
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/msg/NavSatFix.msg /opt/ros/eloquent/share/sensor_msgs/msg/NavSatFix.msg
--- /opt/ros/melodic/share/sensor_msgs/msg/NavSatFix.msg 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/msg/NavSatFix.msg 2019-10-23 15:06:18.000000000 -0700
@@ -10,9 +10,9 @@
# receiver, usually the location of the antenna. This is a
# Euclidean frame relative to the vehicle, not a reference
# ellipsoid.
-Header header
+std_msgs/Header header
-# satellite fix status information
+# Satellite fix status information.
NavSatStatus status
# Latitude [degrees]. Positive is north of equator; negative is south.
@@ -30,7 +30,6 @@
# Up (ENU), in row-major order.
#
# Beware: this coordinate system exhibits singularities at the poles.
-
float64[9] position_covariance
# If the covariance of the fix is known, fill it in completely. If the
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/msg/NavSatStatus.msg /opt/ros/eloquent/share/sensor_msgs/msg/NavSatStatus.msg
--- /opt/ros/melodic/share/sensor_msgs/msg/NavSatStatus.msg 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/msg/NavSatStatus.msg 2019-10-23 15:06:18.000000000 -0700
@@ -1,5 +1,5 @@
-# Navigation Satellite fix status for any Global Navigation Satellite System
-
+# Navigation Satellite fix status for any Global Navigation Satellite System.
+#
# Whether to output an augmented fix is determined by both the fix
# type and the last time differential corrections were received. A
# fix is valid when status >= STATUS_FIX.
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/msg/PointCloud2.msg /opt/ros/eloquent/share/sensor_msgs/msg/PointCloud2.msg
--- /opt/ros/melodic/share/sensor_msgs/msg/PointCloud2.msg 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/msg/PointCloud2.msg 2019-10-23 15:06:18.000000000 -0700
@@ -2,14 +2,13 @@
# contain additional information such as normals, intensity, etc. The
# point data is stored as a binary blob, its layout described by the
# contents of the "fields" array.
+#
+# The point cloud data may be organized 2d (image-like) or 1d (unordered).
+# Point clouds organized as 2d images may be produced by camera depth sensors
+# such as stereo or time-of-flight.
-# The point cloud data may be organized 2d (image-like) or 1d
-# (unordered). Point clouds organized as 2d images may be produced by
-# camera depth sensors such as stereo or time-of-flight.
-
-# Time of sensor data acquisition, and the coordinate frame ID (for 3d
-# points).
-Header header
+# Time of sensor data acquisition, and the coordinate frame ID (for 3d points).
+std_msgs/Header header
# 2D structure of the point cloud. If the cloud is unordered, height is
# 1 and width is the length of the point cloud.
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/msg/PointCloud.msg /opt/ros/eloquent/share/sensor_msgs/msg/PointCloud.msg
--- /opt/ros/melodic/share/sensor_msgs/msg/PointCloud.msg 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/msg/PointCloud.msg 2019-10-23 15:06:18.000000000 -0700
@@ -2,7 +2,7 @@
# information about each point.
# Time of sensor data acquisition, coordinate frame ID.
-Header header
+std_msgs/Header header
# Array of 3d points. Each Point32 should be interpreted as a 3d point
# in the frame given in the header.
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/msg/Range.msg /opt/ros/eloquent/share/sensor_msgs/msg/Range.msg
--- /opt/ros/melodic/share/sensor_msgs/msg/Range.msg 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/msg/Range.msg 2019-10-23 15:06:18.000000000 -0700
@@ -2,13 +2,13 @@
# one range reading that is valid along an arc at the distance measured.
# This message is not appropriate for laser scanners. See the LaserScan
# message if you are working with a laser scanner.
-
+#
# This message also can represent a fixed-distance (binary) ranger. This
# sensor will have min_range===max_range===distance of detection.
# These sensors follow REP 117 and will output -Inf if the object is detected
# and +Inf if the object is outside of the detection range.
-Header header # timestamp in the header is the time the ranger
+std_msgs/Header header # timestamp in the header is the time the ranger
# returned the distance reading
# Radiation type enums
@@ -31,8 +31,7 @@
# Fixed distance rangers require min_range==max_range
float32 range # range data [m]
- # (Note: values < range_min or > range_max
- # should be discarded)
+ # (Note: values < range_min or > range_max should be discarded)
# Fixed distance rangers only output -Inf or +Inf.
# -Inf represents a detection within fixed distance.
# (Detection too close to the sensor to quantify)
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/msg/RelativeHumidity.msg /opt/ros/eloquent/share/sensor_msgs/msg/RelativeHumidity.msg
--- /opt/ros/melodic/share/sensor_msgs/msg/RelativeHumidity.msg 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/msg/RelativeHumidity.msg 2019-10-23 15:06:18.000000000 -0700
@@ -1,12 +1,13 @@
- # Single reading from a relative humidity sensor. Defines the ratio of partial
- # pressure of water vapor to the saturated vapor pressure at a temperature.
+# Single reading from a relative humidity sensor.
+# Defines the ratio of partial pressure of water vapor to the saturated vapor
+# pressure at a temperature.
- Header header # timestamp of the measurement
+std_msgs/Header header # timestamp of the measurement
# frame_id is the location of the humidity sensor
- float64 relative_humidity # Expression of the relative humidity
+float64 relative_humidity # Expression of the relative humidity
# from 0.0 to 1.0.
# 0.0 is no partial pressure of water vapor
# 1.0 represents partial pressure of saturation
- float64 variance # 0 is interpreted as variance unknown
\ No newline at end of file
+float64 variance # 0 is interpreted as variance unknown
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/msg/Temperature.msg /opt/ros/eloquent/share/sensor_msgs/msg/Temperature.msg
--- /opt/ros/melodic/share/sensor_msgs/msg/Temperature.msg 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/msg/Temperature.msg 2019-10-23 15:06:18.000000000 -0700
@@ -1,8 +1,8 @@
- # Single temperature reading.
+# Single temperature reading.
- Header header # timestamp is the time the temperature was measured
+std_msgs/Header header # timestamp is the time the temperature was measured
# frame_id is the location of the temperature reading
- float64 temperature # Measurement of the Temperature in Degrees Celsius
+float64 temperature # Measurement of the Temperature in Degrees Celsius.
- float64 variance # 0 is interpreted as variance unknown
\ No newline at end of file
+float64 variance # 0 is interpreted as variance unknown.
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/msg/TimeReference.msg /opt/ros/eloquent/share/sensor_msgs/msg/TimeReference.msg
--- /opt/ros/melodic/share/sensor_msgs/msg/TimeReference.msg 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/msg/TimeReference.msg 2019-10-23 15:06:18.000000000 -0700
@@ -1,7 +1,7 @@
# Measurement from an external time source not actively synchronized with the system clock.
-Header header # stamp is system time for which measurement was valid
+std_msgs/Header header # stamp is system time for which measurement was valid
# frame_id is not used
-time time_ref # corresponding time from this external source
+builtin_interfaces/Time time_ref # corresponding time from this external source
string source # (optional) name of time source
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/geometry_msgs/msg/AccelStamped.msg /opt/ros/eloquent/share/geometry_msgs/msg/AccelStamped.msg
--- /opt/ros/melodic/share/geometry_msgs/msg/AccelStamped.msg 2018-11-06 23:15:58.000000000 -0800
+++ /opt/ros/eloquent/share/geometry_msgs/msg/AccelStamped.msg 2019-10-23 15:06:16.000000000 -0700
@@ -1,3 +1,3 @@
# An accel with reference coordinate frame and timestamp
-Header header
+std_msgs/Header header
Accel accel
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/geometry_msgs/msg/AccelWithCovarianceStamped.msg /opt/ros/eloquent/share/geometry_msgs/msg/AccelWithCovarianceStamped.msg
--- /opt/ros/melodic/share/geometry_msgs/msg/AccelWithCovarianceStamped.msg 2018-11-06 23:15:58.000000000 -0800
+++ /opt/ros/eloquent/share/geometry_msgs/msg/AccelWithCovarianceStamped.msg 2019-10-23 15:06:16.000000000 -0700
@@ -1,3 +1,3 @@
# This represents an estimated accel with reference coordinate frame and timestamp.
-Header header
+std_msgs/Header header
AccelWithCovariance accel
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/geometry_msgs/msg/Inertia.msg /opt/ros/eloquent/share/geometry_msgs/msg/Inertia.msg
--- /opt/ros/melodic/share/geometry_msgs/msg/Inertia.msg 2018-11-06 23:15:58.000000000 -0800
+++ /opt/ros/eloquent/share/geometry_msgs/msg/Inertia.msg 2019-10-23 15:06:16.000000000 -0700
@@ -1,3 +1,4 @@
+
# Mass [kg]
float64 m
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/geometry_msgs/msg/InertiaStamped.msg /opt/ros/eloquent/share/geometry_msgs/msg/InertiaStamped.msg
--- /opt/ros/melodic/share/geometry_msgs/msg/InertiaStamped.msg 2018-11-06 23:15:58.000000000 -0800
+++ /opt/ros/eloquent/share/geometry_msgs/msg/InertiaStamped.msg 2019-10-23 15:06:16.000000000 -0700
@@ -1,2 +1,2 @@
-Header header
+std_msgs/Header header
Inertia inertia
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/geometry_msgs/msg/PointStamped.msg /opt/ros/eloquent/share/geometry_msgs/msg/PointStamped.msg
--- /opt/ros/melodic/share/geometry_msgs/msg/PointStamped.msg 2018-11-06 23:15:58.000000000 -0800
+++ /opt/ros/eloquent/share/geometry_msgs/msg/PointStamped.msg 2019-10-23 15:06:16.000000000 -0700
@@ -1,3 +1,4 @@
# This represents a Point with reference coordinate frame and timestamp
-Header header
+
+std_msgs/Header header
Point point
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/geometry_msgs/msg/Polygon.msg /opt/ros/eloquent/share/geometry_msgs/msg/Polygon.msg
--- /opt/ros/melodic/share/geometry_msgs/msg/Polygon.msg 2018-11-06 23:15:58.000000000 -0800
+++ /opt/ros/eloquent/share/geometry_msgs/msg/Polygon.msg 2019-10-23 15:06:16.000000000 -0700
@@ -1,2 +1,3 @@
-#A specification of a polygon where the first and last points are assumed to be connected
+# A specification of a polygon where the first and last points are assumed to be connected
+
Point32[] points
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/geometry_msgs/msg/PolygonStamped.msg /opt/ros/eloquent/share/geometry_msgs/msg/PolygonStamped.msg
--- /opt/ros/melodic/share/geometry_msgs/msg/PolygonStamped.msg 2018-11-06 23:15:58.000000000 -0800
+++ /opt/ros/eloquent/share/geometry_msgs/msg/PolygonStamped.msg 2019-10-23 15:06:16.000000000 -0700
@@ -1,3 +1,4 @@
# This represents a Polygon with reference coordinate frame and timestamp
-Header header
+
+std_msgs/Header header
Polygon polygon
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/geometry_msgs/msg/Pose2D.msg /opt/ros/eloquent/share/geometry_msgs/msg/Pose2D.msg
--- /opt/ros/melodic/share/geometry_msgs/msg/Pose2D.msg 2018-11-06 23:15:58.000000000 -0800
+++ /opt/ros/eloquent/share/geometry_msgs/msg/Pose2D.msg 2019-10-23 15:06:16.000000000 -0700
@@ -1,11 +1,3 @@
-# Deprecated
-# Please use the full 3D pose.
-
-# In general our recommendation is to use a full 3D representation of everything and for 2D specific applications make the appropriate projections into the plane for their calculations but optimally will preserve the 3D information during processing.
-
-# If we have parallel copies of 2D datatypes every UI and other pipeline will end up needing to have dual interfaces to plot everything. And you will end up with not being able to use 3D tools for 2D use cases even if they're completely valid, as you'd have to reimplement it with different inputs and outputs. It's not particularly hard to plot the 2D pose or compute the yaw error for the Pose message and there are already tools and libraries that can do this for you.
-
-
# This expresses a position and orientation on a 2D manifold.
float64 x
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/geometry_msgs/msg/PoseArray.msg /opt/ros/eloquent/share/geometry_msgs/msg/PoseArray.msg
--- /opt/ros/melodic/share/geometry_msgs/msg/PoseArray.msg 2018-11-06 23:15:58.000000000 -0800
+++ /opt/ros/eloquent/share/geometry_msgs/msg/PoseArray.msg 2019-10-23 15:06:16.000000000 -0700
@@ -1,5 +1,5 @@
# An array of poses with a header for global reference.
-Header header
+std_msgs/Header header
Pose[] poses
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/geometry_msgs/msg/Pose.msg /opt/ros/eloquent/share/geometry_msgs/msg/Pose.msg
--- /opt/ros/melodic/share/geometry_msgs/msg/Pose.msg 2018-11-06 23:15:58.000000000 -0800
+++ /opt/ros/eloquent/share/geometry_msgs/msg/Pose.msg 2019-10-23 15:06:16.000000000 -0700
@@ -1,3 +1,4 @@
-# A representation of pose in free space, composed of position and orientation.
+# A representation of pose in free space, composed of postion and orientation.
+
Point position
Quaternion orientation
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/geometry_msgs/msg/PoseStamped.msg /opt/ros/eloquent/share/geometry_msgs/msg/PoseStamped.msg
--- /opt/ros/melodic/share/geometry_msgs/msg/PoseStamped.msg 2018-11-06 23:15:58.000000000 -0800
+++ /opt/ros/eloquent/share/geometry_msgs/msg/PoseStamped.msg 2019-10-23 15:06:16.000000000 -0700
@@ -1,3 +1,4 @@
# A Pose with reference coordinate frame and timestamp
-Header header
+
+std_msgs/Header header
Pose pose
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/geometry_msgs/msg/PoseWithCovarianceStamped.msg /opt/ros/eloquent/share/geometry_msgs/msg/PoseWithCovarianceStamped.msg
--- /opt/ros/melodic/share/geometry_msgs/msg/PoseWithCovarianceStamped.msg 2018-11-06 23:15:58.000000000 -0800
+++ /opt/ros/eloquent/share/geometry_msgs/msg/PoseWithCovarianceStamped.msg 2019-10-23 15:06:16.000000000 -0700
@@ -1,4 +1,4 @@
# This expresses an estimated pose with a reference coordinate frame and timestamp
-Header header
+std_msgs/Header header
PoseWithCovariance pose
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/geometry_msgs/msg/Quaternion.msg /opt/ros/eloquent/share/geometry_msgs/msg/Quaternion.msg
--- /opt/ros/melodic/share/geometry_msgs/msg/Quaternion.msg 2018-11-06 23:15:58.000000000 -0800
+++ /opt/ros/eloquent/share/geometry_msgs/msg/Quaternion.msg 2019-10-23 15:06:16.000000000 -0700
@@ -1,6 +1,6 @@
# This represents an orientation in free space in quaternion form.
-float64 x
-float64 y
-float64 z
-float64 w
+float64 x 0
+float64 y 0
+float64 z 0
+float64 w 1
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/geometry_msgs/msg/QuaternionStamped.msg /opt/ros/eloquent/share/geometry_msgs/msg/QuaternionStamped.msg
--- /opt/ros/melodic/share/geometry_msgs/msg/QuaternionStamped.msg 2018-11-06 23:15:58.000000000 -0800
+++ /opt/ros/eloquent/share/geometry_msgs/msg/QuaternionStamped.msg 2019-10-23 15:06:16.000000000 -0700
@@ -1,4 +1,4 @@
# This represents an orientation with reference coordinate frame and timestamp.
-Header header
+std_msgs/Header header
Quaternion quaternion
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/geometry_msgs/msg/TransformStamped.msg /opt/ros/eloquent/share/geometry_msgs/msg/TransformStamped.msg
--- /opt/ros/melodic/share/geometry_msgs/msg/TransformStamped.msg 2018-11-06 23:15:58.000000000 -0800
+++ /opt/ros/eloquent/share/geometry_msgs/msg/TransformStamped.msg 2019-10-23 15:06:16.000000000 -0700
@@ -2,9 +2,9 @@
# to the coordinate frame child_frame_id
#
# This message is mostly used by the
-# <a href="http://wiki.ros.org/tf">tf</a> package.
+# <a href="http://www.ros.org/wiki/tf">tf</a> package.
# See its documentation for more information.
-Header header
+std_msgs/Header header
string child_frame_id # the frame id of the child frame
Transform transform
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/geometry_msgs/msg/Twist.msg /opt/ros/eloquent/share/geometry_msgs/msg/Twist.msg
--- /opt/ros/melodic/share/geometry_msgs/msg/Twist.msg 2018-11-06 23:15:58.000000000 -0800
+++ /opt/ros/eloquent/share/geometry_msgs/msg/Twist.msg 2019-10-23 15:06:16.000000000 -0700
@@ -1,3 +1,4 @@
# This expresses velocity in free space broken into its linear and angular parts.
+
Vector3 linear
Vector3 angular
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/geometry_msgs/msg/TwistStamped.msg /opt/ros/eloquent/share/geometry_msgs/msg/TwistStamped.msg
--- /opt/ros/melodic/share/geometry_msgs/msg/TwistStamped.msg 2018-11-06 23:15:58.000000000 -0800
+++ /opt/ros/eloquent/share/geometry_msgs/msg/TwistStamped.msg 2019-10-23 15:06:16.000000000 -0700
@@ -1,3 +1,4 @@
# A twist with reference coordinate frame and timestamp
-Header header
+
+std_msgs/Header header
Twist twist
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/geometry_msgs/msg/TwistWithCovarianceStamped.msg /opt/ros/eloquent/share/geometry_msgs/msg/TwistWithCovarianceStamped.msg
--- /opt/ros/melodic/share/geometry_msgs/msg/TwistWithCovarianceStamped.msg 2018-11-06 23:15:58.000000000 -0800
+++ /opt/ros/eloquent/share/geometry_msgs/msg/TwistWithCovarianceStamped.msg 2019-10-23 15:06:16.000000000 -0700
@@ -1,3 +1,4 @@
# This represents an estimated twist with reference coordinate frame and timestamp.
-Header header
+
+std_msgs/Header header
TwistWithCovariance twist
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/geometry_msgs/msg/Vector3.msg /opt/ros/eloquent/share/geometry_msgs/msg/Vector3.msg
--- /opt/ros/melodic/share/geometry_msgs/msg/Vector3.msg 2018-11-06 23:15:58.000000000 -0800
+++ /opt/ros/eloquent/share/geometry_msgs/msg/Vector3.msg 2019-10-23 15:06:16.000000000 -0700
@@ -1,9 +1,4 @@
# This represents a vector in free space.
-# It is only meant to represent a direction. Therefore, it does not
-# make sense to apply a translation to it (e.g., when applying a
-# generic rigid transformation to a Vector3, tf2 will only apply the
-# rotation). If you want your data to be translatable too, use the
-# geometry_msgs/Point message instead.
float64 x
float64 y
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/geometry_msgs/msg/Vector3Stamped.msg /opt/ros/eloquent/share/geometry_msgs/msg/Vector3Stamped.msg
--- /opt/ros/melodic/share/geometry_msgs/msg/Vector3Stamped.msg 2018-11-06 23:15:58.000000000 -0800
+++ /opt/ros/eloquent/share/geometry_msgs/msg/Vector3Stamped.msg 2019-10-23 15:06:16.000000000 -0700
@@ -1,3 +1,4 @@
# This represents a Vector3 with reference coordinate frame and timestamp
-Header header
+
+std_msgs/Header header
Vector3 vector
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/geometry_msgs/msg/Wrench.msg /opt/ros/eloquent/share/geometry_msgs/msg/Wrench.msg
--- /opt/ros/melodic/share/geometry_msgs/msg/Wrench.msg 2018-11-06 23:15:58.000000000 -0800
+++ /opt/ros/eloquent/share/geometry_msgs/msg/Wrench.msg 2019-10-23 15:06:16.000000000 -0700
@@ -1,4 +1,4 @@
-# This represents force in free space, separated into
-# its linear and angular parts.
+# This represents force in free space, separated into its linear and angular parts.
+
Vector3 force
Vector3 torque
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/geometry_msgs/msg/WrenchStamped.msg /opt/ros/eloquent/share/geometry_msgs/msg/WrenchStamped.msg
--- /opt/ros/melodic/share/geometry_msgs/msg/WrenchStamped.msg 2018-11-06 23:15:58.000000000 -0800
+++ /opt/ros/eloquent/share/geometry_msgs/msg/WrenchStamped.msg 2019-10-23 15:06:16.000000000 -0700
@@ -1,3 +1,4 @@
# A wrench with reference coordinate frame and timestamp
-Header header
+
+std_msgs/Header header
Wrench wrench
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/actionlib_msgs/msg/GoalID.msg /opt/ros/eloquent/share/actionlib_msgs/msg/GoalID.msg
--- /opt/ros/melodic/share/actionlib_msgs/msg/GoalID.msg 2018-11-06 23:15:53.000000000 -0800
+++ /opt/ros/eloquent/share/actionlib_msgs/msg/GoalID.msg 2019-10-23 15:06:10.000000000 -0700
@@ -1,10 +1,10 @@
+
# The stamp should store the time at which this goal was requested.
# It is used by an action server when it tries to preempt all
# goals that were requested before a certain time
-time stamp
+builtin_interfaces/Time stamp
# The id provides a way to associate feedback and
# result message with specific goal requests. The id
# specified must be unique.
string id
-
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/actionlib_msgs/msg/GoalStatusArray.msg /opt/ros/eloquent/share/actionlib_msgs/msg/GoalStatusArray.msg
--- /opt/ros/melodic/share/actionlib_msgs/msg/GoalStatusArray.msg 2018-11-06 23:15:53.000000000 -0800
+++ /opt/ros/eloquent/share/actionlib_msgs/msg/GoalStatusArray.msg 2019-10-23 15:06:10.000000000 -0700
@@ -1,5 +1,4 @@
# Stores the statuses for goals that are currently being tracked
# by an action server
-Header header
+std_msgs/Header header
GoalStatus[] status_list
-
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/actionlib_msgs/msg/GoalStatus.msg /opt/ros/eloquent/share/actionlib_msgs/msg/GoalStatus.msg
--- /opt/ros/melodic/share/actionlib_msgs/msg/GoalStatus.msg 2018-11-06 23:15:53.000000000 -0800
+++ /opt/ros/eloquent/share/actionlib_msgs/msg/GoalStatus.msg 2019-10-23 15:06:10.000000000 -0700
@@ -1,23 +1,23 @@
GoalID goal_id
uint8 status
-uint8 PENDING = 0 # The goal has yet to be processed by the action server
-uint8 ACTIVE = 1 # The goal is currently being processed by the action server
+uint8 PENDING = 0 # The goal has yet to be processed by the action server.
+uint8 ACTIVE = 1 # The goal is currently being processed by the action server.
uint8 PREEMPTED = 2 # The goal received a cancel request after it started executing
- # and has since completed its execution (Terminal State)
-uint8 SUCCEEDED = 3 # The goal was achieved successfully by the action server (Terminal State)
+ # and has since completed its execution (Terminal State).
+uint8 SUCCEEDED = 3 # The goal was achieved successfully by the action server
+ # (Terminal State).
uint8 ABORTED = 4 # The goal was aborted during execution by the action server due
- # to some failure (Terminal State)
+ # to some failure (Terminal State).
uint8 REJECTED = 5 # The goal was rejected by the action server without being processed,
- # because the goal was unattainable or invalid (Terminal State)
+ # because the goal was unattainable or invalid (Terminal State).
uint8 PREEMPTING = 6 # The goal received a cancel request after it started executing
- # and has not yet completed execution
-uint8 RECALLING = 7 # The goal received a cancel request before it started executing,
- # but the action server has not yet confirmed that the goal is canceled
+ # and has not yet completed execution.
+uint8 RECALLING = 7 # The goal received a cancel request before it started executing, but
+ # the action server has not yet confirmed that the goal is canceled.
uint8 RECALLED = 8 # The goal received a cancel request before it started executing
- # and was successfully cancelled (Terminal State)
-uint8 LOST = 9 # An action client can determine that a goal is LOST. This should not be
- # sent over the wire by an action server
+ # and was successfully cancelled (Terminal State).
+uint8 LOST = 9 # An action client can determine that a goal is LOST. This should not
+ # be sent over the wire by an action server.
-#Allow for the user to associate a string with GoalStatus for debugging
+# Allow for the user to associate a string with GoalStatus for debugging.
string text
-
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/diagnostic_msgs/msg/DiagnosticArray.msg /opt/ros/eloquent/share/diagnostic_msgs/msg/DiagnosticArray.msg
--- /opt/ros/melodic/share/diagnostic_msgs/msg/DiagnosticArray.msg 2018-11-06 23:16:02.000000000 -0800
+++ /opt/ros/eloquent/share/diagnostic_msgs/msg/DiagnosticArray.msg 2019-10-23 15:06:08.000000000 -0700
@@ -1,3 +1,3 @@
-# This message is used to send diagnostic information about the state of the robot
-Header header #for timestamp
+# This message is used to send diagnostic information about the state of the robot.
+std_msgs/Header header # for timestamp
DiagnosticStatus[] status # an array of components being reported on
\ No newline at end of file
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/diagnostic_msgs/msg/DiagnosticStatus.msg /opt/ros/eloquent/share/diagnostic_msgs/msg/DiagnosticStatus.msg
--- /opt/ros/melodic/share/diagnostic_msgs/msg/DiagnosticStatus.msg 2018-11-06 23:16:02.000000000 -0800
+++ /opt/ros/eloquent/share/diagnostic_msgs/msg/DiagnosticStatus.msg 2019-10-23 15:06:08.000000000 -0700
@@ -1,15 +1,19 @@
# This message holds the status of an individual component of the robot.
-#
-# Possible levels of operations
+# Possible levels of operations.
byte OK=0
byte WARN=1
byte ERROR=2
byte STALE=3
-byte level # level of operation enumerated above
-string name # a description of the test/component reporting
-string message # a description of the status
-string hardware_id # a hardware unique string
-KeyValue[] values # an array of values associated with the status
+# Level of operation enumerated above.
+byte level
+# A description of the test/component reporting.
+string name
+# A description of the status.
+string message
+# A hardware unique string.
+string hardware_id
+# An array of values associated with the status.
+KeyValue[] values
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/diagnostic_msgs/msg/KeyValue.msg /opt/ros/eloquent/share/diagnostic_msgs/msg/KeyValue.msg
--- /opt/ros/melodic/share/diagnostic_msgs/msg/KeyValue.msg 2018-11-06 23:16:02.000000000 -0800
+++ /opt/ros/eloquent/share/diagnostic_msgs/msg/KeyValue.msg 2019-10-23 15:06:08.000000000 -0700
@@ -1,2 +1,5 @@
-string key # what to label this value when viewing
-string value # a value to track over time
+
+# What to label this value when viewing.
+string key
+# A value to track over time.
+string value
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/nav_msgs/msg/GridCells.msg /opt/ros/eloquent/share/nav_msgs/msg/GridCells.msg
--- /opt/ros/melodic/share/nav_msgs/msg/GridCells.msg 2018-11-06 23:15:48.000000000 -0800
+++ /opt/ros/eloquent/share/nav_msgs/msg/GridCells.msg 2019-10-23 15:06:19.000000000 -0700
@@ -1,5 +1,6 @@
-#an array of cells in a 2D grid
-Header header
+# An array of cells in a 2D grid
+
+std_msgs/Header header
float32 cell_width
float32 cell_height
geometry_msgs/Point[] cells
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/nav_msgs/msg/MapMetaData.msg /opt/ros/eloquent/share/nav_msgs/msg/MapMetaData.msg
--- /opt/ros/melodic/share/nav_msgs/msg/MapMetaData.msg 2018-11-06 23:15:48.000000000 -0800
+++ /opt/ros/eloquent/share/nav_msgs/msg/MapMetaData.msg 2019-10-23 15:06:19.000000000 -0700
@@ -1,13 +1,17 @@
# This hold basic information about the characterists of the OccupancyGrid
# The time at which the map was loaded
-time map_load_time
+builtin_interfaces/Time map_load_time
+
# The map resolution [m/cell]
float32 resolution
+
# Map width [cells]
uint32 width
+
# Map height [cells]
uint32 height
+
# The origin of the map [m, m, rad]. This is the real-world pose of the
# cell (0,0) in the map.
geometry_msgs/Pose origin
\ No newline at end of file
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/nav_msgs/msg/OccupancyGrid.msg /opt/ros/eloquent/share/nav_msgs/msg/OccupancyGrid.msg
--- /opt/ros/melodic/share/nav_msgs/msg/OccupancyGrid.msg 2018-11-06 23:15:48.000000000 -0800
+++ /opt/ros/eloquent/share/nav_msgs/msg/OccupancyGrid.msg 2019-10-23 15:06:19.000000000 -0700
@@ -1,9 +1,8 @@
-# This represents a 2-D grid map, in which each cell represents the probability of
-# occupancy.
+# This represents a 2-D grid map, in which each cell represents the probability of occupancy.
-Header header
+std_msgs/Header header
-#MetaData for the map
+# MetaData for the map
MapMetaData info
# The map data, in row-major order, starting with (0,0). Occupancy
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/nav_msgs/msg/Odometry.msg /opt/ros/eloquent/share/nav_msgs/msg/Odometry.msg
--- /opt/ros/melodic/share/nav_msgs/msg/Odometry.msg 2018-11-06 23:15:48.000000000 -0800
+++ /opt/ros/eloquent/share/nav_msgs/msg/Odometry.msg 2019-10-23 15:06:19.000000000 -0700
@@ -1,7 +1,8 @@
# This represents an estimate of a position and velocity in free space.
-# The pose in this message should be specified in the coordinate frame given by header.frame_id.
+# The pose in this message should be specified in the coordinate frame given by header.frame_id
# The twist in this message should be specified in the coordinate frame given by the child_frame_id
-Header header
+
+std_msgs/Header header
string child_frame_id
geometry_msgs/PoseWithCovariance pose
geometry_msgs/TwistWithCovariance twist
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/nav_msgs/msg/Path.msg /opt/ros/eloquent/share/nav_msgs/msg/Path.msg
--- /opt/ros/melodic/share/nav_msgs/msg/Path.msg 2018-11-06 23:15:48.000000000 -0800
+++ /opt/ros/eloquent/share/nav_msgs/msg/Path.msg 2019-10-23 15:06:19.000000000 -0700
@@ -1,3 +1,4 @@
-#An array of poses that represents a Path for a robot to follow
-Header header
+# An array of poses that represents a Path for a robot to follow.
+
+std_msgs/Header header
geometry_msgs/PoseStamped[] poses
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/shape_msgs/msg/Mesh.msg /opt/ros/eloquent/share/shape_msgs/msg/Mesh.msg
--- /opt/ros/melodic/share/shape_msgs/msg/Mesh.msg 2018-11-06 23:15:49.000000000 -0800
+++ /opt/ros/eloquent/share/shape_msgs/msg/Mesh.msg 2019-10-23 15:06:22.000000000 -0700
@@ -1,7 +1,7 @@
-# Definition of a mesh
+# Definition of a mesh.
-# list of triangles; the index values refer to positions in vertices[]
+# List of triangles; the index values refer to positions in vertices[].
MeshTriangle[] triangles
-# the actual vertices that make up the mesh
+# The actual vertices that make up the mesh.
geometry_msgs/Point[] vertices
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/shape_msgs/msg/MeshTriangle.msg /opt/ros/eloquent/share/shape_msgs/msg/MeshTriangle.msg
--- /opt/ros/melodic/share/shape_msgs/msg/MeshTriangle.msg 2018-11-06 23:15:49.000000000 -0800
+++ /opt/ros/eloquent/share/shape_msgs/msg/MeshTriangle.msg 2019-10-23 15:06:22.000000000 -0700
@@ -1,2 +1,3 @@
-# Definition of a triangle's vertices
+# Definition of a triangle's vertices.
+
uint32[3] vertex_indices
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/shape_msgs/msg/Plane.msg /opt/ros/eloquent/share/shape_msgs/msg/Plane.msg
--- /opt/ros/melodic/share/shape_msgs/msg/Plane.msg 2018-11-06 23:15:49.000000000 -0800
+++ /opt/ros/eloquent/share/shape_msgs/msg/Plane.msg 2019-10-23 15:06:22.000000000 -0700
@@ -1,8 +1,7 @@
-# Representation of a plane, using the plane equation ax + by + cz + d = 0
-
+# Representation of a plane, using the plane equation ax + by + cz + d = 0.
+#
# a := coef[0]
# b := coef[1]
# c := coef[2]
# d := coef[3]
-
float64[4] coef
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/shape_msgs/msg/SolidPrimitive.msg /opt/ros/eloquent/share/shape_msgs/msg/SolidPrimitive.msg
--- /opt/ros/melodic/share/shape_msgs/msg/SolidPrimitive.msg 2018-11-06 23:15:49.000000000 -0800
+++ /opt/ros/eloquent/share/shape_msgs/msg/SolidPrimitive.msg 2019-10-23 15:06:22.000000000 -0700
@@ -1,4 +1,4 @@
-# Define box, sphere, cylinder, cone
+# Defines box, sphere, cylinder, and cone.
# All shapes are defined to have their bounding boxes centered around 0,0,0.
uint8 BOX=1
@@ -9,31 +9,26 @@
# The type of the shape
uint8 type
-
# The dimensions of the shape
-float64[] dimensions
+float64[<=3] dimensions # At no point will dimensions have a length > 3.
-# The meaning of the shape dimensions: each constant defines the index in the 'dimensions' array
+# The meaning of the shape dimensions: each constant defines the index in the 'dimensions' array.
-# For the BOX type, the X, Y, and Z dimensions are the length of the corresponding
-# sides of the box.
+# For type BOX, the X, Y, and Z dimensions are the length of the corresponding sides of the box.
uint8 BOX_X=0
uint8 BOX_Y=1
uint8 BOX_Z=2
-
-# For the SPHERE type, only one component is used, and it gives the radius of
-# the sphere.
+# For the SPHERE type, only one component is used, and it gives the radius of the sphere.
uint8 SPHERE_RADIUS=0
-
-# For the CYLINDER and CONE types, the center line is oriented along
-# the Z axis. Therefore the CYLINDER_HEIGHT (CONE_HEIGHT) component
-# of dimensions gives the height of the cylinder (cone). The
-# CYLINDER_RADIUS (CONE_RADIUS) component of dimensions gives the
-# radius of the base of the cylinder (cone). Cone and cylinder
-# primitives are defined to be circular. The tip of the cone is
-# pointing up, along +Z axis.
+# For the CYLINDER and CONE types, the center line is oriented along the Z axis.
+# Therefore the CYLINDER_HEIGHT (CONE_HEIGHT) component of dimensions gives the
+# height of the cylinder (cone).
+# The CYLINDER_RADIUS (CONE_RADIUS) component of dimensions gives the radius of
+# the base of the cylinder (cone).
+# Cone and cylinder primitives are defined to be circular. The tip of the cone
+# is pointing up, along +Z axis.
uint8 CYLINDER_HEIGHT=0
uint8 CYLINDER_RADIUS=1
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/std_msgs/msg/ByteMultiArray.msg /opt/ros/eloquent/share/std_msgs/msg/ByteMultiArray.msg
--- /opt/ros/melodic/share/std_msgs/msg/ByteMultiArray.msg 2019-03-04 16:10:49.000000000 -0800
+++ /opt/ros/eloquent/share/std_msgs/msg/ByteMultiArray.msg 2019-10-23 15:06:12.000000000 -0700
@@ -3,4 +3,3 @@
MultiArrayLayout layout # specification of data layout
byte[] data # array of data
-
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/std_msgs/msg/Float32MultiArray.msg /opt/ros/eloquent/share/std_msgs/msg/Float32MultiArray.msg
--- /opt/ros/melodic/share/std_msgs/msg/Float32MultiArray.msg 2019-03-04 16:10:49.000000000 -0800
+++ /opt/ros/eloquent/share/std_msgs/msg/Float32MultiArray.msg 2019-10-23 15:06:12.000000000 -0700
@@ -3,4 +3,3 @@
MultiArrayLayout layout # specification of data layout
float32[] data # array of data
-
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/std_msgs/msg/Float64MultiArray.msg /opt/ros/eloquent/share/std_msgs/msg/Float64MultiArray.msg
--- /opt/ros/melodic/share/std_msgs/msg/Float64MultiArray.msg 2019-03-04 16:10:49.000000000 -0800
+++ /opt/ros/eloquent/share/std_msgs/msg/Float64MultiArray.msg 2019-10-23 15:06:12.000000000 -0700
@@ -3,4 +3,3 @@
MultiArrayLayout layout # specification of data layout
float64[] data # array of data
-
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/std_msgs/msg/Header.msg /opt/ros/eloquent/share/std_msgs/msg/Header.msg
--- /opt/ros/melodic/share/std_msgs/msg/Header.msg 2019-03-04 16:10:49.000000000 -0800
+++ /opt/ros/eloquent/share/std_msgs/msg/Header.msg 2019-10-23 15:06:12.000000000 -0700
@@ -1,13 +1,9 @@
# Standard metadata for higher-level stamped data types.
# This is generally used to communicate timestamped data
# in a particular coordinate frame.
-#
-# sequence ID: consecutively increasing ID
-uint32 seq
-#Two-integer timestamp that is expressed as:
-# * stamp.sec: seconds (stamp_secs) since epoch (in Python the variable is called 'secs')
-# * stamp.nsec: nanoseconds since stamp_secs (in Python the variable is called 'nsecs')
-# time-handling sugar is provided by the client library
-time stamp
-#Frame this data is associated with
+
+# Two-integer timestamp that is expressed as seconds and nanoseconds.
+builtin_interfaces/Time stamp
+
+# Transform frame with which this data is associated.
string frame_id
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/std_msgs/msg/Int16MultiArray.msg /opt/ros/eloquent/share/std_msgs/msg/Int16MultiArray.msg
--- /opt/ros/melodic/share/std_msgs/msg/Int16MultiArray.msg 2019-03-04 16:10:49.000000000 -0800
+++ /opt/ros/eloquent/share/std_msgs/msg/Int16MultiArray.msg 2019-10-23 15:06:12.000000000 -0700
@@ -3,4 +3,3 @@
MultiArrayLayout layout # specification of data layout
int16[] data # array of data
-
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/std_msgs/msg/Int32MultiArray.msg /opt/ros/eloquent/share/std_msgs/msg/Int32MultiArray.msg
--- /opt/ros/melodic/share/std_msgs/msg/Int32MultiArray.msg 2019-03-04 16:10:49.000000000 -0800
+++ /opt/ros/eloquent/share/std_msgs/msg/Int32MultiArray.msg 2019-10-23 15:06:12.000000000 -0700
@@ -3,4 +3,3 @@
MultiArrayLayout layout # specification of data layout
int32[] data # array of data
-
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/std_msgs/msg/Int64MultiArray.msg /opt/ros/eloquent/share/std_msgs/msg/Int64MultiArray.msg
--- /opt/ros/melodic/share/std_msgs/msg/Int64MultiArray.msg 2019-03-04 16:10:49.000000000 -0800
+++ /opt/ros/eloquent/share/std_msgs/msg/Int64MultiArray.msg 2019-10-23 15:06:12.000000000 -0700
@@ -3,4 +3,3 @@
MultiArrayLayout layout # specification of data layout
int64[] data # array of data
-
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/std_msgs/msg/Int8MultiArray.msg /opt/ros/eloquent/share/std_msgs/msg/Int8MultiArray.msg
--- /opt/ros/melodic/share/std_msgs/msg/Int8MultiArray.msg 2019-03-04 16:10:49.000000000 -0800
+++ /opt/ros/eloquent/share/std_msgs/msg/Int8MultiArray.msg 2019-10-23 15:06:12.000000000 -0700
@@ -3,4 +3,3 @@
MultiArrayLayout layout # specification of data layout
int8[] data # array of data
-
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/std_msgs/msg/MultiArrayLayout.msg /opt/ros/eloquent/share/std_msgs/msg/MultiArrayLayout.msg
--- /opt/ros/melodic/share/std_msgs/msg/MultiArrayLayout.msg 2019-03-04 16:10:49.000000000 -0800
+++ /opt/ros/eloquent/share/std_msgs/msg/MultiArrayLayout.msg 2019-10-23 15:06:12.000000000 -0700
@@ -1,10 +1,7 @@
# The multiarray declares a generic multi-dimensional array of a
# particular data type. Dimensions are ordered from outer most
# to inner most.
-
-MultiArrayDimension[] dim # Array of dimension properties
-uint32 data_offset # padding elements at front of data
-
+#
# Accessors should ALWAYS be written in terms of dimension stride
# and specified outer-most dimension first.
#
@@ -24,3 +21,6 @@
# dim[2].stride = 3
#
# multiarray(i,j,k) refers to the ith row, jth column, and kth channel.
+
+MultiArrayDimension[] dim # Array of dimension properties
+uint32 data_offset # padding bytes at front of data
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/std_msgs/msg/UInt16MultiArray.msg /opt/ros/eloquent/share/std_msgs/msg/UInt16MultiArray.msg
--- /opt/ros/melodic/share/std_msgs/msg/UInt16MultiArray.msg 2019-03-04 16:10:49.000000000 -0800
+++ /opt/ros/eloquent/share/std_msgs/msg/UInt16MultiArray.msg 2019-10-23 15:06:12.000000000 -0700
@@ -3,4 +3,3 @@
MultiArrayLayout layout # specification of data layout
uint16[] data # array of data
-
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/std_msgs/msg/UInt32MultiArray.msg /opt/ros/eloquent/share/std_msgs/msg/UInt32MultiArray.msg
--- /opt/ros/melodic/share/std_msgs/msg/UInt32MultiArray.msg 2019-03-04 16:10:49.000000000 -0800
+++ /opt/ros/eloquent/share/std_msgs/msg/UInt32MultiArray.msg 2019-10-23 15:06:12.000000000 -0700
@@ -3,4 +3,3 @@
MultiArrayLayout layout # specification of data layout
uint32[] data # array of data
-
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/std_msgs/msg/UInt64MultiArray.msg /opt/ros/eloquent/share/std_msgs/msg/UInt64MultiArray.msg
--- /opt/ros/melodic/share/std_msgs/msg/UInt64MultiArray.msg 2019-03-04 16:10:49.000000000 -0800
+++ /opt/ros/eloquent/share/std_msgs/msg/UInt64MultiArray.msg 2019-10-23 15:06:12.000000000 -0700
@@ -3,4 +3,3 @@
MultiArrayLayout layout # specification of data layout
uint64[] data # array of data
-
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/std_msgs/msg/UInt8MultiArray.msg /opt/ros/eloquent/share/std_msgs/msg/UInt8MultiArray.msg
--- /opt/ros/melodic/share/std_msgs/msg/UInt8MultiArray.msg 2019-03-04 16:10:49.000000000 -0800
+++ /opt/ros/eloquent/share/std_msgs/msg/UInt8MultiArray.msg 2019-10-23 15:06:12.000000000 -0700
@@ -3,4 +3,3 @@
MultiArrayLayout layout # specification of data layout
uint8[] data # array of data
-
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/stereo_msgs/msg/DisparityImage.msg /opt/ros/eloquent/share/stereo_msgs/msg/DisparityImage.msg
--- /opt/ros/melodic/share/stereo_msgs/msg/DisparityImage.msg 2018-11-06 23:15:51.000000000 -0800
+++ /opt/ros/eloquent/share/stereo_msgs/msg/DisparityImage.msg 2019-10-23 15:06:09.000000000 -0700
@@ -1,6 +1,6 @@
# Separate header for compatibility with current TimeSynchronizer.
# Likely to be removed in a later release, use image.header instead.
-Header header
+std_msgs/Header header
# Floating point disparity image. The disparities are pre-adjusted for any
# x-offset between the principal points of the two cameras (in the case
@@ -9,7 +9,7 @@
# Stereo geometry. For disparity d, the depth from the camera is Z = fT/d.
float32 f # Focal length, pixels
-float32 T # Baseline, world units
+float32 t # Baseline, world units
# Subwindow of (potentially) valid disparity values.
sensor_msgs/RegionOfInterest valid_window
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/trajectory_msgs/msg/JointTrajectory.msg /opt/ros/eloquent/share/trajectory_msgs/msg/JointTrajectory.msg
--- /opt/ros/melodic/share/trajectory_msgs/msg/JointTrajectory.msg 2018-11-06 23:15:55.000000000 -0800
+++ /opt/ros/eloquent/share/trajectory_msgs/msg/JointTrajectory.msg 2019-10-23 15:06:24.000000000 -0700
@@ -1,3 +1,3 @@
-Header header
+std_msgs/Header header
string[] joint_names
JointTrajectoryPoint[] points
\ No newline at end of file
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/trajectory_msgs/msg/JointTrajectoryPoint.msg /opt/ros/eloquent/share/trajectory_msgs/msg/JointTrajectoryPoint.msg
--- /opt/ros/melodic/share/trajectory_msgs/msg/JointTrajectoryPoint.msg 2018-11-06 23:15:55.000000000 -0800
+++ /opt/ros/eloquent/share/trajectory_msgs/msg/JointTrajectoryPoint.msg 2019-10-23 15:06:24.000000000 -0700
@@ -1,9 +1,9 @@
# Each trajectory point specifies either positions[, velocities[, accelerations]]
# or positions[, effort] for the trajectory to be executed.
-# All specified values are in the same order as the joint names in JointTrajectory.msg
+# All specified values are in the same order as the joint names in JointTrajectory.msg.
float64[] positions
float64[] velocities
float64[] accelerations
float64[] effort
-duration time_from_start
+builtin_interfaces/Duration time_from_start
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/trajectory_msgs/msg/MultiDOFJointTrajectory.msg /opt/ros/eloquent/share/trajectory_msgs/msg/MultiDOFJointTrajectory.msg
--- /opt/ros/melodic/share/trajectory_msgs/msg/MultiDOFJointTrajectory.msg 2018-11-06 23:15:55.000000000 -0800
+++ /opt/ros/eloquent/share/trajectory_msgs/msg/MultiDOFJointTrajectory.msg 2019-10-23 15:06:24.000000000 -0700
@@ -1,5 +1,5 @@
# The header is used to specify the coordinate frame and the reference time for the trajectory durations
-Header header
+std_msgs/Header header
# A representation of a multi-dof joint trajectory (each point is a transformation)
# Each point along the trajectory will include an array of positions/velocities/accelerations
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/trajectory_msgs/msg/MultiDOFJointTrajectoryPoint.msg /opt/ros/eloquent/share/trajectory_msgs/msg/MultiDOFJointTrajectoryPoint.msg
--- /opt/ros/melodic/share/trajectory_msgs/msg/MultiDOFJointTrajectoryPoint.msg 2018-11-06 23:15:55.000000000 -0800
+++ /opt/ros/eloquent/share/trajectory_msgs/msg/MultiDOFJointTrajectoryPoint.msg 2019-10-23 15:06:24.000000000 -0700
@@ -1,10 +1,10 @@
-# Each multi-dof joint can specify a transform (up to 6 DOF)
+# Each multi-dof joint can specify a transform (up to 6 DOF).
geometry_msgs/Transform[] transforms
-# There can be a velocity specified for the origin of the joint
+# There can be a velocity specified for the origin of the joint.
geometry_msgs/Twist[] velocities
-# There can be an acceleration specified for the origin of the joint
+# There can be an acceleration specified for the origin of the joint.
geometry_msgs/Twist[] accelerations
-duration time_from_start
+builtin_interfaces/Duration time_from_start
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/visualization_msgs/msg/ImageMarker.msg /opt/ros/eloquent/share/visualization_msgs/msg/ImageMarker.msg
--- /opt/ros/melodic/share/visualization_msgs/msg/ImageMarker.msg 2018-11-06 23:16:00.000000000 -0800
+++ /opt/ros/eloquent/share/visualization_msgs/msg/ImageMarker.msg 2019-10-23 15:06:13.000000000 -0700
@@ -7,18 +7,30 @@
uint8 ADD=0
uint8 REMOVE=1
-Header header
-string ns # namespace, used with id to form a unique id
-int32 id # unique id within the namespace
-int32 type # CIRCLE/LINE_STRIP/etc.
-int32 action # ADD/REMOVE
-geometry_msgs/Point position # 2D, in pixel-coords
-float32 scale # the diameter for a circle, etc.
+std_msgs/Header header
+# Namespace which is used with the id to form a unique id.
+string ns
+# Unique id within the namespace.
+int32 id
+# One of the above types, e.g. CIRCLE, LINE_STRIP, etc.
+int32 type
+# Either ADD or REMOVE.
+int32 action
+# Two-dimensional coordinate position, in pixel-coordinates.
+geometry_msgs/Point position
+# The scale of the object, e.g. the diameter for a CIRCLE.
+float32 scale
+# The outline color of the marker.
std_msgs/ColorRGBA outline_color
-uint8 filled # whether to fill in the shape with color
-std_msgs/ColorRGBA fill_color # color [0.0-1.0]
-duration lifetime # How long the object should last before being automatically deleted. 0 means forever
+# Whether or not to fill in the shape with color.
+uint8 filled
+# Fill color; in the range: [0.0-1.0]
+std_msgs/ColorRGBA fill_color
+# How long the object should last before being automatically deleted.
+# 0 indicates forever.
+builtin_interfaces/Duration lifetime
-
-geometry_msgs/Point[] points # used for LINE_STRIP/LINE_LIST/POINTS/etc., 2D in pixel coords
-std_msgs/ColorRGBA[] outline_colors # a color for each line, point, etc.
\ No newline at end of file
+# Coordinates in 2D in pixel coords. Used for LINE_STRIP, LINE_LIST, POINTS, etc.
+geometry_msgs/Point[] points
+# The color for each line, point, etc. in the points field.
+std_msgs/ColorRGBA[] outline_colors
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/visualization_msgs/msg/InteractiveMarkerFeedback.msg /opt/ros/eloquent/share/visualization_msgs/msg/InteractiveMarkerFeedback.msg
--- /opt/ros/melodic/share/visualization_msgs/msg/InteractiveMarkerFeedback.msg 2018-11-06 23:16:00.000000000 -0800
+++ /opt/ros/eloquent/share/visualization_msgs/msg/InteractiveMarkerFeedback.msg 2019-10-23 15:06:13.000000000 -0700
@@ -1,5 +1,6 @@
+
# Time/frame info.
-Header header
+std_msgs/Header header
# Identifying string. Must be unique in the topic namespace.
string client_id
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/visualization_msgs/msg/InteractiveMarkerInit.msg /opt/ros/eloquent/share/visualization_msgs/msg/InteractiveMarkerInit.msg
--- /opt/ros/melodic/share/visualization_msgs/msg/InteractiveMarkerInit.msg 2018-11-06 23:16:00.000000000 -0800
+++ /opt/ros/eloquent/share/visualization_msgs/msg/InteractiveMarkerInit.msg 2019-10-23 15:06:13.000000000 -0700
@@ -1,3 +1,4 @@
+
# Identifying string. Must be unique in the topic namespace
# that this server works on.
string server_id
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/visualization_msgs/msg/InteractiveMarker.msg /opt/ros/eloquent/share/visualization_msgs/msg/InteractiveMarker.msg
--- /opt/ros/melodic/share/visualization_msgs/msg/InteractiveMarker.msg 2018-11-06 23:16:00.000000000 -0800
+++ /opt/ros/eloquent/share/visualization_msgs/msg/InteractiveMarker.msg 2019-10-23 15:06:13.000000000 -0700
@@ -1,10 +1,11 @@
+
# Time/frame info.
# If header.time is set to 0, the marker will be retransformed into
# its frame on each timestep. You will receive the pose feedback
# in the same frame.
# Otherwise, you might receive feedback in a different frame.
# For rviz, this will be the current 'fixed frame' set by the user.
-Header header
+std_msgs/Header header
# Initial pose. Also, defines the pivot point for rotations.
geometry_msgs/Pose pose
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/visualization_msgs/msg/InteractiveMarkerPose.msg /opt/ros/eloquent/share/visualization_msgs/msg/InteractiveMarkerPose.msg
--- /opt/ros/melodic/share/visualization_msgs/msg/InteractiveMarkerPose.msg 2018-11-06 23:16:00.000000000 -0800
+++ /opt/ros/eloquent/share/visualization_msgs/msg/InteractiveMarkerPose.msg 2019-10-23 15:06:13.000000000 -0700
@@ -1,5 +1,6 @@
+
# Time/frame info.
-Header header
+std_msgs/Header header
# Initial pose. Also, defines the pivot point for rotations.
geometry_msgs/Pose pose
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/visualization_msgs/msg/InteractiveMarkerUpdate.msg /opt/ros/eloquent/share/visualization_msgs/msg/InteractiveMarkerUpdate.msg
--- /opt/ros/melodic/share/visualization_msgs/msg/InteractiveMarkerUpdate.msg 2018-11-06 23:16:00.000000000 -0800
+++ /opt/ros/eloquent/share/visualization_msgs/msg/InteractiveMarkerUpdate.msg 2019-10-23 15:06:13.000000000 -0700
@@ -1,3 +1,4 @@
+
# Identifying string. Must be unique in the topic namespace
# that this server works on.
string server_id
@@ -18,14 +19,14 @@
uint8 type
-#Note: No guarantees on the order of processing.
+# Note: No guarantees on the order of processing.
# Contents must be kept consistent by sender.
-#Markers to be added or updated
+# Markers to be added or updated
InteractiveMarker[] markers
-#Poses of markers that should be moved
+# Poses of markers that should be moved
InteractiveMarkerPose[] poses
-#Names of markers to be erased
+# Names of markers to be erased
string[] erases
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/visualization_msgs/msg/Marker.msg /opt/ros/eloquent/share/visualization_msgs/msg/Marker.msg
--- /opt/ros/melodic/share/visualization_msgs/msg/Marker.msg 2018-11-06 23:16:00.000000000 -0800
+++ /opt/ros/eloquent/share/visualization_msgs/msg/Marker.msg 2019-10-23 15:06:13.000000000 -0700
@@ -1,4 +1,8 @@
-# See http://www.ros.org/wiki/rviz/DisplayTypes/Marker and http://www.ros.org/wiki/rviz/Tutorials/Markers%3A%20Basic%20Shapes for more information on using this message with rviz
+# See:
+# - http://www.ros.org/wiki/rviz/DisplayTypes/Marker
+# - http://www.ros.org/wiki/rviz/Tutorials/Markers%3A%20Basic%20Shapes
+#
+# for more information on using this message with rviz.
uint8 ARROW=0
uint8 CUBE=1
@@ -18,27 +22,43 @@
uint8 DELETE=2
uint8 DELETEALL=3
-Header header # header for time/frame information
-string ns # Namespace to place this object in... used in conjunction with id to create a unique name for the object
-int32 id # object ID useful in conjunction with the namespace for manipulating and deleting the object later
-int32 type # Type of object
-int32 action # 0 add/modify an object, 1 (deprecated), 2 deletes an object, 3 deletes all objects
-geometry_msgs/Pose pose # Pose of the object
-geometry_msgs/Vector3 scale # Scale of the object 1,1,1 means default (usually 1 meter square)
-std_msgs/ColorRGBA color # Color [0.0-1.0]
-duration lifetime # How long the object should last before being automatically deleted. 0 means forever
-bool frame_locked # If this marker should be frame-locked, i.e. retransformed into its frame every timestep
+# Header for timestamp and frame id.
+std_msgs/Header header
+# Namespace in which to place the object.
+# Used in conjunction with id to create a unique name for the object.
+string ns
+# Object ID used in conjunction with the namespace for manipulating and deleting the object later.
+int32 id
+# Type of object.
+int32 type
+# Action to take; one of:
+# - 0 add/modify an object
+# - 1 (deprecated)
+# - 2 deletes an object
+# - 3 deletes all objects
+int32 action
+# Pose of the object with respect the frame_id specified in the header.
+geometry_msgs/Pose pose
+# Scale of the object; 1,1,1 means default (usually 1 meter square).
+geometry_msgs/Vector3 scale
+# Color of the object; in the range: [0.0-1.0]
+std_msgs/ColorRGBA color
+# How long the object should last before being automatically deleted.
+# 0 indicates forever.
+builtin_interfaces/Duration lifetime
+# If this marker should be frame-locked, i.e. retransformed into its frame every timestep.
+bool frame_locked
-#Only used if the type specified has some use for them (eg. POINTS, LINE_STRIP, ...)
+# Only used if the type specified has some use for them (eg. POINTS, LINE_STRIP, etc.)
geometry_msgs/Point[] points
-#Only used if the type specified has some use for them (eg. POINTS, LINE_STRIP, ...)
-#number of colors must either be 0 or equal to the number of points
-#NOTE: alpha is not yet used
+# Only used if the type specified has some use for them (eg. POINTS, LINE_STRIP, etc.)
+# The number of colors provided must either be 0 or equal to the number of points provided.
+# NOTE: alpha is not yet used
std_msgs/ColorRGBA[] colors
-# NOTE: only used for text markers
+# Only used for text markers
string text
-# NOTE: only used for MESH_RESOURCE markers
+# Only used for MESH_RESOURCE markers.
string mesh_resource
bool mesh_use_embedded_materials
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/visualization_msgs/msg/MenuEntry.msg /opt/ros/eloquent/share/visualization_msgs/msg/MenuEntry.msg
--- /opt/ros/melodic/share/visualization_msgs/msg/MenuEntry.msg 2018-11-06 23:16:00.000000000 -0800
+++ /opt/ros/eloquent/share/visualization_msgs/msg/MenuEntry.msg 2019-10-23 15:06:13.000000000 -0700
@@ -1,5 +1,5 @@
# MenuEntry message.
-
+#
# Each InteractiveMarker message has an array of MenuEntry messages.
# A collection of MenuEntries together describe a
# menu/submenu/subsubmenu/etc tree, though they are stored in a flat
@@ -8,7 +8,7 @@
# ones with parent_id = 0. Menu entries are ordered within their
# level the same way they are ordered in the containing array. Parent
# entries must appear before their children.
-
+#
# Example:
# - id = 3
# parent_id = 0
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/rosgraph_msgs/msg/Clock.msg /opt/ros/eloquent/share/rosgraph_msgs/msg/Clock.msg
--- /opt/ros/melodic/share/rosgraph_msgs/msg/Clock.msg 2018-01-29 13:33:03.000000000 -0800
+++ /opt/ros/eloquent/share/rosgraph_msgs/msg/Clock.msg 2019-09-26 11:51:45.000000000 -0700
@@ -1,4 +1,3 @@
-# roslib/Clock is used for publishing simulated time in ROS.
# This message simply communicates the current time.
# For more information, see http://www.ros.org/wiki/Clock
-time clock
+builtin_interfaces/Time clock
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/nav_msgs/srv/GetMap.srv /opt/ros/eloquent/share/nav_msgs/srv/GetMap.srv
--- /opt/ros/melodic/share/nav_msgs/srv/GetMap.srv 2018-11-06 23:15:48.000000000 -0800
+++ /opt/ros/eloquent/share/nav_msgs/srv/GetMap.srv 2019-10-23 15:06:19.000000000 -0700
@@ -1,3 +1,3 @@
# Get the map as a nav_msgs/OccupancyGrid
---
-nav_msgs/OccupancyGrid map
+OccupancyGrid map
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/nav_msgs/srv/GetPlan.srv /opt/ros/eloquent/share/nav_msgs/srv/GetPlan.srv
--- /opt/ros/melodic/share/nav_msgs/srv/GetPlan.srv 2018-11-06 23:15:48.000000000 -0800
+++ /opt/ros/eloquent/share/nav_msgs/srv/GetPlan.srv 2019-10-23 15:06:19.000000000 -0700
@@ -10,4 +10,4 @@
# relax the constraint in x and y before failing.
float32 tolerance
---
-nav_msgs/Path plan
+Path plan
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/sensor_msgs/srv/SetCameraInfo.srv /opt/ros/eloquent/share/sensor_msgs/srv/SetCameraInfo.srv
--- /opt/ros/melodic/share/sensor_msgs/srv/SetCameraInfo.srv 2018-11-06 23:15:56.000000000 -0800
+++ /opt/ros/eloquent/share/sensor_msgs/srv/SetCameraInfo.srv 2019-10-23 15:06:18.000000000 -0700
@@ -1,5 +1,5 @@
-# This service requests that a camera stores the given CameraInfo
-# as that camera's calibration information.
+# This service requests that a camera stores the given CameraInfo as that
+# camera's calibration information.
#
# The width and height in the camera_info field should match what the
# camera is currently outputting on its camera_info topic, and the camera
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/map_msgs/srv/ProjectedMapsInfo.srv /opt/ros/eloquent/share/map_msgs/srv/ProjectedMapsInfo.srv
--- /opt/ros/melodic/share/map_msgs/srv/ProjectedMapsInfo.srv 2018-03-19 20:16:09.000000000 -0700
+++ /opt/ros/eloquent/share/map_msgs/srv/ProjectedMapsInfo.srv 2019-09-30 11:22:10.000000000 -0700
@@ -1 +1,2 @@
map_msgs/ProjectedMapInfo[] projected_maps_info
+---
diff -ub -x '*.idl' -x 'ddx*' /opt/ros/melodic/share/map_msgs/srv/SaveMap.srv /opt/ros/eloquent/share/map_msgs/srv/SaveMap.srv
--- /opt/ros/melodic/share/map_msgs/srv/SaveMap.srv 2018-03-19 20:16:09.000000000 -0700
+++ /opt/ros/eloquent/share/map_msgs/srv/SaveMap.srv 2019-09-30 11:22:10.000000000 -0700
@@ -1,2 +1,3 @@
# Save the map to the filesystem
std_msgs/String filename
+---
#!/bin/bash
set -o errexit
for PACKAGE in sensor_msgs geometry_msgs actionlib_msgs diagnostic_msgs nav_msgs shape_msgs std_msgs stereo_msgs trajectory_msgs visualization_msgs rosgraph_msgs
do
diff /opt/ros/melodic/share/$PACKAGE/msg /opt/ros/eloquent/share/$PACKAGE/msg/ -ub -x *.idl -x ddx* || true
done
for PACKAGE in diagnostic_msgs nav_msgs sensor_msgs std_srvs map_msgs
do
diff /opt/ros/melodic/share/$PACKAGE/srv /opt/ros/eloquent/share/$PACKAGE/srv -ub -x *.idl -x ddx* || true
done
Sign up for free to join this conversation on GitHub. Already have an account? Sign in to comment