35 #include "handle_detector/CylinderArrayMsg.h" 36 #include "handle_detector/CylinderMsg.h" 37 #include "handle_detector/HandleListMsg.h" 40 #include <geometry_msgs/Pose.h> 41 #include <geometry_msgs/PoseArray.h> 42 #include <geometry_msgs/PoseStamped.h> 57 handle_detector::CylinderArrayMsg
64 handle_detector::CylinderMsg
71 handle_detector::HandleListMsg
72 createHandleList(
const std::vector<std::vector<CylindricalShell> > &handles, std::string frame);
CylindricalShell represents a cylindrical shell that consists of two colinear cylinders. A shell consists of an inner and an outer cylinder. The portion of the object to be grasped must fit inside the inner cylinder, and the radius of that cylinder must be no larger than the maximum hand aperture. The gap between the inner and outer cylinder must be free of obstacles and wide enough to be able to contain the robot fingers.
handle_detector::CylinderArrayMsg createCylinderArray(const std::vector< CylindricalShell > &list, std::string frame)
Create a CylinderArray message from a list of cylindrical shells.
handle_detector::HandleListMsg createHandleList(const std::vector< std::vector< CylindricalShell > > &handles, std::string frame)
Create a HandleList message from a list of cylindrical shells.
handle_detector::CylinderMsg createCylinder(const CylindricalShell &shell, std::string frame)
Create a Cylinder message from a cylindrical shell.
Messages creates custom ROS messages to publish the results of the localization. The messages that ca...