#include "cartographer_ros/map_writer.h"
#include <fstream>
#include "glog/logging.h"
#include "yaml-cpp/yaml.h"
Go to the source code of this file.
Namespaces | |
cartographer_ros | |
Functions | |
void | cartographer_ros::WriteOccupancyGridToPgmAndYaml (const ::nav_msgs::OccupancyGrid &occupancy_grid, const std::string &stem) |