#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"
 
Go to the source code of this file.
Define Documentation
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  | 
        
        
           | 
          ) | 
           |  | 
        
      
 
 
      
        
          | bool mapCallback  | 
          ( | 
          nav_msgs::GetMap::Request &  | 
          req,  | 
        
        
           | 
           | 
          nav_msgs::GetMap::Response &  | 
          res  | 
        
        
           | 
          ) | 
           |  | 
        
      
 
 
Variable Documentation