43 std::string full_param_name;
44 nav_2d_msgs::Polygon2D footprint;
54 else if (nh.
searchParam(
"robot_radius", full_param_name))
56 double robot_radius = 0.0;
57 nh.
getParam(full_param_name, robot_radius);
61 nh.
setParam(
"robot_radius", robot_radius);
A set of utility functions for Bounds objects interacting with other messages/types.
nav_2d_msgs::Polygon2D polygonFromParams(const ros::NodeHandle &nh, const std::string parameter_name, bool search=true)
Load a polygon from a parameter, whether it is a string or array, or two arrays.
nav_2d_msgs::Polygon2D footprintFromParams(ros::NodeHandle &nh, bool write=true)
Load the robot footprint either as a polygon from the footprint parameter or from robot_radius...
nav_2d_msgs::Polygon2D polygonFromRadius(const double radius, const unsigned int num_points=16)
Create a "circular" polygon from a given radius.
bool searchParam(const std::string &key, std::string &result) const
bool getParam(const std::string &key, std::string &s) const
void setParam(const std::string &key, const XmlRpc::XmlRpcValue &v) const
XmlRpc::XmlRpcValue polygonToXMLRPC(const nav_2d_msgs::Polygon2D &polygon, bool array_of_arrays=true)
Create XMLRPC Value for writing the polygon to the parameter server.