Public Member Functions | Protected Attributes
nav_core_adapter::CostmapAdapter Class Reference

#include <costmap_adapter.h>

Inheritance diagram for nav_core_adapter::CostmapAdapter:
Inheritance graph
[legend]

List of all members.

Public Member Functions

costmap_2d::Costmap2DROSgetCostmap2DROS () const
nav_core2::Costmap::mutex_t * getMutex () override
unsigned char getValue (const unsigned int x, const unsigned int y) const override
void initialize (costmap_2d::Costmap2DROS *costmap_ros, bool needs_destruction=false)
 Initialize from an existing Costmap2DROS object.
void initialize (const ros::NodeHandle &parent, const std::string &name, TFListenerPtr tf) override
void reset () override
void setInfo (const nav_grid::NavGridInfo &new_info) override
void setValue (const unsigned int x, const unsigned int y, const unsigned char &value) override
void update () override
void updateInfo (const nav_grid::NavGridInfo &new_info) override
virtual ~CostmapAdapter ()
 Deconstructor for possibly freeing the costmap_ros_ object.

Protected Attributes

costmap_2d::Costmap2Dcostmap_
costmap_2d::Costmap2DROScostmap_ros_
bool needs_destruction_

Detailed Description

Definition at line 47 of file costmap_adapter.h.


Constructor & Destructor Documentation

Deconstructor for possibly freeing the costmap_ros_ object.

Definition at line 58 of file costmap_adapter.cpp.


Member Function Documentation

Definition at line 75 of file costmap_adapter.h.

nav_core2::Costmap::mutex_t * nav_core_adapter::CostmapAdapter::getMutex ( ) [override, virtual]

Implements nav_core2::Costmap.

Definition at line 79 of file costmap_adapter.cpp.

unsigned char nav_core_adapter::CostmapAdapter::getValue ( const unsigned int  x,
const unsigned int  y 
) const [override]

Definition at line 101 of file costmap_adapter.cpp.

void nav_core_adapter::CostmapAdapter::initialize ( costmap_2d::Costmap2DROS costmap_ros,
bool  needs_destruction = false 
)

Initialize from an existing Costmap2DROS object.

Parameters:
costmap_rosA Costmap2DROS object
needs_destructionWhether to free the costmap_ros object when this class is destroyed

Definition at line 66 of file costmap_adapter.cpp.

void nav_core_adapter::CostmapAdapter::initialize ( const ros::NodeHandle parent,
const std::string &  name,
TFListenerPtr  tf 
) [override, virtual]

Reimplemented from nav_core2::Costmap.

Definition at line 74 of file costmap_adapter.cpp.

Definition at line 84 of file costmap_adapter.cpp.

Definition at line 107 of file costmap_adapter.cpp.

void nav_core_adapter::CostmapAdapter::setValue ( const unsigned int  x,
const unsigned int  y,
const unsigned char &  value 
) [override]

Definition at line 96 of file costmap_adapter.cpp.

void nav_core_adapter::CostmapAdapter::update ( ) [override, virtual]

Reimplemented from nav_core2::Costmap.

Definition at line 89 of file costmap_adapter.cpp.

Definition at line 112 of file costmap_adapter.cpp.


Member Data Documentation

Definition at line 79 of file costmap_adapter.h.

Definition at line 78 of file costmap_adapter.h.

Definition at line 80 of file costmap_adapter.h.


The documentation for this class was generated from the following files:


nav_core_adapter
Author(s):
autogenerated on Wed Jun 26 2019 20:09:49