3 #include "std_msgs/ColorRGBA.h" 5 #include <visualization_msgs/Marker.h> 8 std_msgs::ColorRGBA
createColor(
double r,
double g,
double b,
double a);
13 RvizGeometryPublisher(ros::NodeHandle node_handle,
const std::string& topic,
const std::string& frame);
19 ros::Publisher m_marker_publisher;
20 const std::string m_frame;
std_msgs::ColorRGBA createColor(double r, double g, double b, double a)
RvizGeometryPublisher(ros::NodeHandle node_handle, const std::string &topic, const std::string &frame)
void drawLine(int id, geometry_msgs::Point point1, geometry_msgs::Point point2, std_msgs::ColorRGBA color, float width)
geometry_msgs::Point createPoint(float x, float y, float z)