Typedefs | Functions | Variables
map_manager.cpp File Reference
#include <mongo_ros/message_collection.h>
#include <ros/ros.h>
#include <nav_msgs/OccupancyGrid.h>
#include <map_store/ListMaps.h>
#include <map_store/PublishMap.h>
#include <map_store/DeleteMap.h>
#include <map_store/RenameMap.h>
#include <map_store/MapListEntry.h>
#include <nav_msgs/GetMap.h>
#include <string>
#include <sstream>
#include <exception>
Include dependency graph for map_manager.cpp:

Go to the source code of this file.

Typedefs

typedef std::vector
< mr::MessageWithMetadata
< nav_msgs::OccupancyGrid >
::ConstPtr > 
MapVector

Functions

bool deleteMap (map_store::DeleteMap::Request &request, map_store::DeleteMap::Response &response)
bool dynamicMap (nav_msgs::GetMap::Request &request, nav_msgs::GetMap::Response &response)
bool listMaps (map_store::ListMaps::Request &request, map_store::ListMaps::Response &response)
bool lookupMap (std::string name, nav_msgs::OccupancyGridConstPtr &ptr)
int main (int argc, char **argv)
bool publishMap (map_store::PublishMap::Request &request, map_store::PublishMap::Response &response)
bool renameMap (map_store::RenameMap::Request &request, map_store::RenameMap::Response &response)

Variables

std::string last_map
mr::MessageCollection
< nav_msgs::OccupancyGrid > * 
map_collection
ros::Publisher map_publisher

Typedef Documentation

typedef std::vector<mr::MessageWithMetadata<nav_msgs::OccupancyGrid>::ConstPtr> MapVector

Definition at line 70 of file map_manager.cpp.


Function Documentation

bool deleteMap ( map_store::DeleteMap::Request &  request,
map_store::DeleteMap::Response &  response 
)

Definition at line 147 of file map_manager.cpp.

bool dynamicMap ( nav_msgs::GetMap::Request &  request,
nav_msgs::GetMap::Response &  response 
)

Definition at line 174 of file map_manager.cpp.

bool listMaps ( map_store::ListMaps::Request &  request,
map_store::ListMaps::Response &  response 
)

Definition at line 72 of file map_manager.cpp.

bool lookupMap ( std::string  name,
nav_msgs::OccupancyGridConstPtr &  ptr 
)

Definition at line 102 of file map_manager.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 191 of file map_manager.cpp.

bool publishMap ( map_store::PublishMap::Request &  request,
map_store::PublishMap::Response &  response 
)

Definition at line 121 of file map_manager.cpp.

bool renameMap ( map_store::RenameMap::Request &  request,
map_store::RenameMap::Response &  response 
)

Definition at line 166 of file map_manager.cpp.


Variable Documentation

std::string last_map

Definition at line 68 of file map_manager.cpp.

mr::MessageCollection<nav_msgs::OccupancyGrid>* map_collection

Definition at line 66 of file map_manager.cpp.

Definition at line 67 of file map_manager.cpp.



map_store
Author(s): Dave Hershberger
autogenerated on Wed Aug 26 2015 12:28:59