#include <cost_map_core/cost_map_core.hpp>
#include <cost_map_msgs/CostMap.h>
#include <mutex>
#include <ros/ros.h>
#include <std_msgs/String.h>
#include <string>
Go to the source code of this file.
Classes | |
class | cost_map::LoadImageBundle |
Helper for loading and publishing image bundles. More... | |
class | cost_map::SaveImageBundle |
Helper for saving an image bundle from a cost map topic. More... | |
Namespaces | |
cost_map | |
Functions | |
void | cost_map::fromImageBundle (const std::string &filename, cost_map::CostMap &cost_map) |
Initialises a adds a single layer from a yaml/image resource pair. More... | |
void | cost_map::toImageBundle (const std::string &filename, const cost_map::CostMap &cost_map) |
Dump a cost map to an image bundle set of files. More... | |