VectorVisualization.hpp
Go to the documentation of this file.
1 /*
2  * VectorVisualization.hpp
3  *
4  * Created on: Sep 16, 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 // STD
20 #include <vector>
21 
22 namespace grid_map_visualization {
23 
28 {
29  public:
30 
36  VectorVisualization(ros::NodeHandle& nodeHandle, const std::string& name);
37 
41  virtual ~VectorVisualization();
42 
48  bool readParameters(XmlRpc::XmlRpcValue& config);
49 
53  bool initialize();
54 
60  bool visualize(const grid_map::GridMap& map);
61 
62  private:
63 
65  visualization_msgs::Marker marker_;
66 
68  std::vector<std::string> types_;
69 
71  std::string positionLayer_;
72 
74  double scale_;
75 
77  double lineWidth_;
78 
80  std_msgs::ColorRGBA color_;
81 };
82 
83 } /* namespace */
VectorVisualization(ros::NodeHandle &nodeHandle, const std::string &name)
double lineWidth_
Width of the line markers [m].
std::vector< std::string > types_
Types that are transformed to vectors.
bool visualize(const grid_map::GridMap &map)
visualization_msgs::Marker marker_
Marker to be published.
std_msgs::ColorRGBA color_
Color of the vectors.
bool readParameters(XmlRpc::XmlRpcValue &config)
std::string positionLayer_
Type that is the position of the vectors.


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