Skip to content
Snippets Groups Projects
Commit d77db574 authored by Damon Kohler's avatar Damon Kohler Committed by Daniel Stonier
Browse files

message_generation tests from rosjava_core.

parent 2a4c1441
No related branches found
No related tags found
No related merge requests found
Showing
with 99 additions and 0 deletions
#an array of cells in a 2D grid
Header header
float32 cell_width
float32 cell_height
geometry_msgs/Point[] cells
# This hold basic information about the characterists of the OccupancyGrid
# The time at which the map was loaded
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
# This represents a 2-D grid map, in which each cell represents the probability of
# occupancy.
Header header
#MetaData for the map
MapMetaData info
# The map data, in row-major order, starting with (0,0). Occupancy
# probabilities are in the range [0,100]. Unknown is -1.
int8[] data
# 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
Header header
string child_frame_id
geometry_msgs/PoseWithCovariance pose
geometry_msgs/TwistWithCovariance twist
#An array of poses that represents a Path for a robot to follow
Header header
geometry_msgs/PoseStamped[] poses
# Get the map as a nav_msgs/OccupancyGrid
---
nav_msgs/OccupancyGrid map
# Get a plan from the current position to the goal Pose
# The start pose for the plan
geometry_msgs/PoseStamped start
# The final pose of the goal position
geometry_msgs/PoseStamped goal
# If the goal is obstructed, how many meters the planner can
# relax the constraint in x and y before failing.
float32 tolerance
---
nav_msgs/Path plan
bool data
\ No newline at end of file
byte data
# Please look at the MultiArrayLayout message definition for
# documentation on all multiarrays.
MultiArrayLayout layout # specification of data layout
byte[] data # array of data
char data
\ No newline at end of file
float32 r
float32 g
float32 b
float32 a
duration data
float32 data
\ No newline at end of file
# Please look at the MultiArrayLayout message definition for
# documentation on all multiarrays.
MultiArrayLayout layout # specification of data layout
float32[] data # array of data
float64 data
\ No newline at end of file
# Please look at the MultiArrayLayout message definition for
# documentation on all multiarrays.
MultiArrayLayout layout # specification of data layout
float64[] data # array of data
# 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.secs: seconds (stamp_secs) since epoch
# * stamp.nsecs: nanoseconds since stamp_secs
# time-handling sugar is provided by the client library
time stamp
#Frame this data is associated with
# 0: no frame
# 1: global frame
string frame_id
int16 data
0% Loading or .
You are about to add 0 people to the discussion. Proceed with caution.
Please register or to comment