00001
00002 #ifndef GRASPIT_INTERFACE_MSGS_SERVICE_LOADOBSTACLE_H
00003 #define GRASPIT_INTERFACE_MSGS_SERVICE_LOADOBSTACLE_H
00004 #include <string>
00005 #include <vector>
00006 #include <map>
00007 #include <ostream>
00008 #include "ros/serialization.h"
00009 #include "ros/builtin_message_traits.h"
00010 #include "ros/message_operations.h"
00011 #include "ros/time.h"
00012
00013 #include "ros/macros.h"
00014
00015 #include "ros/assert.h"
00016
00017 #include "ros/service_traits.h"
00018
00019 #include "geometry_msgs/Pose.h"
00020
00021
00022
00023 namespace graspit_interface_msgs
00024 {
00025 template <class ContainerAllocator>
00026 struct LoadObstacleRequest_ {
00027 typedef LoadObstacleRequest_<ContainerAllocator> Type;
00028
00029 LoadObstacleRequest_()
00030 : file_name()
00031 , obstacle_pose()
00032 {
00033 }
00034
00035 LoadObstacleRequest_(const ContainerAllocator& _alloc)
00036 : file_name(_alloc)
00037 , obstacle_pose(_alloc)
00038 {
00039 }
00040
00041 typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > _file_name_type;
00042 std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > file_name;
00043
00044 typedef ::geometry_msgs::Pose_<ContainerAllocator> _obstacle_pose_type;
00045 ::geometry_msgs::Pose_<ContainerAllocator> obstacle_pose;
00046
00047
00048 private:
00049 static const char* __s_getDataType_() { return "graspit_interface_msgs/LoadObstacleRequest"; }
00050 public:
00051 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); }
00052
00053 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); }
00054
00055 private:
00056 static const char* __s_getMD5Sum_() { return "b57b981fa236c23216bbd63471c0ad21"; }
00057 public:
00058 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); }
00059
00060 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); }
00061
00062 private:
00063 static const char* __s_getServerMD5Sum_() { return "849362f1aa1b5a31b05a93a66798c64b"; }
00064 public:
00065 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); }
00066
00067 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); }
00068
00069 private:
00070 static const char* __s_getMessageDefinition_() { return "\n\
00071 \n\
00072 \n\
00073 \n\
00074 string file_name\n\
00075 \n\
00076 \n\
00077 geometry_msgs/Pose obstacle_pose\n\
00078 \n\
00079 ================================================================================\n\
00080 MSG: geometry_msgs/Pose\n\
00081 # A representation of pose in free space, composed of postion and orientation. \n\
00082 Point position\n\
00083 Quaternion orientation\n\
00084 \n\
00085 ================================================================================\n\
00086 MSG: geometry_msgs/Point\n\
00087 # This contains the position of a point in free space\n\
00088 float64 x\n\
00089 float64 y\n\
00090 float64 z\n\
00091 \n\
00092 ================================================================================\n\
00093 MSG: geometry_msgs/Quaternion\n\
00094 # This represents an orientation in free space in quaternion form.\n\
00095 \n\
00096 float64 x\n\
00097 float64 y\n\
00098 float64 z\n\
00099 float64 w\n\
00100 \n\
00101 "; }
00102 public:
00103 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); }
00104
00105 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); }
00106
00107 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const
00108 {
00109 ros::serialization::OStream stream(write_ptr, 1000000000);
00110 ros::serialization::serialize(stream, file_name);
00111 ros::serialization::serialize(stream, obstacle_pose);
00112 return stream.getData();
00113 }
00114
00115 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr)
00116 {
00117 ros::serialization::IStream stream(read_ptr, 1000000000);
00118 ros::serialization::deserialize(stream, file_name);
00119 ros::serialization::deserialize(stream, obstacle_pose);
00120 return stream.getData();
00121 }
00122
00123 ROS_DEPRECATED virtual uint32_t serializationLength() const
00124 {
00125 uint32_t size = 0;
00126 size += ros::serialization::serializationLength(file_name);
00127 size += ros::serialization::serializationLength(obstacle_pose);
00128 return size;
00129 }
00130
00131 typedef boost::shared_ptr< ::graspit_interface_msgs::LoadObstacleRequest_<ContainerAllocator> > Ptr;
00132 typedef boost::shared_ptr< ::graspit_interface_msgs::LoadObstacleRequest_<ContainerAllocator> const> ConstPtr;
00133 boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00134 };
00135 typedef ::graspit_interface_msgs::LoadObstacleRequest_<std::allocator<void> > LoadObstacleRequest;
00136
00137 typedef boost::shared_ptr< ::graspit_interface_msgs::LoadObstacleRequest> LoadObstacleRequestPtr;
00138 typedef boost::shared_ptr< ::graspit_interface_msgs::LoadObstacleRequest const> LoadObstacleRequestConstPtr;
00139
00140
00141 template <class ContainerAllocator>
00142 struct LoadObstacleResponse_ {
00143 typedef LoadObstacleResponse_<ContainerAllocator> Type;
00144
00145 LoadObstacleResponse_()
00146 : result(0)
00147 {
00148 }
00149
00150 LoadObstacleResponse_(const ContainerAllocator& _alloc)
00151 : result(0)
00152 {
00153 }
00154
00155 typedef int32_t _result_type;
00156 int32_t result;
00157
00158 enum { LOAD_SUCCESS = 0 };
00159 enum { LOAD_FAILURE = 1 };
00160
00161 private:
00162 static const char* __s_getDataType_() { return "graspit_interface_msgs/LoadObstacleResponse"; }
00163 public:
00164 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); }
00165
00166 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); }
00167
00168 private:
00169 static const char* __s_getMD5Sum_() { return "41e017e2964af6197c0f07ec9353afaf"; }
00170 public:
00171 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); }
00172
00173 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); }
00174
00175 private:
00176 static const char* __s_getServerMD5Sum_() { return "849362f1aa1b5a31b05a93a66798c64b"; }
00177 public:
00178 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); }
00179
00180 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); }
00181
00182 private:
00183 static const char* __s_getMessageDefinition_() { return "\n\
00184 int32 LOAD_SUCCESS = 0\n\
00185 int32 LOAD_FAILURE = 1\n\
00186 int32 result\n\
00187 \n\
00188 "; }
00189 public:
00190 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); }
00191
00192 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); }
00193
00194 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const
00195 {
00196 ros::serialization::OStream stream(write_ptr, 1000000000);
00197 ros::serialization::serialize(stream, result);
00198 return stream.getData();
00199 }
00200
00201 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr)
00202 {
00203 ros::serialization::IStream stream(read_ptr, 1000000000);
00204 ros::serialization::deserialize(stream, result);
00205 return stream.getData();
00206 }
00207
00208 ROS_DEPRECATED virtual uint32_t serializationLength() const
00209 {
00210 uint32_t size = 0;
00211 size += ros::serialization::serializationLength(result);
00212 return size;
00213 }
00214
00215 typedef boost::shared_ptr< ::graspit_interface_msgs::LoadObstacleResponse_<ContainerAllocator> > Ptr;
00216 typedef boost::shared_ptr< ::graspit_interface_msgs::LoadObstacleResponse_<ContainerAllocator> const> ConstPtr;
00217 boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00218 };
00219 typedef ::graspit_interface_msgs::LoadObstacleResponse_<std::allocator<void> > LoadObstacleResponse;
00220
00221 typedef boost::shared_ptr< ::graspit_interface_msgs::LoadObstacleResponse> LoadObstacleResponsePtr;
00222 typedef boost::shared_ptr< ::graspit_interface_msgs::LoadObstacleResponse const> LoadObstacleResponseConstPtr;
00223
00224 struct LoadObstacle
00225 {
00226
00227 typedef LoadObstacleRequest Request;
00228 typedef LoadObstacleResponse Response;
00229 Request request;
00230 Response response;
00231
00232 typedef Request RequestType;
00233 typedef Response ResponseType;
00234 };
00235 }
00236
00237 namespace ros
00238 {
00239 namespace message_traits
00240 {
00241 template<class ContainerAllocator> struct IsMessage< ::graspit_interface_msgs::LoadObstacleRequest_<ContainerAllocator> > : public TrueType {};
00242 template<class ContainerAllocator> struct IsMessage< ::graspit_interface_msgs::LoadObstacleRequest_<ContainerAllocator> const> : public TrueType {};
00243 template<class ContainerAllocator>
00244 struct MD5Sum< ::graspit_interface_msgs::LoadObstacleRequest_<ContainerAllocator> > {
00245 static const char* value()
00246 {
00247 return "b57b981fa236c23216bbd63471c0ad21";
00248 }
00249
00250 static const char* value(const ::graspit_interface_msgs::LoadObstacleRequest_<ContainerAllocator> &) { return value(); }
00251 static const uint64_t static_value1 = 0xb57b981fa236c232ULL;
00252 static const uint64_t static_value2 = 0x16bbd63471c0ad21ULL;
00253 };
00254
00255 template<class ContainerAllocator>
00256 struct DataType< ::graspit_interface_msgs::LoadObstacleRequest_<ContainerAllocator> > {
00257 static const char* value()
00258 {
00259 return "graspit_interface_msgs/LoadObstacleRequest";
00260 }
00261
00262 static const char* value(const ::graspit_interface_msgs::LoadObstacleRequest_<ContainerAllocator> &) { return value(); }
00263 };
00264
00265 template<class ContainerAllocator>
00266 struct Definition< ::graspit_interface_msgs::LoadObstacleRequest_<ContainerAllocator> > {
00267 static const char* value()
00268 {
00269 return "\n\
00270 \n\
00271 \n\
00272 \n\
00273 string file_name\n\
00274 \n\
00275 \n\
00276 geometry_msgs/Pose obstacle_pose\n\
00277 \n\
00278 ================================================================================\n\
00279 MSG: geometry_msgs/Pose\n\
00280 # A representation of pose in free space, composed of postion and orientation. \n\
00281 Point position\n\
00282 Quaternion orientation\n\
00283 \n\
00284 ================================================================================\n\
00285 MSG: geometry_msgs/Point\n\
00286 # This contains the position of a point in free space\n\
00287 float64 x\n\
00288 float64 y\n\
00289 float64 z\n\
00290 \n\
00291 ================================================================================\n\
00292 MSG: geometry_msgs/Quaternion\n\
00293 # This represents an orientation in free space in quaternion form.\n\
00294 \n\
00295 float64 x\n\
00296 float64 y\n\
00297 float64 z\n\
00298 float64 w\n\
00299 \n\
00300 ";
00301 }
00302
00303 static const char* value(const ::graspit_interface_msgs::LoadObstacleRequest_<ContainerAllocator> &) { return value(); }
00304 };
00305
00306 }
00307 }
00308
00309
00310 namespace ros
00311 {
00312 namespace message_traits
00313 {
00314 template<class ContainerAllocator> struct IsMessage< ::graspit_interface_msgs::LoadObstacleResponse_<ContainerAllocator> > : public TrueType {};
00315 template<class ContainerAllocator> struct IsMessage< ::graspit_interface_msgs::LoadObstacleResponse_<ContainerAllocator> const> : public TrueType {};
00316 template<class ContainerAllocator>
00317 struct MD5Sum< ::graspit_interface_msgs::LoadObstacleResponse_<ContainerAllocator> > {
00318 static const char* value()
00319 {
00320 return "41e017e2964af6197c0f07ec9353afaf";
00321 }
00322
00323 static const char* value(const ::graspit_interface_msgs::LoadObstacleResponse_<ContainerAllocator> &) { return value(); }
00324 static const uint64_t static_value1 = 0x41e017e2964af619ULL;
00325 static const uint64_t static_value2 = 0x7c0f07ec9353afafULL;
00326 };
00327
00328 template<class ContainerAllocator>
00329 struct DataType< ::graspit_interface_msgs::LoadObstacleResponse_<ContainerAllocator> > {
00330 static const char* value()
00331 {
00332 return "graspit_interface_msgs/LoadObstacleResponse";
00333 }
00334
00335 static const char* value(const ::graspit_interface_msgs::LoadObstacleResponse_<ContainerAllocator> &) { return value(); }
00336 };
00337
00338 template<class ContainerAllocator>
00339 struct Definition< ::graspit_interface_msgs::LoadObstacleResponse_<ContainerAllocator> > {
00340 static const char* value()
00341 {
00342 return "\n\
00343 int32 LOAD_SUCCESS = 0\n\
00344 int32 LOAD_FAILURE = 1\n\
00345 int32 result\n\
00346 \n\
00347 ";
00348 }
00349
00350 static const char* value(const ::graspit_interface_msgs::LoadObstacleResponse_<ContainerAllocator> &) { return value(); }
00351 };
00352
00353 template<class ContainerAllocator> struct IsFixedSize< ::graspit_interface_msgs::LoadObstacleResponse_<ContainerAllocator> > : public TrueType {};
00354 }
00355 }
00356
00357 namespace ros
00358 {
00359 namespace serialization
00360 {
00361
00362 template<class ContainerAllocator> struct Serializer< ::graspit_interface_msgs::LoadObstacleRequest_<ContainerAllocator> >
00363 {
00364 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00365 {
00366 stream.next(m.file_name);
00367 stream.next(m.obstacle_pose);
00368 }
00369
00370 ROS_DECLARE_ALLINONE_SERIALIZER;
00371 };
00372 }
00373 }
00374
00375
00376 namespace ros
00377 {
00378 namespace serialization
00379 {
00380
00381 template<class ContainerAllocator> struct Serializer< ::graspit_interface_msgs::LoadObstacleResponse_<ContainerAllocator> >
00382 {
00383 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00384 {
00385 stream.next(m.result);
00386 }
00387
00388 ROS_DECLARE_ALLINONE_SERIALIZER;
00389 };
00390 }
00391 }
00392
00393 namespace ros
00394 {
00395 namespace service_traits
00396 {
00397 template<>
00398 struct MD5Sum<graspit_interface_msgs::LoadObstacle> {
00399 static const char* value()
00400 {
00401 return "849362f1aa1b5a31b05a93a66798c64b";
00402 }
00403
00404 static const char* value(const graspit_interface_msgs::LoadObstacle&) { return value(); }
00405 };
00406
00407 template<>
00408 struct DataType<graspit_interface_msgs::LoadObstacle> {
00409 static const char* value()
00410 {
00411 return "graspit_interface_msgs/LoadObstacle";
00412 }
00413
00414 static const char* value(const graspit_interface_msgs::LoadObstacle&) { return value(); }
00415 };
00416
00417 template<class ContainerAllocator>
00418 struct MD5Sum<graspit_interface_msgs::LoadObstacleRequest_<ContainerAllocator> > {
00419 static const char* value()
00420 {
00421 return "849362f1aa1b5a31b05a93a66798c64b";
00422 }
00423
00424 static const char* value(const graspit_interface_msgs::LoadObstacleRequest_<ContainerAllocator> &) { return value(); }
00425 };
00426
00427 template<class ContainerAllocator>
00428 struct DataType<graspit_interface_msgs::LoadObstacleRequest_<ContainerAllocator> > {
00429 static const char* value()
00430 {
00431 return "graspit_interface_msgs/LoadObstacle";
00432 }
00433
00434 static const char* value(const graspit_interface_msgs::LoadObstacleRequest_<ContainerAllocator> &) { return value(); }
00435 };
00436
00437 template<class ContainerAllocator>
00438 struct MD5Sum<graspit_interface_msgs::LoadObstacleResponse_<ContainerAllocator> > {
00439 static const char* value()
00440 {
00441 return "849362f1aa1b5a31b05a93a66798c64b";
00442 }
00443
00444 static const char* value(const graspit_interface_msgs::LoadObstacleResponse_<ContainerAllocator> &) { return value(); }
00445 };
00446
00447 template<class ContainerAllocator>
00448 struct DataType<graspit_interface_msgs::LoadObstacleResponse_<ContainerAllocator> > {
00449 static const char* value()
00450 {
00451 return "graspit_interface_msgs/LoadObstacle";
00452 }
00453
00454 static const char* value(const graspit_interface_msgs::LoadObstacleResponse_<ContainerAllocator> &) { return value(); }
00455 };
00456
00457 }
00458 }
00459
00460 #endif // GRASPIT_INTERFACE_MSGS_SERVICE_LOADOBSTACLE_H
00461