boost::recursive_mutex mutex_t
unsigned char * getCharMap() const
double getOriginX() const
virtual ~CostmapAdapter()
Deconstructor for possibly freeing the costmap_ros_ object.
nav_core2::Costmap::mutex_t * getMutex() override
#define PLUGINLIB_EXPORT_CLASS(class_type, base_class_type)
void setCost(unsigned int mx, unsigned int my, unsigned char cost)
nav_grid::NavGridInfo infoFromCostmap(costmap_2d::Costmap2DROS *costmap_ros)
unsigned char getValue(const unsigned int x, const unsigned int y) const override
unsigned int getSizeInCellsY() const
void setInfo(const nav_grid::NavGridInfo &new_info) override
costmap_2d::Costmap2DROS * costmap_ros_
void updateInfo(const nav_grid::NavGridInfo &new_info) override
double getOriginY() const
void setValue(const unsigned int x, const unsigned int y, const unsigned char &value) override
std::shared_ptr< tf2_ros::Buffer > TFListenerPtr
void initialize(costmap_2d::Costmap2DROS *costmap_ros, bool needs_destruction=false)
Initialize from an existing Costmap2DROS object.
double getResolution() const
virtual void updateOrigin(double new_origin_x, double new_origin_y)
unsigned int getIndex(unsigned int mx, unsigned int my) const
Costmap2D * getCostmap() const
unsigned int getSizeInCellsX() const
const std::string & getGlobalFrameID() const noexcept
costmap_2d::Costmap2D * costmap_