An interface for publishing NavGridOfChars/OccupancyGrid msgs and their updates periodically. More...
#include <nav_grid_publisher.h>
Public Member Functions | |
void | setCostInterpretation (const std::vector< unsigned char > &cost_interpretation_table) |
Protected Member Functions | |
nav_msgs::OccupancyGrid | toOccupancyGrid (const ros::Time ×tamp) override |
map_msgs::OccupancyGridUpdate | toOccupancyGridUpdate (const nav_core2::UIntBounds &bounds, const ros::Time ×tamp) override |
An interface for publishing NavGridOfChars/OccupancyGrid msgs and their updates periodically.
Uses the cost_interpretation_table_ to define how to translate to OccupancyGrid messages
Definition at line 334 of file nav_grid_publisher.h.
void nav_grid_pub_sub::NavGridPublisher::setCostInterpretation | ( | const std::vector< unsigned char > & | cost_interpretation_table | ) | [inline] |
Definition at line 341 of file nav_grid_publisher.h.
nav_msgs::OccupancyGrid nav_grid_pub_sub::NavGridPublisher::toOccupancyGrid | ( | const ros::Time & | timestamp | ) | [inline, override, protected, virtual] |
Definition at line 346 of file nav_grid_publisher.h.
map_msgs::OccupancyGridUpdate nav_grid_pub_sub::NavGridPublisher::toOccupancyGridUpdate | ( | const nav_core2::UIntBounds & | bounds, |
const ros::Time & | timestamp | ||
) | [inline, override, protected, virtual] |
Definition at line 351 of file nav_grid_publisher.h.