Go to the documentation of this file.00001 #ifndef COMMON_H_
00002 #define COMMON_H_
00003
00004 #include <geometry_msgs/PoseStamped.h>
00005 #include <visualization_msgs/InteractiveMarker.h>
00006
00007 class Common
00008 {
00009
00010 public:
00011
00012 Common();
00013
00014 static visualization_msgs::InteractiveMarker makeGripperMarker(geometry_msgs::PoseStamped pose);
00015
00016 private:
00017
00018 static visualization_msgs::Marker createGripperMeshMarker(double x, double y, double z, double rx, double ry, double rz, double rw, std::string meshLocation);
00019 };
00020
00021 #endif