Built-in Message Type
Last updated
Last updated
The built-in message types are defined in the package. This page collect all the built-in message types in the Humble distribution.
------------------------------------------------------------
Message Type: stereo_msgs/DisparityImage.msg
------------------------------------------------------------
# Separate header for compatibility with current TimeSynchronizer.
# Likely to be removed in a later release, use image.header instead.
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
# that they are verged). That is: d = x_l - x_r - (cx_l - cx_r)
sensor_msgs/Image image
# Stereo geometry. For disparity d, the depth from the camera is Z = fT/d.
float32 f # Focal length, pixels
float32 t # Baseline, world units
# Subwindow of (potentially) valid disparity values.
sensor_msgs/RegionOfInterest valid_window
# The range of disparities searched.
# In the disparity image, any disparity less than min_disparity is invalid.
# The disparity search range defines the horopter, or 3D volume that the
# stereo algorithm can "see". Points with Z outside of:
# Z_min = fT / max_disparity
# Z_max = fT / min_disparity
# could not be found.
float32 min_disparity
float32 max_disparity
# Smallest allowed disparity increment. The smallest achievable depth range
# resolution is delta_Z = (Z^2/fT)*delta_d.
float32 delta_d
------------------------------------------------------------
Message Type: nav_msgs/MapMetaData.msg
------------------------------------------------------------
# This hold basic information about the characteristics of the OccupancyGrid
# The time at which the map was loaded
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
# bottom left corner of cell (0,0) in the map.
geometry_msgs/Pose origin
------------------------------------------------------------
Message Type: nav_msgs/Path.msg
------------------------------------------------------------
# An array of poses that represents a Path for a robot to follow.
# Indicates the frame_id of the path.
std_msgs/Header header
# Array of poses to follow.
geometry_msgs/PoseStamped[] poses
------------------------------------------------------------
Message Type: nav_msgs/Odometry.msg
------------------------------------------------------------
# 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 twist in this message should be specified in the coordinate frame given by the child_frame_id
# Includes the frame id of the pose parent.
std_msgs/Header header
# Frame id the pose points to. The twist is in this coordinate frame.
string child_frame_id
# Estimated pose that is typically relative to a fixed world frame.
geometry_msgs/PoseWithCovariance pose
# Estimated linear and angular velocity relative to child_frame_id.
geometry_msgs/TwistWithCovariance twist
------------------------------------------------------------
Message Type: nav_msgs/OccupancyGrid.msg
------------------------------------------------------------
# This represents a 2-D grid map
std_msgs/Header header
# MetaData for the map
MapMetaData info
# The map data, in row-major order, starting with (0,0).
# Cell (1, 0) will be listed second, representing the next cell in the x direction.
# Cell (0, 1) will be at the index equal to info.width, followed by (1, 1).
# The values inside are application dependent, but frequently,
# 0 represents unoccupied, 1 represents definitely occupied, and
# -1 represents unknown.
int8[] data
------------------------------------------------------------
Message Type: nav_msgs/GridCells.msg
------------------------------------------------------------
# An array of cells in a 2D grid
std_msgs/Header header
# Width of each cell
float32 cell_width
# Height of each cell
float32 cell_height
# Each cell is represented by the Point at the center of the cell
geometry_msgs/Point[] cells
------------------------------------------------------------
Message Type: visualization_msgs/InteractiveMarker.msg
------------------------------------------------------------
# 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.
std_msgs/Header header
# Initial pose. Also, defines the pivot point for rotations.
geometry_msgs/Pose pose
# Identifying string. Must be globally unique in
# the topic that this message is sent through.
string name
# Short description (< 40 characters).
string description
# Scale to be used for default controls (default=1).
float32 scale
# All menu and submenu entries associated with this marker.
MenuEntry[] menu_entries
# List of controls displayed for this marker.
InteractiveMarkerControl[] controls
------------------------------------------------------------
Message Type: visualization_msgs/MarkerArray.msg
------------------------------------------------------------
Marker[] markers
------------------------------------------------------------
Message Type: visualization_msgs/MeshFile.msg
------------------------------------------------------------
# Used to send raw mesh files.
# The filename is used for both debug purposes and to provide a file extension
# for whatever parser is used.
string filename
# This stores the raw text of the mesh file.
uint8[] data
------------------------------------------------------------
Message Type: visualization_msgs/UVCoordinate.msg
------------------------------------------------------------
# Location of the pixel as a ratio of the width of a 2D texture.
# Values should be in range: [0.0-1.0].
float32 u
float32 v
------------------------------------------------------------
Message Type: visualization_msgs/MenuEntry.msg
------------------------------------------------------------
# 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
# array. The tree structure is represented by giving each menu entry
# an ID number and a "parent_id" field. Top-level entries are the
# 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
# title = "fun"
# - id = 2
# parent_id = 0
# title = "robot"
# - id = 4
# parent_id = 2
# title = "pr2"
# - id = 5
# parent_id = 2
# title = "turtle"
#
# Gives a menu tree like this:
# - fun
# - robot
# - pr2
# - turtle
# ID is a number for each menu entry. Must be unique within the
# control, and should never be 0.
uint32 id
# ID of the parent of this menu entry, if it is a submenu. If this
# menu entry is a top-level entry, set parent_id to 0.
uint32 parent_id
# menu / entry title
string title
# Arguments to command indicated by command_type (below)
string command
# Command_type stores the type of response desired when this menu
# entry is clicked.
# FEEDBACK: send an InteractiveMarkerFeedback message with menu_entry_id set to this entry's id.
# ROSRUN: execute "rosrun" with arguments given in the command field (above).
# ROSLAUNCH: execute "roslaunch" with arguments given in the command field (above).
uint8 FEEDBACK=0
uint8 ROSRUN=1
uint8 ROSLAUNCH=2
uint8 command_type
------------------------------------------------------------
Message Type: visualization_msgs/InteractiveMarkerControl.msg
------------------------------------------------------------
# Represents a control that is to be displayed together with an interactive marker
# Identifying string for this control.
# You need to assign a unique value to this to receive feedback from the GUI
# on what actions the user performs on this control (e.g. a button click).
string name
# Defines the local coordinate frame (relative to the pose of the parent
# interactive marker) in which is being rotated and translated.
# Default: Identity
geometry_msgs/Quaternion orientation
# Orientation mode: controls how orientation changes.
# INHERIT: Follow orientation of interactive marker
# FIXED: Keep orientation fixed at initial state
# VIEW_FACING: Align y-z plane with screen (x: forward, y:left, z:up).
uint8 INHERIT = 0
uint8 FIXED = 1
uint8 VIEW_FACING = 2
uint8 orientation_mode
# Interaction mode for this control
#
# NONE: This control is only meant for visualization; no context menu.
# MENU: Like NONE, but right-click menu is active.
# BUTTON: Element can be left-clicked.
# MOVE_AXIS: Translate along local x-axis.
# MOVE_PLANE: Translate in local y-z plane.
# ROTATE_AXIS: Rotate around local x-axis.
# MOVE_ROTATE: Combines MOVE_PLANE and ROTATE_AXIS.
uint8 NONE = 0
uint8 MENU = 1
uint8 BUTTON = 2
uint8 MOVE_AXIS = 3
uint8 MOVE_PLANE = 4
uint8 ROTATE_AXIS = 5
uint8 MOVE_ROTATE = 6
# "3D" interaction modes work with the mouse+SHIFT+CTRL or with 3D cursors.
# MOVE_3D: Translate freely in 3D space.
# ROTATE_3D: Rotate freely in 3D space about the origin of parent frame.
# MOVE_ROTATE_3D: Full 6-DOF freedom of translation and rotation about the cursor origin.
uint8 MOVE_3D = 7
uint8 ROTATE_3D = 8
uint8 MOVE_ROTATE_3D = 9
uint8 interaction_mode
# If true, the contained markers will also be visible
# when the gui is not in interactive mode.
bool always_visible
# Markers to be displayed as custom visual representation.
# Leave this empty to use the default control handles.
#
# Note:
# - The markers can be defined in an arbitrary coordinate frame,
# but will be transformed into the local frame of the interactive marker.
# - If the header of a marker is empty, its pose will be interpreted as
# relative to the pose of the parent interactive marker.
Marker[] markers
# In VIEW_FACING mode, set this to true if you don't want the markers
# to be aligned with the camera view point. The markers will show up
# as in INHERIT mode.
bool independent_marker_orientation
# Short description (< 40 characters) of what this control does,
# e.g. "Move the robot".
# Default: A generic description based on the interaction mode
string description
------------------------------------------------------------
Message Type: visualization_msgs/InteractiveMarkerPose.msg
------------------------------------------------------------
# Time/frame info.
std_msgs/Header header
# Initial pose. Also, defines the pivot point for rotations.
geometry_msgs/Pose pose
# Identifying string. Must be globally unique in
# the topic that this message is sent through.
string name
------------------------------------------------------------
Message Type: visualization_msgs/Marker.msg
------------------------------------------------------------
# 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.
int32 ARROW=0
int32 CUBE=1
int32 SPHERE=2
int32 CYLINDER=3
int32 LINE_STRIP=4
int32 LINE_LIST=5
int32 CUBE_LIST=6
int32 SPHERE_LIST=7
int32 POINTS=8
int32 TEXT_VIEW_FACING=9
int32 MESH_RESOURCE=10
int32 TRIANGLE_LIST=11
int32 ADD=0
int32 MODIFY=0
int32 DELETE=2
int32 DELETEALL=3
# 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 (with the given ns and id)
# - 3 deletes all objects (or those with the given ns if any)
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, etc.)
geometry_msgs/Point[] points
# 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
# Texture resource is a special URI that can either reference a texture file in
# a format acceptable to (resource retriever)[https://index.ros.org/p/resource_retriever/]
# or an embedded texture via a string matching the format:
# "embedded://texture_name"
string texture_resource
# An image to be loaded into the rendering engine as the texture for this marker.
# This will be used iff texture_resource is set to embedded.
sensor_msgs/CompressedImage texture
# Location of each vertex within the texture; in the range: [0.0-1.0]
UVCoordinate[] uv_coordinates
# Only used for text markers
string text
# Only used for MESH_RESOURCE markers.
# Similar to texture_resource, mesh_resource uses resource retriever to load a mesh.
# Optionally, a mesh file can be sent in-message via the mesh_file field. If doing so,
# use the following format for mesh_resource:
# "embedded://mesh_name"
string mesh_resource
MeshFile mesh_file
bool mesh_use_embedded_materials
------------------------------------------------------------
Message Type: visualization_msgs/InteractiveMarkerUpdate.msg
------------------------------------------------------------
# Identifying string. Must be unique in the topic namespace
# that this server works on.
string server_id
# Sequence number.
# The client will use this to detect if it has missed an update.
uint64 seq_num
# Type holds the purpose of this message. It must be one of UPDATE or KEEP_ALIVE.
# UPDATE: Incremental update to previous state.
# The sequence number must be 1 higher than for
# the previous update.
# KEEP_ALIVE: Indicates the that the server is still living.
# The sequence number does not increase.
# No payload data should be filled out (markers, poses, or erases).
uint8 KEEP_ALIVE = 0
uint8 UPDATE = 1
uint8 type
# Note: No guarantees on the order of processing.
# Contents must be kept consistent by sender.
# Markers to be added or updated
InteractiveMarker[] markers
# Poses of markers that should be moved
InteractiveMarkerPose[] poses
# Names of markers to be erased
string[] erases
------------------------------------------------------------
Message Type: visualization_msgs/ImageMarker.msg
------------------------------------------------------------
int32 CIRCLE=0
int32 LINE_STRIP=1
int32 LINE_LIST=2
int32 POLYGON=3
int32 POINTS=4
int32 ADD=0
int32 REMOVE=1
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
# 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
# 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
------------------------------------------------------------
Message Type: visualization_msgs/InteractiveMarkerInit.msg
------------------------------------------------------------
# Identifying string. Must be unique in the topic namespace
# that this server works on.
string server_id
# Sequence number.
# The client will use this to detect if it has missed a subsequent
# update. Every update message will have the same sequence number as
# an init message. Clients will likely want to unsubscribe from the
# init topic after a successful initialization to avoid receiving
# duplicate data.
uint64 seq_num
# All markers.
InteractiveMarker[] markers
------------------------------------------------------------
Message Type: visualization_msgs/InteractiveMarkerFeedback.msg
------------------------------------------------------------
# Time/frame info.
std_msgs/Header header
# Identifying string. Must be unique in the topic namespace.
string client_id
# Feedback message sent back from the GUI, e.g.
# when the status of an interactive marker was modified by the user.
# Specifies which interactive marker and control this message refers to
string marker_name
string control_name
# Type of the event
# KEEP_ALIVE: sent while dragging to keep up control of the marker
# MENU_SELECT: a menu entry has been selected
# BUTTON_CLICK: a button control has been clicked
# POSE_UPDATE: the pose has been changed using one of the controls
uint8 KEEP_ALIVE = 0
uint8 POSE_UPDATE = 1
uint8 MENU_SELECT = 2
uint8 BUTTON_CLICK = 3
uint8 MOUSE_DOWN = 4
uint8 MOUSE_UP = 5
uint8 event_type
# Current pose of the marker
# Note: Has to be valid for all feedback types.
geometry_msgs/Pose pose
# Contains the ID of the selected menu entry
# Only valid for MENU_SELECT events.
uint32 menu_entry_id
# If event_type is BUTTON_CLICK, MOUSE_DOWN, or MOUSE_UP, mouse_point
# may contain the 3 dimensional position of the event on the
# control. If it does, mouse_point_valid will be true. mouse_point
# will be relative to the frame listed in the header.
geometry_msgs/Point mouse_point
bool mouse_point_valid
------------------------------------------------------------
Message Type: sensor_msgs/Image.msg
------------------------------------------------------------
# This message contains an uncompressed image
# (0, 0) is at top-left corner 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 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
# If the frame_id here and the frame_id of the CameraInfo
# message associated with the image conflict
# the behavior is undefined
uint32 height # image height, that is, number of rows
uint32 width # image width, that is, number of columns
# 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.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.hpp
uint8 is_bigendian # is this data bigendian?
uint32 step # Full row length in bytes
uint8[] data # actual matrix data, size is (step * rows)
------------------------------------------------------------
Message Type: sensor_msgs/CameraInfo.msg
------------------------------------------------------------
# This message defines meta information for a camera. It should be in a
# camera namespace on topic "camera_info" and accompanied by up to five
# image topics named:
#
# image_raw - raw data from the camera driver, possibly Bayer encoded
# image - monochrome, distorted
# image_color - color, distorted
# image_rect - monochrome, rectified
# image_rect_color - color, rectified
#
# The image_pipeline contains packages (image_proc, stereo_image_proc)
# for producing the four processed image topics from image_raw and
# camera_info. The meaning of the camera parameters are described in
# detail at http://www.ros.org/wiki/image_pipeline/CameraInfo.
#
# The image_geometry package provides a user-friendly interface to
# common operations using this meta information. If you want to, e.g.,
# project a 3d point into image coordinates, we strongly recommend
# using image_geometry.
#
# If the camera is uncalibrated, the matrices D, K, R, P should be left
# zeroed out. In particular, clients may assume that K[0] == 0.0
# indicates an uncalibrated camera.
#######################################################################
# Image acquisition info #
#######################################################################
# Time of image acquisition, camera coordinate frame ID
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
# +y should point down in the image
# +z should point into the plane of the image
#######################################################################
# Calibration Parameters #
#######################################################################
# These are fixed during camera calibration. Their values will be the #
# same in all messages until the camera is recalibrated. Note that #
# self-calibrating systems may "recalibrate" frequently. #
# #
# The internal parameters can be used to warp a raw (distorted) image #
# to: #
# 1. An undistorted image (requires D and K) #
# 2. A rectified image (requires D, K, R) #
# 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.
uint32 height
uint32 width
# The distortion model used. Supported models are listed in
# 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
# Intrinsic camera matrix for the raw (distorted) images.
# [fx 0 cx]
# K = [ 0 fy cy]
# [ 0 0 1]
# 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
# 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
# Projection/camera matrix
# [fx' 0 cx' Tx]
# P = [ 0 fy' cy' Ty]
# [ 0 0 1 0]
# By convention, this matrix specifies the intrinsic (camera) matrix
# of the processed (rectified) image. That is, the left 3x3 portion
# is the normal camera intrinsic matrix for the rectified image.
# It projects 3D points in the camera coordinate frame to 2D pixel
# coordinates using the focal lengths (fx', fy') and principal point
# (cx', cy') - these may differ from the values in K.
# For monocular cameras, Tx = Ty = 0. Normally, monocular cameras will
# also have R = the identity and P[1:3,1:3] = K.
# For a stereo pair, the fourth column [Tx Ty 0]' is related to the
# position of the optical center of the second camera in the first
# camera's frame. We assume Tz = 0 so both cameras are in the same
# stereo image plane. The first camera always has Tx = Ty = 0. For
# the right (second) camera of a horizontal stereo pair, Ty = 0 and
# Tx = -fx' * B, where B is the baseline between the cameras.
# Given a 3D point [X Y Z]', the projection (x, y) of the point onto
# the rectified image is given by:
# [u v w]' = P * [X Y Z 1]'
# x = u / w
# y = v / w
# This holds for both images of a stereo pair.
float64[12] p # 3x4 row-major matrix
#######################################################################
# Operational Parameters #
#######################################################################
# These define the image region actually captured by the camera #
# driver. Although they affect the geometry of the output image, they #
# may be changed freely without recalibrating the camera. #
#######################################################################
# Binning refers here to any camera setting which combines rectangular
# neighborhoods of pixels into larger "super-pixels." It reduces the
# resolution of the output image to
# (width / binning_x) x (height / binning_y).
# The default values binning_x = binning_y = 0 is considered the same
# as binning_x = binning_y = 1 (no subsampling).
uint32 binning_x
uint32 binning_y
# Region of interest (subwindow of full camera resolution), given in
# full resolution (unbinned) image coordinates. A particular ROI
# always denotes the same window of pixels on the camera sensor,
# regardless of binning settings.
# The default setting of roi (all values 0) is considered the same as
# full resolution (roi.width = width, roi.height = height).
RegionOfInterest roi
------------------------------------------------------------
Message Type: sensor_msgs/Range.msg
------------------------------------------------------------
# Single range reading from an active ranger that emits energy and reports
# 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.
std_msgs/Header header # timestamp in the header is the time the ranger
# returned the distance reading
# Radiation type enums
# If you want a value added to this list, send an email to the ros-users list
uint8 ULTRASOUND=0
uint8 INFRARED=1
uint8 radiation_type # the type of radiation used by the sensor
# (sound, IR, etc) [enum]
float32 field_of_view # the size of the arc that the distance reading is
# valid for [rad]
# the object causing the range reading may have
# been anywhere within -field_of_view/2 and
# field_of_view/2 at the measured range.
# 0 angle corresponds to the x-axis of the sensor.
float32 min_range # minimum range value [m]
float32 max_range # maximum range value [m]
# Fixed distance rangers require min_range==max_range
float32 range # range data [m]
# (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)
# +Inf represents no detection within the fixed distance.
# (Object out of range)
------------------------------------------------------------
Message Type: sensor_msgs/LaserEcho.msg
------------------------------------------------------------
# This message is a submessage of MultiEchoLaserScan and is not intended
# to be used separately.
float32[] echoes # Multiple values of ranges or intensities.
# Each array represents data from the same angle increment.
------------------------------------------------------------
Message Type: sensor_msgs/PointCloud.msg
------------------------------------------------------------
## THIS MESSAGE IS DEPRECATED AS OF FOXY
## Please use sensor_msgs/PointCloud2
# This message holds a collection of 3d points, plus optional additional
# information about each point.
# Time of sensor data acquisition, coordinate frame ID.
std_msgs/Header header
# Array of 3d points. Each Point32 should be interpreted as a 3d point
# in the frame given in the header.
geometry_msgs/Point32[] points
# Each channel should have the same number of elements as points array,
# and the data in each channel should correspond 1:1 with each point.
# Channel names in common practice are listed in ChannelFloat32.msg.
ChannelFloat32[] channels
------------------------------------------------------------
Message Type: sensor_msgs/JoyFeedback.msg
------------------------------------------------------------
# Declare of the type of feedback
uint8 TYPE_LED = 0
uint8 TYPE_RUMBLE = 1
uint8 TYPE_BUZZER = 2
uint8 type
# This will hold an id number for each type of each feedback.
# Example, the first led would be id=0, the second would be id=1
uint8 id
# 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
------------------------------------------------------------
Message Type: sensor_msgs/MultiEchoLaserScan.msg
------------------------------------------------------------
# Single scan from a multi-echo planar laser range-finder
#
# If you have another ranging device with different behavior (e.g. a sonar
# array), please find or create a different message, since applications
# will make fairly laser-specific assumptions about this data
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
# the positive Z axis (counterclockwise, if Z is up)
# with zero angle being forward along the x axis
float32 angle_min # start angle of the scan [rad]
float32 angle_max # end angle of the scan [rad]
float32 angle_increment # angular distance between measurements [rad]
float32 time_increment # time between measurements [seconds] - if your scanner
# is moving, this will be used in interpolating position
# of 3d points
float32 scan_time # time between scans [seconds]
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)
# +Inf measurements are out of range
# -Inf measurements are too close to determine exact distance.
LaserEcho[] intensities # intensity data [device-specific units]. If your
# device does not provide intensities, please leave
# the array empty.
------------------------------------------------------------
Message Type: sensor_msgs/Illuminance.msg
------------------------------------------------------------
# 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.
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 variance # 0 is interpreted as variance unknown
------------------------------------------------------------
Message Type: sensor_msgs/CompressedImage.msg
------------------------------------------------------------
# This message contains a compressed 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 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
string format # Specifies the format of the data
# Acceptable values:
# jpeg, png, tiff
uint8[] data # Compressed image buffer
------------------------------------------------------------
Message Type: sensor_msgs/TimeReference.msg
------------------------------------------------------------
# Measurement from an external time source not actively synchronized with the system clock.
std_msgs/Header header # stamp is system time for which measurement was valid
# frame_id is not used
builtin_interfaces/Time time_ref # corresponding time from this external source
string source # (optional) name of time source
------------------------------------------------------------
Message Type: sensor_msgs/PointCloud2.msg
------------------------------------------------------------
# This message holds a collection of N-dimensional points, which may
# 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.
# 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.
uint32 height
uint32 width
# Describes the channels and their layout in the binary data blob.
PointField[] fields
bool is_bigendian # Is this data bigendian?
uint32 point_step # Length of a point in bytes
uint32 row_step # Length of a row in bytes
uint8[] data # Actual point data, size is (row_step*height)
bool is_dense # True if there are no invalid points
------------------------------------------------------------
Message Type: sensor_msgs/ChannelFloat32.msg
------------------------------------------------------------
# This message is used by the PointCloud message to hold optional data
# associated with each point in the cloud. The length of the values
# 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
# historical reasons. The newer PointCloud2 message has no
# such problem.
# "rgb" - For point clouds produced by color stereo cameras. uint8
# (R,G,B) values packed into the least significant 24 bits,
# in order.
# "intensity" - laser or pixel intensity.
# "distance"
# The channel name should give semantics of the channel (e.g.
# "intensity" instead of "value").
string name
# The values array should be 1-1 with the elements of the associated
# PointCloud.
float32[] values
------------------------------------------------------------
Message Type: sensor_msgs/RelativeHumidity.msg
------------------------------------------------------------
# Single reading from a relative humidity sensor.
# Defines the ratio of partial pressure of water vapor to the saturated vapor
# pressure at a temperature.
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
# 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
------------------------------------------------------------
Message Type: sensor_msgs/RegionOfInterest.msg
------------------------------------------------------------
# This message is used to specify a region of interest within an image.
#
# When used to specify the ROI setting of the camera when the image was
# taken, the height and width fields should either match the height and
# width fields for the associated image; or height = width = 0
# indicates that the full resolution image was captured.
uint32 x_offset # Leftmost pixel of the ROI
# (0 if the ROI includes the left edge of the image)
uint32 y_offset # Topmost pixel of the ROI
# (0 if the ROI includes the top edge of the image)
uint32 height # Height of ROI
uint32 width # Width of ROI
# True if a distinct rectified ROI should be calculated from the "raw"
# ROI in this message. Typically this should be False if the full image
# is captured (ROI not used), and True if a subwindow is captured (ROI
# used).
bool do_rectify
------------------------------------------------------------
Message Type: sensor_msgs/JointState.msg
------------------------------------------------------------
# This is a message that holds data to describe the state of a set of torque controlled joints.
#
# The state of each joint (revolute or prismatic) is defined by:
# * the position of the joint (rad or m),
# * the velocity of the joint (rad/s or m/s) and
# * the effort that is applied in the joint (Nm or N).
#
# Each joint is uniquely identified by its name
# The header specifies the time at which the joint states were recorded. All the joint states
# in one message have to be recorded at the same time.
#
# This message consists of a multiple arrays, one for each part of the joint state.
# The goal is to make each of the fields optional. When e.g. your joints have no
# effort associated with them, you can leave the effort array empty.
#
# All arrays in this message should have the same size, or be empty.
# This is the only way to uniquely associate the joint name with the correct
# states.
std_msgs/Header header
string[] name
float64[] position
float64[] velocity
float64[] effort
------------------------------------------------------------
Message Type: sensor_msgs/BatteryState.msg
------------------------------------------------------------
# Constants are chosen to match the enums in the linux kernel
# defined in include/linux/power_supply.h as of version 3.7
# The one difference is for style reasons the constants are
# all uppercase not mixed case.
# Power supply status constants
uint8 POWER_SUPPLY_STATUS_UNKNOWN = 0
uint8 POWER_SUPPLY_STATUS_CHARGING = 1
uint8 POWER_SUPPLY_STATUS_DISCHARGING = 2
uint8 POWER_SUPPLY_STATUS_NOT_CHARGING = 3
uint8 POWER_SUPPLY_STATUS_FULL = 4
# Power supply health constants
uint8 POWER_SUPPLY_HEALTH_UNKNOWN = 0
uint8 POWER_SUPPLY_HEALTH_GOOD = 1
uint8 POWER_SUPPLY_HEALTH_OVERHEAT = 2
uint8 POWER_SUPPLY_HEALTH_DEAD = 3
uint8 POWER_SUPPLY_HEALTH_OVERVOLTAGE = 4
uint8 POWER_SUPPLY_HEALTH_UNSPEC_FAILURE = 5
uint8 POWER_SUPPLY_HEALTH_COLD = 6
uint8 POWER_SUPPLY_HEALTH_WATCHDOG_TIMER_EXPIRE = 7
uint8 POWER_SUPPLY_HEALTH_SAFETY_TIMER_EXPIRE = 8
# Power supply technology (chemistry) constants
uint8 POWER_SUPPLY_TECHNOLOGY_UNKNOWN = 0
uint8 POWER_SUPPLY_TECHNOLOGY_NIMH = 1
uint8 POWER_SUPPLY_TECHNOLOGY_LION = 2
uint8 POWER_SUPPLY_TECHNOLOGY_LIPO = 3
uint8 POWER_SUPPLY_TECHNOLOGY_LIFE = 4
uint8 POWER_SUPPLY_TECHNOLOGY_NICD = 5
uint8 POWER_SUPPLY_TECHNOLOGY_LIMN = 6
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)
float32 design_capacity # Capacity in Ah (design capacity) (If unmeasured NaN)
float32 percentage # Charge percentage on 0 to 1 range (If unmeasured NaN)
uint8 power_supply_status # The charging status as reported. Values defined above
uint8 power_supply_health # The battery health metric. Values defined above
uint8 power_supply_technology # The battery chemistry. Values defined above
bool present # True if the battery is present
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
------------------------------------------------------------
Message Type: sensor_msgs/NavSatFix.msg
------------------------------------------------------------
# Navigation Satellite fix for any Global Navigation Satellite System
#
# Specified using the WGS 84 reference ellipsoid
# header.stamp specifies the ROS time for this measurement (the
# corresponding satellite time may be reported using the
# sensor_msgs/TimeReference message).
#
# header.frame_id is the frame of reference reported by the satellite
# receiver, usually the location of the antenna. This is a
# Euclidean frame relative to the vehicle, not a reference
# ellipsoid.
std_msgs/Header header
# Satellite fix status information.
NavSatStatus status
# Latitude [degrees]. Positive is north of equator; negative is south.
float64 latitude
# Longitude [degrees]. Positive is east of prime meridian; negative is west.
float64 longitude
# Altitude [m]. Positive is above the WGS 84 ellipsoid
# (quiet NaN if no altitude is available).
float64 altitude
# Position covariance [m^2] defined relative to a tangential plane
# through the reported position. The components are East, North, and
# 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
# GPS receiver provides the variance of each measurement, put them
# along the diagonal. If only Dilution of Precision is available,
# estimate an approximate covariance from that.
uint8 COVARIANCE_TYPE_UNKNOWN = 0
uint8 COVARIANCE_TYPE_APPROXIMATED = 1
uint8 COVARIANCE_TYPE_DIAGONAL_KNOWN = 2
uint8 COVARIANCE_TYPE_KNOWN = 3
uint8 position_covariance_type
------------------------------------------------------------
Message Type: sensor_msgs/JoyFeedbackArray.msg
------------------------------------------------------------
# This message publishes values for multiple feedback at once.
JoyFeedback[] array
------------------------------------------------------------
Message Type: sensor_msgs/MagneticField.msg
------------------------------------------------------------
# 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.
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
# 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
# 0 is interpreted as variance unknown
------------------------------------------------------------
Message Type: sensor_msgs/PointField.msg
------------------------------------------------------------
# This message holds the description of one point entry in the
# PointCloud2 message format.
uint8 INT8 = 1
uint8 UINT8 = 2
uint8 INT16 = 3
uint8 UINT16 = 4
uint8 INT32 = 5
uint8 UINT32 = 6
uint8 FLOAT32 = 7
uint8 FLOAT64 = 8
# Common PointField names are x, y, z, intensity, rgb, rgba
string name # Name of field
uint32 offset # Offset from start of point struct
uint8 datatype # Datatype enumeration, see above
uint32 count # How many elements in the field
------------------------------------------------------------
Message Type: sensor_msgs/NavSatStatus.msg
------------------------------------------------------------
# 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.
int8 STATUS_NO_FIX = -1 # unable to fix position
int8 STATUS_FIX = 0 # unaugmented fix
int8 STATUS_SBAS_FIX = 1 # with satellite-based augmentation
int8 STATUS_GBAS_FIX = 2 # with ground-based augmentation
int8 status
# Bits defining which Global Navigation Satellite System signals were
# used by the receiver.
uint16 SERVICE_GPS = 1
uint16 SERVICE_GLONASS = 2
uint16 SERVICE_COMPASS = 4 # includes BeiDou.
uint16 SERVICE_GALILEO = 8
uint16 service
------------------------------------------------------------
Message Type: sensor_msgs/Joy.msg
------------------------------------------------------------
# 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
------------------------------------------------------------
Message Type: sensor_msgs/Imu.msg
------------------------------------------------------------
# This is a message to hold data from an IMU (Inertial Measurement Unit)
#
# Accelerations should be in m/s^2 (not in g's), and rotational velocity should be in rad/sec
#
# 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 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.
std_msgs/Header header
geometry_msgs/Quaternion orientation
float64[9] orientation_covariance # Row major about x, y, z axes
geometry_msgs/Vector3 angular_velocity
float64[9] angular_velocity_covariance # Row major about x, y, z axes
geometry_msgs/Vector3 linear_acceleration
float64[9] linear_acceleration_covariance # Row major x, y z
------------------------------------------------------------
Message Type: sensor_msgs/LaserScan.msg
------------------------------------------------------------
# Single scan from a planar laser range-finder
#
# If you have another ranging device with different behavior (e.g. a sonar
# array), please find or create a different message, since applications
# will make fairly laser-specific assumptions about this data
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
# the positive Z axis (counterclockwise, if Z is up)
# with zero angle being forward along the x axis
float32 angle_min # start angle of the scan [rad]
float32 angle_max # end angle of the scan [rad]
float32 angle_increment # angular distance between measurements [rad]
float32 time_increment # time between measurements [seconds] - if your scanner
# is moving, this will be used in interpolating position
# of 3d points
float32 scan_time # time between scans [seconds]
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[] intensities # intensity data [device-specific units]. If your
# device does not provide intensities, please leave
# the array empty.
------------------------------------------------------------
Message Type: sensor_msgs/FluidPressure.msg
------------------------------------------------------------
# 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.
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 variance # 0 is interpreted as variance unknown
------------------------------------------------------------
Message Type: sensor_msgs/MultiDOFJointState.msg
------------------------------------------------------------
# Representation of state for joints with multiple degrees of freedom,
# following the structure of JointState which can only represent a single degree of freedom.
#
# It is assumed that a joint in a system corresponds to a transform that gets applied
# along the kinematic chain. For example, a planar joint (as in URDF) is 3DOF (x, y, yaw)
# and those 3DOF can be expressed as a transformation matrix, and that transformation
# matrix can be converted back to (x, y, yaw)
#
# Each joint is uniquely identified by its name
# The header specifies the time at which the joint states were recorded. All the joint states
# in one message have to be recorded at the same time.
#
# This message consists of a multiple arrays, one for each part of the joint state.
# The goal is to make each of the fields optional. When e.g. your joints have no
# wrench associated with them, you can leave the wrench array empty.
#
# All arrays in this message should have the same size, or be empty.
# This is the only way to uniquely associate the joint name with the correct
# states.
std_msgs/Header header
string[] joint_names
geometry_msgs/Transform[] transforms
geometry_msgs/Twist[] twist
geometry_msgs/Wrench[] wrench
------------------------------------------------------------
Message Type: sensor_msgs/Temperature.msg
------------------------------------------------------------
# Single temperature reading.
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 variance # 0 is interpreted as variance unknown.
------------------------------------------------------------
Message Type: std_msgs/Char.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
char data
------------------------------------------------------------
Message Type: std_msgs/Bool.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
bool data
------------------------------------------------------------
Message Type: std_msgs/Float64MultiArray.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
# Please look at the MultiArrayLayout message definition for
# documentation on all multiarrays.
MultiArrayLayout layout # specification of data layout
float64[] data # array of data
------------------------------------------------------------
Message Type: std_msgs/Float32MultiArray.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
# Please look at the MultiArrayLayout message definition for
# documentation on all multiarrays.
MultiArrayLayout layout # specification of data layout
float32[] data # array of data
------------------------------------------------------------
Message Type: std_msgs/String.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
string data
------------------------------------------------------------
Message Type: std_msgs/Int16.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
int16 data
------------------------------------------------------------
Message Type: std_msgs/Float32.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
float32 data
------------------------------------------------------------
Message Type: std_msgs/Int16MultiArray.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
# Please look at the MultiArrayLayout message definition for
# documentation on all multiarrays.
MultiArrayLayout layout # specification of data layout
int16[] data # array of data
------------------------------------------------------------
Message Type: std_msgs/Int8.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
int8 data
------------------------------------------------------------
Message Type: std_msgs/UInt16MultiArray.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
# Please look at the MultiArrayLayout message definition for
# documentation on all multiarrays.
MultiArrayLayout layout # specification of data layout
uint16[] data # array of data
------------------------------------------------------------
Message Type: std_msgs/UInt64MultiArray.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
# Please look at the MultiArrayLayout message definition for
# documentation on all multiarrays.
MultiArrayLayout layout # specification of data layout
uint64[] data # array of data
------------------------------------------------------------
Message Type: std_msgs/Float64.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
float64 data
------------------------------------------------------------
Message Type: std_msgs/Int32.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
int32 data
------------------------------------------------------------
Message Type: std_msgs/UInt16.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
uint16 data
------------------------------------------------------------
Message Type: std_msgs/MultiArrayDimension.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
string label # label of given dimension
uint32 size # size of given dimension (in type units)
uint32 stride # stride of given dimension
------------------------------------------------------------
Message Type: std_msgs/Int64.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
int64 data
------------------------------------------------------------
Message Type: std_msgs/UInt64.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
uint64 data
------------------------------------------------------------
Message Type: std_msgs/UInt8MultiArray.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
# Please look at the MultiArrayLayout message definition for
# documentation on all multiarrays.
MultiArrayLayout layout # specification of data layout
uint8[] data # array of data
------------------------------------------------------------
Message Type: std_msgs/Int8MultiArray.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
# Please look at the MultiArrayLayout message definition for
# documentation on all multiarrays.
MultiArrayLayout layout # specification of data layout
int8[] data # array of data
------------------------------------------------------------
Message Type: std_msgs/Byte.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
byte data
------------------------------------------------------------
Message Type: std_msgs/Int32MultiArray.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
# Please look at the MultiArrayLayout message definition for
# documentation on all multiarrays.
MultiArrayLayout layout # specification of data layout
int32[] data # array of data
------------------------------------------------------------
Message Type: std_msgs/UInt8.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
uint8 data
------------------------------------------------------------
Message Type: std_msgs/Header.msg
------------------------------------------------------------
# Standard metadata for higher-level stamped data types.
# This is generally used to communicate timestamped data
# in a particular coordinate frame.
# 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
------------------------------------------------------------
Message Type: std_msgs/ByteMultiArray.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
# Please look at the MultiArrayLayout message definition for
# documentation on all multiarrays.
MultiArrayLayout layout # specification of data layout
byte[] data # array of data
------------------------------------------------------------
Message Type: std_msgs/ColorRGBA.msg
------------------------------------------------------------
float32 r
float32 g
float32 b
float32 a
------------------------------------------------------------
Message Type: std_msgs/UInt32.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
uint32 data
------------------------------------------------------------
Message Type: std_msgs/Empty.msg
------------------------------------------------------------
------------------------------------------------------------
Message Type: std_msgs/Int64MultiArray.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
# Please look at the MultiArrayLayout message definition for
# documentation on all multiarrays.
MultiArrayLayout layout # specification of data layout
int64[] data # array of data
------------------------------------------------------------
Message Type: std_msgs/UInt32MultiArray.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
# Please look at the MultiArrayLayout message definition for
# documentation on all multiarrays.
MultiArrayLayout layout # specification of data layout
uint32[] data # array of data
------------------------------------------------------------
Message Type: std_msgs/MultiArrayLayout.msg
------------------------------------------------------------
# This was originally provided as an example message.
# It is deprecated as of Foxy
# It is recommended to create your own semantically meaningful message.
# However if you would like to continue using this please use the equivalent in example_msgs.
# The multiarray declares a generic multi-dimensional array of a
# particular data type. Dimensions are ordered from outer most
# to inner most.
#
# Accessors should ALWAYS be written in terms of dimension stride
# and specified outer-most dimension first.
#
# multiarray(i,j,k) = data[data_offset + dim_stride[1]*i + dim_stride[2]*j + k]
#
# A standard, 3-channel 640x480 image with interleaved color channels
# would be specified as:
#
# dim[0].label = "height"
# dim[0].size = 480
# dim[0].stride = 3*640*480 = 921600 (note dim[0] stride is just size of image)
# dim[1].label = "width"
# dim[1].size = 640
# dim[1].stride = 3*640 = 1920
# dim[2].label = "channel"
# dim[2].size = 3
# 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
------------------------------------------------------------
Message Type: diagnostic_msgs/DiagnosticArray.msg
------------------------------------------------------------
# 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
------------------------------------------------------------
Message Type: diagnostic_msgs/DiagnosticStatus.msg
------------------------------------------------------------
# This message holds the status of an individual component of the robot.
# Possible levels of operations.
byte OK=0
byte WARN=1
byte ERROR=2
byte STALE=3
# 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
------------------------------------------------------------
Message Type: diagnostic_msgs/KeyValue.msg
------------------------------------------------------------
# What to label this value when viewing.
string key
# A value to track over time.
string value
------------------------------------------------------------
Message Type: trajectory_msgs/MultiDOFJointTrajectory.msg
------------------------------------------------------------
# The header is used to specify the coordinate frame and the reference time for the trajectory durations
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
# that has the same length as the array of joint names, and has the same order of joints as
# the joint names array.
string[] joint_names
MultiDOFJointTrajectoryPoint[] points
------------------------------------------------------------
Message Type: trajectory_msgs/JointTrajectory.msg
------------------------------------------------------------
# The header is used to specify the coordinate frame and the reference time for
# the trajectory durations
std_msgs/Header header
# The names of the active joints in each trajectory point. These names are
# ordered and must correspond to the values in each trajectory point.
string[] joint_names
# Array of trajectory points, which describe the positions, velocities,
# accelerations and/or efforts of the joints at each time point.
JointTrajectoryPoint[] points
------------------------------------------------------------
Message Type: trajectory_msgs/JointTrajectoryPoint.msg
------------------------------------------------------------
# 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.
# Single DOF joint positions for each joint relative to their "0" position.
# The units depend on the specific joint type: radians for revolute or
# continuous joints, and meters for prismatic joints.
float64[] positions
# The rate of change in position of each joint. Units are joint type dependent.
# Radians/second for revolute or continuous joints, and meters/second for
# prismatic joints.
float64[] velocities
# Rate of change in velocity of each joint. Units are joint type dependent.
# Radians/second^2 for revolute or continuous joints, and meters/second^2 for
# prismatic joints.
float64[] accelerations
# The torque or the force to be applied at each joint. For revolute/continuous
# joints effort denotes a torque in newton-meters. For prismatic joints, effort
# denotes a force in newtons.
float64[] effort
# Desired time from the trajectory start to arrive at this trajectory point.
builtin_interfaces/Duration time_from_start
------------------------------------------------------------
Message Type: trajectory_msgs/MultiDOFJointTrajectoryPoint.msg
------------------------------------------------------------
# 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.
geometry_msgs/Twist[] velocities
# There can be an acceleration specified for the origin of the joint.
geometry_msgs/Twist[] accelerations
# Desired time from the trajectory start to arrive at this trajectory point.
builtin_interfaces/Duration time_from_start
------------------------------------------------------------
Message Type: shape_msgs/SolidPrimitive.msg
------------------------------------------------------------
# Defines box, sphere, cylinder, cone and prism.
# All shapes are defined to have their bounding boxes centered around 0,0,0.
uint8 BOX=1
uint8 SPHERE=2
uint8 CYLINDER=3
uint8 CONE=4
uint8 PRISM=5
# The type of the shape
uint8 type
# The dimensions of the shape
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.
# 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.
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.
uint8 CYLINDER_HEIGHT=0
uint8 CYLINDER_RADIUS=1
uint8 CONE_HEIGHT=0
uint8 CONE_RADIUS=1
# For the type PRISM, the center line is oriented along Z axis.
# The PRISM_HEIGHT component of dimensions gives the
# height of the prism.
# The polygon defines the Z axis centered base of the prism.
# The prism is constructed by extruding the base in +Z and -Z
# directions by half of the PRISM_HEIGHT
# Only x and y fields of the points are used in the polygon.
# Points of the polygon are ordered counter-clockwise.
uint8 PRISM_HEIGHT=0
geometry_msgs/Polygon polygon
------------------------------------------------------------
Message Type: shape_msgs/Plane.msg
------------------------------------------------------------
# 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
------------------------------------------------------------
Message Type: shape_msgs/Mesh.msg
------------------------------------------------------------
# Definition of a mesh.
# List of triangles; the index values refer to positions in vertices[].
MeshTriangle[] triangles
# The actual vertices that make up the mesh.
geometry_msgs/Point[] vertices
------------------------------------------------------------
Message Type: shape_msgs/MeshTriangle.msg
------------------------------------------------------------
# Definition of a triangle's vertices.
uint32[3] vertex_indices
------------------------------------------------------------
Message Type: geometry_msgs/PoseWithCovariance.msg
------------------------------------------------------------
# This represents a pose in free space with uncertainty.
Pose pose
# Row-major representation of the 6x6 covariance matrix
# The orientation parameters use a fixed-axis representation.
# In order, the parameters are:
# (x, y, z, rotation about X axis, rotation about Y axis, rotation about Z axis)
float64[36] covariance
------------------------------------------------------------
Message Type: geometry_msgs/WrenchStamped.msg
------------------------------------------------------------
# A wrench with reference coordinate frame and timestamp
std_msgs/Header header
Wrench wrench
------------------------------------------------------------
Message Type: geometry_msgs/InertiaStamped.msg
------------------------------------------------------------
# An Inertia with a time stamp and reference frame.
std_msgs/Header header
Inertia inertia
------------------------------------------------------------
Message Type: geometry_msgs/QuaternionStamped.msg
------------------------------------------------------------
# This represents an orientation with reference coordinate frame and timestamp.
std_msgs/Header header
Quaternion quaternion
------------------------------------------------------------
Message Type: geometry_msgs/Point.msg
------------------------------------------------------------
# This contains the position of a point in free space
float64 x
float64 y
float64 z
------------------------------------------------------------
Message Type: geometry_msgs/Vector3.msg
------------------------------------------------------------
# This represents a vector in free space.
# This is semantically different than a point.
# A vector is always anchored at the origin.
# When a transform is applied to a vector, only the rotational component is applied.
float64 x
float64 y
float64 z
------------------------------------------------------------
Message Type: geometry_msgs/TwistWithCovarianceStamped.msg
------------------------------------------------------------
# This represents an estimated twist with reference coordinate frame and timestamp.
std_msgs/Header header
TwistWithCovariance twist
------------------------------------------------------------
Message Type: geometry_msgs/PointStamped.msg
------------------------------------------------------------
# This represents a Point with reference coordinate frame and timestamp
std_msgs/Header header
Point point
------------------------------------------------------------
Message Type: geometry_msgs/Accel.msg
------------------------------------------------------------
# This expresses acceleration in free space broken into its linear and angular parts.
Vector3 linear
Vector3 angular
------------------------------------------------------------
Message Type: geometry_msgs/PoseStamped.msg
------------------------------------------------------------
# A Pose with reference coordinate frame and timestamp
std_msgs/Header header
Pose pose
------------------------------------------------------------
Message Type: geometry_msgs/Pose.msg
------------------------------------------------------------
# A representation of pose in free space, composed of position and orientation.
Point position
Quaternion orientation
------------------------------------------------------------
Message Type: geometry_msgs/PoseArray.msg
------------------------------------------------------------
# An array of poses with a header for global reference.
std_msgs/Header header
Pose[] poses
------------------------------------------------------------
Message Type: geometry_msgs/Vector3Stamped.msg
------------------------------------------------------------
# This represents a Vector3 with reference coordinate frame and timestamp
# Note that this follows vector semantics with it always anchored at the origin,
# so the rotational elements of a transform are the only parts applied when transforming.
std_msgs/Header header
Vector3 vector
------------------------------------------------------------
Message Type: geometry_msgs/Quaternion.msg
------------------------------------------------------------
# This represents an orientation in free space in quaternion form.
float64 x 0
float64 y 0
float64 z 0
float64 w 1
------------------------------------------------------------
Message Type: geometry_msgs/AccelStamped.msg
------------------------------------------------------------
# An accel with reference coordinate frame and timestamp
std_msgs/Header header
Accel accel
------------------------------------------------------------
Message Type: geometry_msgs/PolygonStamped.msg
------------------------------------------------------------
# This represents a Polygon with reference coordinate frame and timestamp
std_msgs/Header header
Polygon polygon
------------------------------------------------------------
Message Type: geometry_msgs/TwistWithCovariance.msg
------------------------------------------------------------
# This expresses velocity in free space with uncertainty.
Twist twist
# Row-major representation of the 6x6 covariance matrix
# The orientation parameters use a fixed-axis representation.
# In order, the parameters are:
# (x, y, z, rotation about X axis, rotation about Y axis, rotation about Z axis)
float64[36] covariance
------------------------------------------------------------
Message Type: geometry_msgs/Pose2D.msg
------------------------------------------------------------
# Deprecated as of Foxy and will potentially be removed in any following release.
# 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
float64 y
float64 theta
------------------------------------------------------------
Message Type: geometry_msgs/AccelWithCovariance.msg
------------------------------------------------------------
# This expresses acceleration in free space with uncertainty.
Accel accel
# Row-major representation of the 6x6 covariance matrix
# The orientation parameters use a fixed-axis representation.
# In order, the parameters are:
# (x, y, z, rotation about X axis, rotation about Y axis, rotation about Z axis)
float64[36] covariance
------------------------------------------------------------
Message Type: geometry_msgs/AccelWithCovarianceStamped.msg
------------------------------------------------------------
# This represents an estimated accel with reference coordinate frame and timestamp.
std_msgs/Header header
AccelWithCovariance accel
------------------------------------------------------------
Message Type: geometry_msgs/Inertia.msg
------------------------------------------------------------
# Mass [kg]
float64 m
# Center of mass [m]
geometry_msgs/Vector3 com
# Inertia Tensor [kg-m^2]
# | ixx ixy ixz |
# I = | ixy iyy iyz |
# | ixz iyz izz |
float64 ixx
float64 ixy
float64 ixz
float64 iyy
float64 iyz
float64 izz
------------------------------------------------------------
Message Type: geometry_msgs/Wrench.msg
------------------------------------------------------------
# This represents force in free space, separated into its linear and angular parts.
Vector3 force
Vector3 torque
------------------------------------------------------------
Message Type: geometry_msgs/TwistStamped.msg
------------------------------------------------------------
# A twist with reference coordinate frame and timestamp
std_msgs/Header header
Twist twist
------------------------------------------------------------
Message Type: geometry_msgs/Twist.msg
------------------------------------------------------------
# This expresses velocity in free space broken into its linear and angular parts.
Vector3 linear
Vector3 angular
------------------------------------------------------------
Message Type: geometry_msgs/PoseWithCovarianceStamped.msg
------------------------------------------------------------
# This expresses an estimated pose with a reference coordinate frame and timestamp
std_msgs/Header header
PoseWithCovariance pose
------------------------------------------------------------
Message Type: geometry_msgs/Point32.msg
------------------------------------------------------------
# This contains the position of a point in free space(with 32 bits of precision).
# It is recommended to use Point wherever possible instead of Point32.
#
# This recommendation is to promote interoperability.
#
# This message is designed to take up less space when sending
# lots of points at once, as in the case of a PointCloud.
float32 x
float32 y
float32 z
------------------------------------------------------------
Message Type: geometry_msgs/TransformStamped.msg
------------------------------------------------------------
# This expresses a transform from coordinate frame header.frame_id
# to the coordinate frame child_frame_id at the time of header.stamp
#
# This message is mostly used by the
# <a href="https://index.ros.org/p/tf2/">tf2</a> package.
# See its documentation for more information.
#
# The child_frame_id is necessary in addition to the frame_id
# in the Header to communicate the full reference for the transform
# in a self contained message.
# The frame id in the header is used as the reference frame of this transform.
std_msgs/Header header
# The frame id of the child frame to which this transform points.
string child_frame_id
# Translation and rotation in 3-dimensions of child_frame_id from header.frame_id.
Transform transform
------------------------------------------------------------
Message Type: geometry_msgs/Polygon.msg
------------------------------------------------------------
# A specification of a polygon where the first and last points are assumed to be connected
Point32[] points
------------------------------------------------------------
Message Type: geometry_msgs/Transform.msg
------------------------------------------------------------
# This represents the transform between two coordinate frames in free space.
Vector3 translation
Quaternion rotation
------------------------------------------------------------
Message Type: actionlib_msgs/GoalStatusArray.msg
------------------------------------------------------------
# Stores the statuses for goals that are currently being tracked
# by an action server
std_msgs/Header header
GoalStatus[] status_list
------------------------------------------------------------
Message Type: actionlib_msgs/GoalStatus.msg
------------------------------------------------------------
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 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).
uint8 ABORTED = 4 # The goal was aborted during execution by the action server due
# 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).
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.
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.
# Allow for the user to associate a string with GoalStatus for debugging.
string text
------------------------------------------------------------
Message Type: actionlib_msgs/GoalID.msg
------------------------------------------------------------
# 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
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