|
bool | addLayerFromROSImage (const sensor_msgs::Image &image, const std::string &layer_name, cost_map::CostMap &cost_map) |
|
bool | fromCostmap2DROS (costmap_2d::Costmap2DROS &ros_costmap, const std::string &layer_name, cost_map::CostMap &cost_map) |
|
bool | fromCostmap2DROSAtRobotPose (costmap_2d::Costmap2DROS &ros_costmap, const cost_map::Length &geometry, const std::string &layer_name, cost_map::CostMap &cost_map) |
|
void | fromImageBundle (const std::string &filename, cost_map::CostMap &cost_map) |
|
bool | fromMessage (const cost_map_msgs::CostMap &message, cost_map::CostMap &cost_map) |
|
std::string | resolveResourceName (const std::string &resource_name) |
|
void | toGridMap (const cost_map::CostMap cost_map, grid_map::GridMap &grid_map) |
|
void | toImageBundle (const std::string &filename, const cost_map::CostMap &cost_map) |
|
void | toMessage (const cost_map::CostMap &cost_map, cost_map_msgs::CostMap &message) |
|
void | toOccupancyGrid (const cost_map::CostMap &cost_map, const std::string &layer, nav_msgs::OccupancyGrid &msg) |
|