This is the complete list of members for global_planner_tests::EasyCostmap, including all inherited members.
canTrackChanges() | nav_core2::Costmap | virtual |
data_ | nav_core2::BasicCostmap | protected |
EasyCostmap(const std::string &filename, const double resolution=0.1, const bool origin_at_center=false) | global_planner_tests::EasyCostmap | explicit |
EasyCostmap() | global_planner_tests::EasyCostmap | inline |
FREE_SPACE | nav_core2::Costmap | static |
getChangeBounds(const std::string &ns) | nav_core2::Costmap | virtual |
getCost(const unsigned int x, const unsigned int y) | nav_core2::Costmap | |
getCost(const nav_grid::Index &index) | nav_core2::Costmap | |
getIndex(const unsigned int x, const unsigned int y) const | nav_core2::BasicCostmap | |
getMutex() override | nav_core2::BasicCostmap | virtual |
getValue(const unsigned int x, const unsigned int y) const override | nav_core2::BasicCostmap | |
initialize(const ros::NodeHandle &parent, const std::string &name, TFListenerPtr tf) | nav_core2::Costmap | virtual |
INSCRIBED_INFLATED_OBSTACLE | nav_core2::Costmap | static |
LETHAL_OBSTACLE | nav_core2::Costmap | static |
loadMapFromFile(const std::string &filename, const double resolution=0.1, const bool origin_at_center=false) | global_planner_tests::EasyCostmap | |
mutex_t typedef | nav_core2::Costmap | |
my_mutex_ | nav_core2::BasicCostmap | protected |
NO_INFORMATION | nav_core2::Costmap | static |
original_grid_ | global_planner_tests::EasyCostmap | protected |
Ptr typedef | nav_core2::Costmap | |
reset() override | global_planner_tests::EasyCostmap | |
setCost(const unsigned int x, const unsigned int y, const unsigned char cost) | nav_core2::Costmap | |
setCost(const nav_grid::Index &index, const unsigned char cost) | nav_core2::Costmap | |
setInfo(const nav_grid::NavGridInfo &new_info) override | nav_core2::BasicCostmap | |
setValue(const unsigned int x, const unsigned int y, const unsigned char &value) override | nav_core2::BasicCostmap | |
update() | nav_core2::Costmap | virtual |
~Costmap() | nav_core2::Costmap | virtual |