FlatPointCloudVisualization.hpp
Go to the documentation of this file.
1 /*
2  * FlatPointCloudVisualization.hpp
3  *
4  * Created on: Mar 9, 2016
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 
17 namespace grid_map_visualization {
18 
23 {
24  public:
25 
31  FlatPointCloudVisualization(ros::NodeHandle& nodeHandle, const std::string& name);
32 
37 
43  bool readParameters(XmlRpc::XmlRpcValue& config);
44 
48  bool initialize();
49 
55  bool visualize(const grid_map::GridMap& map);
56 
57  private:
59  std::string layer_;
60 
62  double height_;
63 };
64 
65 } /* namespace */
FlatPointCloudVisualization(ros::NodeHandle &nodeHandle, const std::string &name)
std::string layer_
Type that is transformed to points.
double height_
Height of the z-coordinate at which the flat point cloud is visualized.


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