ParamR.h
Go to the documentation of this file.
00001 #include <ros/ros.h>
00002 #include <ros/package.h>
00003 #include <std_msgs/String.h>
00004 #include <topic_tools/shape_shifter.h>
00005 
00006 char* rrosGetParamType(ros::NodeHandle* handle, char* param);
00007 
00008 bool rrosGetParamBoolean(ros::NodeHandle* handle, char* param);
00009 int rrosGetParamInteger(ros::NodeHandle* handle, char* param);
00010 double rrosGetParamDouble(ros::NodeHandle* handle, char* param);
00011 char* rrosGetParamString(ros::NodeHandle* handle, char* param);
00012 
00013 void rrosSetParamBoolean(ros::NodeHandle* handle, char* param, bool val);
00014 void rrosSetParamInteger(ros::NodeHandle* handle, char* param, int val);
00015 void rrosSetParamDouble (ros::NodeHandle* handle, char* param, double val);
00016 void rrosSetParamString (ros::NodeHandle* handle, char* param, char* val);
00017 
00018 void rrosDeleteParam (ros::NodeHandle* handle, char* param);


rosR
Author(s): André Dietrich, Sebastian Zug
autogenerated on Sun Jan 5 2014 11:10:28