#include <mongo_ros/message_collection.h>
#include <ros/ros.h>
#include <nav_msgs/OccupancyGrid.h>
#include <nav_msgs/GetMap.h>
#include <map_store/SaveMap.h>
#include <string>
#include <sstream>
#include <uuid/uuid.h>
Go to the source code of this file.
Functions | |
int | main (int argc, char **argv) |
void | onMapReceived (const nav_msgs::OccupancyGrid::ConstPtr &map_msg) |
bool | saveMap (map_store::SaveMap::Request &req, map_store::SaveMap::Response &res) |
std::string | uuidGenerate () |
Variables | |
ros::ServiceClient | add_metadata_service_client |
ros::ServiceClient | dynamic_map_service_client |
mr::MessageCollection < nav_msgs::OccupancyGrid > * | map_collection |
std::string | session_id |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 102 of file map_saver.cpp.
void onMapReceived | ( | const nav_msgs::OccupancyGrid::ConstPtr & | map_msg | ) |
Definition at line 66 of file map_saver.cpp.
bool saveMap | ( | map_store::SaveMap::Request & | req, |
map_store::SaveMap::Response & | res | ||
) |
Definition at line 79 of file map_saver.cpp.
std::string uuidGenerate | ( | ) |
Definition at line 58 of file map_saver.cpp.
Definition at line 55 of file map_saver.cpp.
Definition at line 56 of file map_saver.cpp.
mr::MessageCollection<nav_msgs::OccupancyGrid>* map_collection |
Definition at line 54 of file map_saver.cpp.
std::string session_id |
Definition at line 53 of file map_saver.cpp.