Map generation node. More...
| Public Member Functions | |
| void | mapCallback (const nav_msgs::OccupancyGridConstPtr &map) | 
| MapGenerator (const std::string &mapname) | |
| MapGenerator () | |
| void | sysCmdCallback (const std_msgs::String &sys_cmd) | 
| void | timerSaveGeotiffCallback (const ros::TimerEvent &e) | 
| void | writeGeotiff () | 
| ~MapGenerator () | |
| Public Attributes | |
| GeotiffWriter | geotiff_writer | 
| GeotiffWriter | geotiff_writer_ | 
| ros::Timer | map_save_timer_ | 
| ros::ServiceClient | map_service_client_ | 
| ros::Subscriber | map_sub_ | 
| std::string | mapname_ | 
| ros::NodeHandle | n_ | 
| ros::ServiceClient | object_service_client_ | 
| bool | p_draw_background_checkerboard_ | 
| bool | p_draw_free_space_grid_ | 
| std::string | p_map_file_base_name_ | 
| std::string | p_map_file_path_ | 
| std::string | p_plugin_list_ | 
| ros::ServiceClient | path_service_client_ | 
| pluginlib::ClassLoader< hector_geotiff::MapWriterPluginInterface > * | plugin_loader_ | 
| std::vector< boost::shared_ptr< hector_geotiff::MapWriterPluginInterface > > | plugin_vector_ | 
| ros::NodeHandle | pn_ | 
| unsigned int | running_saved_map_num_ | 
| ros::Subscriber | sys_cmd_sub_ | 
Map generation node.
Definition at line 59 of file geotiff_node.cpp.
| 
 | inline | 
Definition at line 62 of file geotiff_node.cpp.
| 
 | inline | 
Definition at line 122 of file geotiff_node.cpp.
| 
 | inline | 
Definition at line 53 of file geotiff_saver.cpp.
| 
 | inline | 
Definition at line 60 of file geotiff_saver.cpp.
| 
 | inline | 
Definition at line 260 of file geotiff_node.cpp.
| 
 | inline | 
Definition at line 255 of file geotiff_node.cpp.
| 
 | inline | 
No Victims for now, first agree on a common standard for representation
Definition at line 129 of file geotiff_node.cpp.
| GeotiffWriter hector_geotiff::MapGenerator::geotiff_writer | 
Definition at line 76 of file geotiff_saver.cpp.
| GeotiffWriter hector_geotiff::MapGenerator::geotiff_writer_ | 
Definition at line 277 of file geotiff_node.cpp.
| ros::Timer hector_geotiff::MapGenerator::map_save_timer_ | 
Definition at line 292 of file geotiff_node.cpp.
| ros::ServiceClient hector_geotiff::MapGenerator::map_service_client_ | 
Definition at line 279 of file geotiff_node.cpp.
| ros::Subscriber hector_geotiff::MapGenerator::map_sub_ | 
Definition at line 79 of file geotiff_saver.cpp.
| std::string hector_geotiff::MapGenerator::mapname_ | 
Definition at line 78 of file geotiff_saver.cpp.
| ros::NodeHandle hector_geotiff::MapGenerator::n_ | 
Definition at line 285 of file geotiff_node.cpp.
| ros::ServiceClient hector_geotiff::MapGenerator::object_service_client_ | 
Definition at line 280 of file geotiff_node.cpp.
| bool hector_geotiff::MapGenerator::p_draw_background_checkerboard_ | 
Definition at line 272 of file geotiff_node.cpp.
| bool hector_geotiff::MapGenerator::p_draw_free_space_grid_ | 
Definition at line 273 of file geotiff_node.cpp.
| std::string hector_geotiff::MapGenerator::p_map_file_base_name_ | 
Definition at line 270 of file geotiff_node.cpp.
| std::string hector_geotiff::MapGenerator::p_map_file_path_ | 
Definition at line 269 of file geotiff_node.cpp.
| std::string hector_geotiff::MapGenerator::p_plugin_list_ | 
Definition at line 271 of file geotiff_node.cpp.
| ros::ServiceClient hector_geotiff::MapGenerator::path_service_client_ | 
Definition at line 281 of file geotiff_node.cpp.
| pluginlib::ClassLoader<hector_geotiff::MapWriterPluginInterface>* hector_geotiff::MapGenerator::plugin_loader_ | 
Definition at line 290 of file geotiff_node.cpp.
| std::vector<boost::shared_ptr<hector_geotiff::MapWriterPluginInterface> > hector_geotiff::MapGenerator::plugin_vector_ | 
Definition at line 288 of file geotiff_node.cpp.
| ros::NodeHandle hector_geotiff::MapGenerator::pn_ | 
Definition at line 286 of file geotiff_node.cpp.
| unsigned int hector_geotiff::MapGenerator::running_saved_map_num_ | 
Definition at line 294 of file geotiff_node.cpp.
| ros::Subscriber hector_geotiff::MapGenerator::sys_cmd_sub_ | 
Definition at line 283 of file geotiff_node.cpp.