MapRegionVisualization.hpp
Go to the documentation of this file.
1 /*
2  * MapRegionVisualization.hpp
3  *
4  * Created on: Jun 18, 2014
5  * Author: Péter Fankhauser
6  * Institute: ETH Zurich, ANYbotics
7  */
8 
9 #pragma once
10 
13 
14 // ROS
15 #include <ros/ros.h>
16 #include <visualization_msgs/Marker.h>
17 #include <std_msgs/ColorRGBA.h>
18 
19 namespace grid_map_visualization {
20 
25 {
26  public:
27 
33  MapRegionVisualization(ros::NodeHandle& nodeHandle, const std::string& name);
34 
38  virtual ~MapRegionVisualization();
39 
45  bool readParameters(XmlRpc::XmlRpcValue& config);
46 
50  bool initialize();
51 
57  bool visualize(const grid_map::GridMap& map);
58 
59  private:
60 
62  visualization_msgs::Marker marker_;
63 
65  const unsigned int nVertices_;
66 
68  std_msgs::ColorRGBA color_;
69 
71  double lineWidth_;
72 
73 };
74 
75 } /* namespace */
MapRegionVisualization(ros::NodeHandle &nodeHandle, const std::string &name)
const unsigned int nVertices_
Number of vertices of the map region visualization.
visualization_msgs::Marker marker_
Marker to be published.
std_msgs::ColorRGBA color_
Color of the map region visualization.
double lineWidth_
Line width of the map region marker [m].


grid_map_visualization
Author(s): Péter Fankhauser
autogenerated on Tue Jun 25 2019 20:02:32