Skip to content
Snippets Groups Projects
Commit 3b086190 authored by Sebastian Ebert's avatar Sebastian Ebert
Browse files

cleaned bazel, removed depricated tests

parent e971dff6
Branches
No related tags found
No related merge requests found
Showing
with 0 additions and 96 deletions
# This represents the transform between two coordinate frames in free space.
Vector3 translation
Quaternion rotation
# This expresses a transform from coordinate frame header.frame_id
# to the coordinate frame child_frame_id
#
# This message is mostly used by the
# <a href="http://www.ros.org/wiki/tf">tf</a> package.
# See its documentation for more information.
Header header
string child_frame_id # the frame id of the child frame
Transform transform
# This expresses velocity in free space broken into its linear and angular parts.
Vector3 linear
Vector3 angular
# A twist with reference coordinate frame and timestamp
Header header
Twist twist
# 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
# This represents an estimated twist with reference coordinate frame and timestamp.
Header header
TwistWithCovariance twist
# This represents a vector in free space.
float64 x
float64 y
float64 z
\ No newline at end of file
# This represents a Vector3 with reference coordinate frame and timestamp
Header header
Vector3 vector
# This represents force in free space, separated into
# its linear and angular parts.
Vector3 force
Vector3 torque
# A wrench with reference coordinate frame and timestamp
Header header
Wrench wrench
# Get the map as a nav_msgs/OccupancyGrid
---
nav_msgs/OccupancyGrid map
---
# no feedback
\ No newline at end of file
# ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
GetMapActionGoal action_goal
GetMapActionResult action_result
GetMapActionFeedback action_feedback
# ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
Header header
actionlib_msgs/GoalStatus status
GetMapFeedback feedback
# ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
Header header
actionlib_msgs/GoalID goal_id
GetMapGoal goal
# ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
Header header
actionlib_msgs/GoalStatus status
GetMapResult result
# ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
# no feedback
# ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
# Get the map as a nav_msgs/OccupancyGrid
# ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
nav_msgs/OccupancyGrid map
#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
0% Loading or .
You are about to add 0 people to the discussion. Proceed with caution.
Please register or to comment