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

List of all members.

Public Member Functions

bool mapCallback (nav_msgs::GetMap::Request &req, nav_msgs::GetMap::Response &res)
 MapServer (const std::string &fname, double res)
void SwitchPublisher (bool up)

Public Attributes

std::string map_id

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

Detailed Description

Definition at line 60 of file main.cpp.


Constructor & Destructor Documentation

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

Trivial constructor

Definition at line 64 of file main.cpp.


Member Function Documentation

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

Callback invoked when someone requests our service

Definition at line 183 of file main.cpp.

void MapServer::SwitchPublisher ( bool  up) [inline]

Definition at line 172 of file main.cpp.


Member Data Documentation

Definition at line 201 of file main.cpp.

std::string MapServer::map_id

Definition at line 195 of file main.cpp.

Definition at line 200 of file main.cpp.

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

Definition at line 206 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 205 of file main.cpp.

Definition at line 199 of file main.cpp.

Definition at line 198 of file main.cpp.


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


multi_map_server
Author(s): Manabu Saito
autogenerated on Mon Oct 6 2014 10:48:38