Classes | |
class | BaseGlobalPlanner |
Provides an interface for global planners used in navigation. All global planners written as plugins for the navigation stack must adhere to this interface. More... | |
class | BaseLocalPlanner |
Provides an interface for local planners used in navigation. All local planners written as plugins for the navigation stack must adhere to this interface. More... | |
class | RecoveryBehavior |
Provides an interface for recovery behaviors used in navigation. All recovery behaviors written as plugins for the navigation stack must adhere to this interface. More... | |
Functions | |
template<class param_t > | |
param_t | loadParameterWithDeprecation (const ros::NodeHandle &nh, const std::string current_name, const std::string old_name, const param_t &default_value) |
Load a parameter from one of two namespaces. Complain if it uses the old name. More... | |
void | warnRenamedParameter (const ros::NodeHandle &nh, const std::string current_name, const std::string old_name) |
Warn if a parameter exists under a deprecated (and unsupported) name. More... | |
param_t nav_core::loadParameterWithDeprecation | ( | const ros::NodeHandle & | nh, |
const std::string | current_name, | ||
const std::string | old_name, | ||
const param_t & | default_value | ||
) |
Load a parameter from one of two namespaces. Complain if it uses the old name.
nh | NodeHandle to look for the parameter in |
current_name | Parameter name that is current, i.e. not deprecated |
old_name | Deprecated parameter name |
default_value | If neither parameter is present, return this value |
Definition at line 88 of file parameter_magic.h.
void nav_core::warnRenamedParameter | ( | const ros::NodeHandle & | nh, |
const std::string | current_name, | ||
const std::string | old_name | ||
) |
Warn if a parameter exists under a deprecated (and unsupported) name.
Parameters loaded exclusively through dynamic reconfigure can't really use loadParamWithDeprecation.
Definition at line 111 of file parameter_magic.h.