Go to the source code of this file.
|
template<typename Key , typename Value > |
const Value & | mbf_costmap_nav::findWithDefault (const boost::unordered_map< Key, Value > &map, const Key &key, const Value &default_value) |
|
static std::string | mbf_costmap_nav::getStringElement (const XmlRpc::XmlRpcValue &value, const std::string &tag) |
| Returns a string element with the tag from value. More...
|
|
StringToMap | mbf_costmap_nav::loadStringToMaps (const std::string &resource, const ros::NodeHandle &nh, const CostmapWrapper::Ptr &global_costmap_ptr, const CostmapWrapper::Ptr &local_costmap_ptr) |
| Non-throwing version of loadStringToMapsImpl. More...
|
|
StringToMap | mbf_costmap_nav::loadStringToMapsImpl (const std::string &resource, const ros::NodeHandle &nh, const CostmapWrapper::Ptr &global_costmap_ptr, const CostmapWrapper::Ptr &local_costmap_ptr) |
| Returns the mapping from 'names' to 'costmaps' for the defined resource. More...
|
|