#include <string>
#include <boost/thread/thread.hpp>
#include <boost/thread/mutex.hpp>
#include <ros/ros.h>
#include <visualization_msgs/Marker.h>
#include <geometry_msgs/PoseStamped.h>
Go to the source code of this file.
Classes | |
class | object_manipulator::GraspMarkerPublisher |
Publishes and keeps track of debug grasp markers. More... | |
Namespaces | |
namespace | object_manipulator |
Helper functions for using image regions of PointCloud2s. |