occupancy_grid.hpp
Go to the documentation of this file.
00001 
00004 /*****************************************************************************
00005 ** Ifdefs
00006 *****************************************************************************/
00007 
00008 #ifndef cost_map_visualisations_OCCUPANCY_GRID_HPP_
00009 #define cost_map_visualisations_OCCUPANCY_GRID_HPP_
00010 
00011 /*****************************************************************************
00012 ** Includes
00013 *****************************************************************************/
00014 
00015 #include <cost_map_msgs/CostMap.h>
00016 #include <ros/ros.h>
00017 #include <map>
00018 #include <string>
00019 
00020 /*****************************************************************************
00021 ** Namespaces
00022 *****************************************************************************/
00023 
00024 namespace cost_map {
00025 
00026 /*****************************************************************************
00027 ** Interfaces
00028 *****************************************************************************/
00029 
00033 class OccupancyGrid {
00034 public:
00035   OccupancyGrid();
00036 
00037 
00038 private:
00039   void _costMapCallback(const cost_map_msgs::CostMap::ConstPtr& msg);
00040 
00041   ros::Subscriber subscriber_;
00042   std::map<std::string, ros::Publisher> publishers_;
00043 };
00044 
00045 /*****************************************************************************
00046 ** Trailers
00047 *****************************************************************************/
00048 
00049 } // namespace cost_map
00050 
00051 #endif /* cost_map_visualisations_OCCUPANCY_GRID_HPP_ */


cost_map_visualisations
Author(s): Daniel Stonier
autogenerated on Thu Jun 6 2019 20:27:59