35 #ifndef GLOBAL_PLANNER_TESTS_EASY_COSTMAP_H 36 #define GLOBAL_PLANNER_TESTS_EASY_COSTMAP_H 39 #include <nav_msgs/OccupancyGrid.h> 57 explicit EasyCostmap(
const std::string&
filename,
const double resolution = 0.1,
const bool origin_at_center =
false);
65 void reset()
override;
68 void loadMapFromFile(
const std::string& filename,
const double resolution = 0.1,
const bool origin_at_center =
false);
75 #endif // GLOBAL_PLANNER_TESTS_EASY_COSTMAP_H
nav_msgs::OccupancyGrid original_grid_
An instantiation of the Costmap class that simply populates the grid from an image.
EasyCostmap()
Empty constructor. You need to call loadMapFromFile afterward.
void loadMapFromFile(const std::string &filename, const double resolution=0.1, const bool origin_at_center=false)