38 #ifndef NAV_CORE_PARAMETER_MAGIC_H 39 #define NAV_CORE_PARAMETER_MAGIC_H 52 template<
class param_t>
54 const std::string old_name,
const param_t& default_value)
64 ROS_WARN(
"Parameter %s is deprecated. Please use the name %s instead.", old_name.c_str(), current_name.c_str());
80 ROS_WARN(
"Parameter %s is deprecated (and will not load properly). Use %s instead.", old_name.c_str(), current_name.c_str());
86 #endif // NAV_CORE_PARAMETER_MAGIC_H
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.
bool getParam(const std::string &key, std::string &s) const
bool hasParam(const std::string &key) const
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.