Public Member Functions | Public Attributes | List of all members
MapGenerator Class Reference

Map generation node. More...

Public Member Functions

void mapCallback (const nav_msgs::OccupancyGridConstPtr &map)
 
 MapGenerator (const std::string &mapname, int threshold_occupied=100, int threshold_free=0)
 

Public Attributes

ros::Subscriber map_sub_
 
std::string mapname_
 
bool saved_map_
 
int threshold_free_
 
int threshold_occupied_
 

Detailed Description

Map generation node.

Definition at line 43 of file map_saver.cpp.

Constructor & Destructor Documentation

MapGenerator::MapGenerator ( const std::string &  mapname,
int  threshold_occupied = 100,
int  threshold_free = 0 
)
inline

Definition at line 47 of file map_saver.cpp.

Member Function Documentation

void MapGenerator::mapCallback ( const nav_msgs::OccupancyGridConstPtr &  map)
inline

Definition at line 55 of file map_saver.cpp.

Member Data Documentation

ros::Subscriber MapGenerator::map_sub_

Definition at line 125 of file map_saver.cpp.

std::string MapGenerator::mapname_

Definition at line 124 of file map_saver.cpp.

bool MapGenerator::saved_map_

Definition at line 126 of file map_saver.cpp.

int MapGenerator::threshold_free_

Definition at line 128 of file map_saver.cpp.

int MapGenerator::threshold_occupied_

Definition at line 127 of file map_saver.cpp.


The documentation for this class was generated from the following file:


map_server
Author(s): Brian Gerkey, Tony Pratkanis, contradict@gmail.com
autogenerated on Thu Jan 21 2021 04:05:35