GripperMarkerVis.h
Go to the documentation of this file.
00001 #ifndef GRIPPER_MARKER_VIS_H_
00002 #define GRIPPER_MARKER_VIS_H_
00003 
00004 #include <ros/ros.h>
00005 #include <interactive_markers/interactive_marker_server.h>
00006 #include <remote_manipulation_markers/Common.h>
00007 
00008 class GripperMarkerVis
00009 {
00010 
00011 public:
00012 
00016   GripperMarkerVis();
00017 
00018 private:
00019   void markerPoseCallback(const geometry_msgs::PoseStamped& pose);
00020 
00021   ros::NodeHandle n, pnh;
00022 
00023   //messages
00024   ros::Subscriber markerPoseSubscriber;
00025 
00026   boost::shared_ptr<interactive_markers::InteractiveMarkerServer> imServer; 
00027 };
00028 
00029 #endif


remote_manipulation_markers
Author(s): David Kent
autogenerated on Thu Jun 6 2019 22:05:39