#include "surface_perception/axes_marker.h"
#include "Eigen/Eigen"
#include "geometry_msgs/Point.h"
#include "geometry_msgs/Pose.h"
#include "ros/ros.h"
#include "std_msgs/ColorRGBA.h"
#include "visualization_msgs/Marker.h"
#include "visualization_msgs/MarkerArray.h"
Go to the source code of this file.
Namespaces | |
namespace | surface_perception |
Functions | |
visualization_msgs::MarkerArray | surface_perception::GetAxesMarkerArray (const std::string &name_space, const std::string &frame_id, const geometry_msgs::Pose &pose, double scale) |
This helper function generates a marker array where axes are represented by three markers of colored cylinder bars. |