#include "planner_modules_pr2/module_param_cache.h"
Go to the source code of this file.
Functions | |
std::string | createPoseParamString (const geometry_msgs::Pose &pose, double precPose, double precQuat) |
Create a string from a Pose that is unique and can be stored in the param daemon. |
std::string createPoseParamString | ( | const geometry_msgs::Pose & | pose, |
double | precPose, | ||
double | precQuat | ||
) |
Create a string from a Pose that is unique and can be stored in the param daemon.
Definition at line 3 of file module_param_cache.cpp.