|
unsigned int | getIndex (const unsigned int x, const unsigned int y) const |
|
mutex_t * | getMutex () override |
| Accessor for boost mutex. More...
|
|
unsigned char | getValue (const unsigned int x, const unsigned int y) const 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 |
|
virtual bool | canTrackChanges () |
| Flag to indicate whether this costmap is able to track how much has changed. More...
|
|
virtual UIntBounds | getChangeBounds (const std::string &ns) |
| If canTrackChanges, get the bounding box for how much of the costmap has changed. More...
|
|
unsigned char | getCost (const unsigned int x, const unsigned int y) |
|
unsigned char | getCost (const nav_grid::Index &index) |
|
virtual void | initialize (const ros::NodeHandle &parent, const std::string &name, TFListenerPtr tf) |
| Initialization function for the Costmap. More...
|
|
void | setCost (const unsigned int x, const unsigned int y, const unsigned char cost) |
|
void | setCost (const nav_grid::Index &index, const unsigned char cost) |
|
virtual void | update () |
| Update the values in the costmap. More...
|
|
virtual | ~Costmap () |
| Virtual Destructor. More...
|
|
std::string | getFrameId () const |
|
unsigned int | getHeight () const |
|
NavGridInfo | getInfo () const |
|
double | getOriginX () const |
|
double | getOriginY () const |
|
double | getResolution () const |
|
T | getValue (const Index &index) |
|
T | getValue (const Index &index) |
|
unsigned int | getWidth () const |
|
| NavGrid (const T default_value=T{}) |
|
T | operator() (const Index &index) const |
|
T | operator() (const unsigned int x, const unsigned int y) const |
|
T | operator() (const Index &index) const |
|
T | operator() (const unsigned int x, const unsigned int y) const |
|
void | setDefaultValue (const T new_value) |
|
void | setValue (const Index &index, const T &value) |
|
void | setValue (const Index &index, const T &value) |
|
virtual void | setValue (const unsigned int x, const unsigned int y, const T &value)=0 |
|
virtual void | updateInfo (const NavGridInfo &new_info) |
|
Definition at line 44 of file basic_costmap.h.