1 #ifndef _RAPID_VIZ_CLOUD_POSER_H_
2 #define _RAPID_VIZ_CLOUD_POSER_H_
6 #include "geometry_msgs/Pose.h"
7 #include "interactive_markers/interactive_marker_server.h"
8 #include "pcl/point_cloud.h"
9 #include "pcl/point_types.h"
11 #include "sensor_msgs/PointCloud2.h"
12 #include "transform_graph/graph.h"
13 #include "visualization_msgs/InteractiveMarker.h"
14 #include "visualization_msgs/InteractiveMarkerControl.h"
43 CloudPoser(
const sensor_msgs::PointCloud2& cloud,
44 const ros::Publisher& cloud_pub,
const std::string& im_topic);
50 geometry_msgs::Pose
pose()
const;
51 void set_pose(
const geometry_msgs::Pose& pose);
55 const visualization_msgs::InteractiveMarkerFeedbackConstPtr& feedback);
58 sensor_msgs::PointCloud2 cloud_;
59 ros::Publisher cloud_pub_;
60 interactive_markers::InteractiveMarkerServer im_server_;
62 visualization_msgs::InteractiveMarker int_marker_;
63 geometry_msgs::Pose pose_;
66 transform_graph::Graph graph_;
71 #endif // _RAPID_VIZ_CLOUD_POSER_H_
static std::string int_marker_name()
void set_pose(const geometry_msgs::Pose &pose)
CloudPoser(const sensor_msgs::PointCloud2 &cloud, const ros::Publisher &cloud_pub, const std::string &im_topic)
geometry_msgs::Pose pose() const