#include <string>
#include <map>
#include <ros/ros.h>
#include <geometry_msgs/Pose.h>
#include "module_param_cache.hpp"
Go to the source code of this file.
Classes | |
class | ModuleParamCache< ValueType > |
Typedefs | |
typedef ModuleParamCache< double > | ModuleParamCacheDouble |
typedef ModuleParamCache < std::string > | ModuleParamCacheString |
Functions | |
std::string | createPoseParamString (const geometry_msgs::Pose &ps, double precPose=0.0001, double precQuat=0.0001) |
Create a string from a Pose that is unique and can be stored in the param daemon. |
typedef ModuleParamCache<double> ModuleParamCacheDouble |
Definition at line 70 of file module_param_cache.h.
typedef ModuleParamCache<std::string> ModuleParamCacheString |
Definition at line 71 of file module_param_cache.h.
std::string createPoseParamString | ( | const geometry_msgs::Pose & | ps, |
double | precPose = 0.0001 , |
||
double | precQuat = 0.0001 |
||
) |
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.