Classes | Defines | Functions | Variables
main.cpp File Reference
#include <stdio.h>
#include <stdlib.h>
#include <libgen.h>
#include <fstream>
#include "ros/ros.h"
#include "ros/console.h"
#include "map_server/image_loader.h"
#include "std_msgs/String.h"
#include "nav_msgs/MapMetaData.h"
#include "yaml-cpp/yaml.h"
Include dependency graph for main.cpp:

Go to the source code of this file.

Classes

class  MapServer

Defines

#define USAGE

Functions

int main (int argc, char **argv)
bool mapCallback (nav_msgs::GetMap::Request &req, nav_msgs::GetMap::Response &res)
void MapSelect (const std_msgs::StringConstPtr &msg)

Variables

std::string current_map
std::map< std::string, MapServermsv

Define Documentation

#define USAGE
Value:
"\nUSAGE: map_server <map.yaml>\n" \
              "  map.yaml: map description file\n" \
              "DEPRECATED USAGE: map_server <map> <resolution>\n" \
              "  map: image file to load\n"\
              "  resolution: map resolution [meters/pixel]"

Definition at line 32 of file main.cpp.


Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 236 of file main.cpp.

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

Definition at line 220 of file main.cpp.

void MapSelect ( const std_msgs::StringConstPtr &  msg)

Definition at line 228 of file main.cpp.


Variable Documentation

std::string current_map

Definition at line 218 of file main.cpp.

std::map< std::string, MapServer > msv

Definition at line 217 of file main.cpp.



multi_map_server
Author(s): Manabu Saito
autogenerated on Fri Sep 8 2017 03:39:24