messages.h
Go to the documentation of this file.
1 /*
2  * Software License Agreement (BSD License)
3  *
4  * Copyright (c) 2014, Andreas ten Pas
5  * All rights reserved.
6  *
7  * Redistribution and use in source and binary forms, with or without
8  * modification, are permitted provided that the following conditions
9  * are met:
10  *
11  * * Redistributions of source code must retain the above copyright
12  * notice, this list of conditions and the following disclaimer.
13  * * Redistributions in binary form must reproduce the above
14  * copyright notice, this list of conditions and the following
15  * disclaimer in the documentation and/or other materials provided
16  * with the distribution.
17  *
18  * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
19  * "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
20  * LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
21  * FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
22  * COPYRIGHT OWNER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT,
23  * INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING,
24  * BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES;
25  * LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER
26  * CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
27  * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN
28  * ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
29  * POSSIBILITY OF SUCH DAMAGE.
30  */
31 
32 #ifndef MESSAGES_H
33 #define MESSAGES_H
34 
35 #include "handle_detector/CylinderArrayMsg.h"
36 #include "handle_detector/CylinderMsg.h"
37 #include "handle_detector/HandleListMsg.h"
38 #include "cylindrical_shell.h"
40 #include <geometry_msgs/Pose.h>
41 #include <geometry_msgs/PoseArray.h>
42 #include <geometry_msgs/PoseStamped.h>
44 #include <tf/transform_datatypes.h>
45 
50 class Messages
51 {
52 public:
57  handle_detector::CylinderArrayMsg
58  createCylinderArray(const std::vector<CylindricalShell> &list, std::string frame);
59 
64  handle_detector::CylinderMsg
65  createCylinder(const CylindricalShell &shell, std::string frame);
66 
71  handle_detector::HandleListMsg
72  createHandleList(const std::vector<std::vector<CylindricalShell> > &handles, std::string frame);
73 };
74 
75 #endif
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.
Definition: messages.cpp:3
handle_detector::HandleListMsg createHandleList(const std::vector< std::vector< CylindricalShell > > &handles, std::string frame)
Create a HandleList message from a list of cylindrical shells.
Definition: messages.cpp:55
handle_detector::CylinderMsg createCylinder(const CylindricalShell &shell, std::string frame)
Create a Cylinder message from a cylindrical shell.
Definition: messages.cpp:19
Messages creates custom ROS messages to publish the results of the localization. The messages that ca...
Definition: messages.h:50


handle_detector
Author(s):
autogenerated on Mon Jun 10 2019 13:29:00