Public Member Functions | Private Member Functions | Private Attributes
MapServer Class Reference

List of all members.

Public Member Functions

 MapServer (const std::string &fname, double res)

Private Member Functions

bool mapCallback (nav_msgs::GetMap::Request &req, nav_msgs::GetMap::Response &res)

Private Attributes

bool deprecated
ros::Publisher map_pub
nav_msgs::GetMap::Response map_resp_
nav_msgs::MapMetaData meta_data_message_
ros::Publisher metadata_pub
ros::NodeHandle n
ros::ServiceServer service

Detailed Description

Definition at line 49 of file main.cpp.


Constructor & Destructor Documentation

MapServer::MapServer ( const std::string &  fname,
double  res 
) [inline]

Trivial constructor

Definition at line 53 of file main.cpp.


Member Function Documentation

bool MapServer::mapCallback ( nav_msgs::GetMap::Request &  req,
nav_msgs::GetMap::Response &  res 
) [inline, private]

Callback invoked when someone requests our service

Definition at line 164 of file main.cpp.


Member Data Documentation

bool MapServer::deprecated [private]

Definition at line 161 of file main.cpp.

Definition at line 158 of file main.cpp.

nav_msgs::GetMap::Response MapServer::map_resp_ [private]

Definition at line 179 of file main.cpp.

nav_msgs::MapMetaData MapServer::meta_data_message_ [private]

The map data is cached here, to be sent out to service callers

Definition at line 178 of file main.cpp.

Definition at line 159 of file main.cpp.

Definition at line 157 of file main.cpp.

Definition at line 160 of file main.cpp.


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


map_server
Author(s): Brian Gerkey, Tony Pratkanis
autogenerated on Mon Oct 6 2014 02:44:29