20 #ifndef MARKER_HELPER_HPP_ 21 #define MARKER_HELPER_HPP_ 23 #include <geometry_msgs/Pose.h> 24 #include <visualization_msgs/Marker.h> 47 static visualization_msgs::Marker
getBasicMarker(
int id, std::string ns =
"my_namespace");
70 static visualization_msgs::Marker
getTextMarker(
int id, std::string text, geometry_msgs::Pose pose, std::string ns =
"my_namespace");
78 static visualization_msgs::Marker
getDeleteMarker(
int id, std::string ns =
"my_namespace");
104 std::string ns =
"my_namespace");
153 static visualization_msgs::Marker
getLineListMarker(
int id, std::vector<SimpleVector3> points,
double scale,
169 static visualization_msgs::Marker
getTriangleListMarker(
int id, std::vector<SimpleVector3> vertices, std::vector<SimpleVector4> colors,
170 std::string ns =
"my_namespace");
177 static void getRainbowColor(visualization_msgs::Marker &marker,
double x,
double alpha = 1.0);
static visualization_msgs::Marker getTriangleListMarker(int id, std::vector< SimpleVector3 > vertices, std::vector< SimpleVector4 > colors, std::string ns="my_namespace")
static visualization_msgs::Marker getDeleteMarker(int id, std::string ns="my_namespace")
returns a marker which will delete the corresponding marker with the same id and namespace ...
static visualization_msgs::Marker getCubeMarker(int id, SimpleVector3 position, SimpleQuaternion orientation, SimpleVector3 scale, SimpleVector4 color, std::string ns="my_namespace")
returns a cube marker with the given settings
Eigen::Matrix< Precision, 3, 1 > SimpleVector3
static visualization_msgs::Marker getCylinderMarker(int id, SimpleVector3 position, double w, SimpleVector3 scale, SimpleVector4 color, std::string ns="my_namespace")
returns a cylinder marker with the given settings
Eigen::Matrix< Precision, 4, 1 > SimpleVector4
this namespace contains all generally usable classes.
TFSIMD_FORCE_INLINE const tfScalar & x() const
MarkerHelper is a convenience class to reduce the mess created if marker initialization is used by ha...
static visualization_msgs::Marker getBasicMarker(int id, std::string ns="my_namespace")
returns a marker with basic settings
TFSIMD_FORCE_INLINE const tfScalar & w() const
static visualization_msgs::Marker getArrowMarker(int id, SimpleVector3 startPoint, SimpleVector3 endPoint, SimpleVector3 scale=SimpleVector3(0.025, 0.05, 0.05), SimpleVector4 color=SimpleVector4(1.0, 0.0, 0.0, 1.0), std::string ns="my_namespace")
returns an arrow marker with the given settings
static void getRainbowColor(visualization_msgs::Marker &marker, double x, double alpha=1.0)
static visualization_msgs::Marker getLineListMarker(int id, std::vector< SimpleVector3 > points, double scale, SimpleVector4 color, std::string ns="my_namespace")
returns a line list marker with the given settings
Eigen::Quaternion< Precision > SimpleQuaternion
static visualization_msgs::Marker getTextMarker(int id, std::string text, geometry_msgs::Pose pose, std::string ns="my_namespace")
returns a text marker with the given settings
static visualization_msgs::Marker getSphereMarker(int id, SimpleVector3 position, SimpleVector3 scale, SimpleVector4 color, std::string ns="my_namespace")
returns a sphere marker with the given settings
static visualization_msgs::Marker getMeshMarker(int id, std::string meshResource, SimpleVector3 centroid, SimpleQuaternion quaternion, SimpleVector3 scale=SimpleVector3(0.001, 0.001, 0.001), std::string ns="my_namespace")
returns a mesh marker with the given settings