Go to the documentation of this file.00001 #ifndef _SURFACE_PERCEPTION_AXES_MARKER_H_
00002 #define _SURFACE_PERCEPTION_AXES_MARKER_H_
00003
00004 #include "visualization_msgs/Marker.h"
00005 #include "visualization_msgs/MarkerArray.h"
00006
00007 namespace surface_perception {
00030 visualization_msgs::MarkerArray GetAxesMarkerArray(
00031 const std::string& name_space, const std::string& frame_id,
00032 const geometry_msgs::Pose& pose, double scale);
00033 }
00034
00035 #endif // _SURFACE_PERCEPTION_AXES_MARKER_H_