Classes | Functions
nav_core Namespace Reference

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...
 

Function Documentation

◆ loadParameterWithDeprecation()

template<class param_t >
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.

Parameters
nhNodeHandle to look for the parameter in
current_nameParameter name that is current, i.e. not deprecated
old_nameDeprecated parameter name
default_valueIf neither parameter is present, return this value
Returns
The value of the parameter or the default value

Definition at line 88 of file parameter_magic.h.

◆ warnRenamedParameter()

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.



nav_core
Author(s): Eitan Marder-Eppstein, contradict@gmail.com
autogenerated on Mon Mar 6 2023 03:50:21