Autonomous Racing  1
f1tenth Project Group of Technical University Dortmund, Germany
rviz_geometry_publisher.h
Go to the documentation of this file.
1 #pragma once
2 
3 #include "std_msgs/ColorRGBA.h"
4 #include <ros/ros.h>
5 #include <visualization_msgs/Marker.h>
6 
7 geometry_msgs::Point createPoint(float x, float y, float z);
8 std_msgs::ColorRGBA createColor(double r, double g, double b, double a);
9 
11 {
12  public:
13  RvizGeometryPublisher(ros::NodeHandle node_handle, const std::string& topic, const std::string& frame);
14 
15  void drawLine(int id, geometry_msgs::Point point1, geometry_msgs::Point point2, std_msgs::ColorRGBA color,
16  float width);
17 
18  private:
19  ros::Publisher m_marker_publisher;
20  const std::string m_frame;
21 };
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)
Point
Definition: circle.py:8
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)