#include <stdio.h>
#include <stdlib.h>
#include <libgen.h>
#include <fstream>
#include <string>
#include "ros/ros.h"
#include "map_server/image_loader.h"
#include "nav_msgs/MapMetaData.h"
#include "yaml-cpp/yaml.h"
Go to the source code of this file.
Namespaces | |
namespace | map_loader |
The namespace for STDR map loader. | |
namespace | stdr_server |
The main namespace for STDR Server. | |
namespace | stdr_server::map_loader |
Functions | |
nav_msgs::OccupancyGrid | stdr_server::map_loader::loadMap (const std::string &fname) |
Loads a map from an image file. |