Go to the documentation of this file.
35 #ifndef NAV_2D_UTILS_PARAMETERS_H
36 #define NAV_2D_UTILS_PARAMETERS_H
55 template<
class param_t>
58 std::string resolved_name;
76 template<
class param_t>
78 const std::string old_name,
const param_t& default_value)
88 ROS_WARN(
"Parameter %s is deprecated. Please use the name %s instead.", old_name.c_str(), current_name.c_str());
101 template<
class param_t>
107 ROS_WARN(
"Parameter %s is deprecated. Please use the name %s instead.", old_name.c_str(), current_name.c_str());
125 template<
class param_t>
127 std::string current_name, param_t default_value,
bool should_delete =
true)
150 #endif // NAV_2D_UTILS_PARAMETERS_H
param_t searchAndGetParam(const ros::NodeHandle &nh, const std::string ¶m_name, const param_t &default_value)
Search for a parameter and load it, or use the default value.
void setParam(const std::string &key, bool b) const
bool getParam(const std::string &key, bool &b) const
bool deleteParam(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.
bool searchParam(const std::string &key, std::string &result) const
void moveParameter(const ros::NodeHandle &nh, std::string old_name, std::string current_name, param_t default_value, bool should_delete=true)
Move a parameter from one place to another.
bool hasParam(const std::string &key) const
void moveDeprecatedParameter(const ros::NodeHandle &nh, const std::string current_name, const std::string old_name)
If a deprecated parameter exists, complain and move to its new location.
A set of utility functions for Bounds objects interacting with other messages/types.
T param(const std::string ¶m_name, const T &default_val) const
nav_2d_utils
Author(s):
autogenerated on Sun May 18 2025 02:47:23