OccupancyGridVisualization.hpp
Go to the documentation of this file.
1 /*
2  * PointCloudOccupancyGrid.hpp
3  *
4  * Created on: Nov 3, 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 
17 namespace grid_map_visualization {
18 
20 {
21  public:
22 
28  OccupancyGridVisualization(ros::NodeHandle& nodeHandle, const std::string& name);
29 
34 
40  bool readParameters(XmlRpc::XmlRpcValue& config);
41 
45  bool initialize();
46 
52  bool visualize(const grid_map::GridMap& map);
53 
54  private:
55 
57  std::string layer_;
58 
61 };
62 
63 } /* namespace */
OccupancyGridVisualization(ros::NodeHandle &nodeHandle, const std::string &name)
std::string layer_
Type that is transformed to the occupancy grid.
float dataMin_
Minimum and maximum value of the grid map data (used to normalize the cell data in [min...


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