00001
00002 #ifndef MANIPULATION_TRANSFORMS_SERVICE_MAPOBJECTPOSETOEFFECTORS_H
00003 #define MANIPULATION_TRANSFORMS_SERVICE_MAPOBJECTPOSETOEFFECTORS_H
00004 #include <string>
00005 #include <vector>
00006 #include <ostream>
00007 #include "ros/serialization.h"
00008 #include "ros/builtin_message_traits.h"
00009 #include "ros/message_operations.h"
00010 #include "ros/message.h"
00011 #include "ros/time.h"
00012
00013 #include "ros/service_traits.h"
00014
00015 #include "geometry_msgs/PoseStamped.h"
00016
00017
00018 #include "geometry_msgs/PoseStamped.h"
00019
00020 namespace manipulation_transforms
00021 {
00022 template <class ContainerAllocator>
00023 struct MapObjectPoseToEffectorsRequest_ : public ros::Message
00024 {
00025 typedef MapObjectPoseToEffectorsRequest_<ContainerAllocator> Type;
00026
00027 MapObjectPoseToEffectorsRequest_()
00028 : object_pose()
00029 {
00030 }
00031
00032 MapObjectPoseToEffectorsRequest_(const ContainerAllocator& _alloc)
00033 : object_pose(_alloc)
00034 {
00035 }
00036
00037 typedef ::geometry_msgs::PoseStamped_<ContainerAllocator> _object_pose_type;
00038 ::geometry_msgs::PoseStamped_<ContainerAllocator> object_pose;
00039
00040
00041 private:
00042 static const char* __s_getDataType_() { return "manipulation_transforms/MapObjectPoseToEffectorsRequest"; }
00043 public:
00044 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); }
00045
00046 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); }
00047
00048 private:
00049 static const char* __s_getMD5Sum_() { return "ce62f562fe862ddbebe5377023767cb7"; }
00050 public:
00051 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); }
00052
00053 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); }
00054
00055 private:
00056 static const char* __s_getServerMD5Sum_() { return "fe420bd1f193579a27ccff2bf656fb54"; }
00057 public:
00058 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); }
00059
00060 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); }
00061
00062 private:
00063 static const char* __s_getMessageDefinition_() { return "\n\
00064 geometry_msgs/PoseStamped object_pose\n\
00065 \n\
00066 ================================================================================\n\
00067 MSG: geometry_msgs/PoseStamped\n\
00068 # A Pose with reference coordinate frame and timestamp\n\
00069 Header header\n\
00070 Pose pose\n\
00071 \n\
00072 ================================================================================\n\
00073 MSG: std_msgs/Header\n\
00074 # Standard metadata for higher-level stamped data types.\n\
00075 # This is generally used to communicate timestamped data \n\
00076 # in a particular coordinate frame.\n\
00077 # \n\
00078 # sequence ID: consecutively increasing ID \n\
00079 uint32 seq\n\
00080 #Two-integer timestamp that is expressed as:\n\
00081 # * stamp.secs: seconds (stamp_secs) since epoch\n\
00082 # * stamp.nsecs: nanoseconds since stamp_secs\n\
00083 # time-handling sugar is provided by the client library\n\
00084 time stamp\n\
00085 #Frame this data is associated with\n\
00086 # 0: no frame\n\
00087 # 1: global frame\n\
00088 string frame_id\n\
00089 \n\
00090 ================================================================================\n\
00091 MSG: geometry_msgs/Pose\n\
00092 # A representation of pose in free space, composed of postion and orientation. \n\
00093 Point position\n\
00094 Quaternion orientation\n\
00095 \n\
00096 ================================================================================\n\
00097 MSG: geometry_msgs/Point\n\
00098 # This contains the position of a point in free space\n\
00099 float64 x\n\
00100 float64 y\n\
00101 float64 z\n\
00102 \n\
00103 ================================================================================\n\
00104 MSG: geometry_msgs/Quaternion\n\
00105 # This represents an orientation in free space in quaternion form.\n\
00106 \n\
00107 float64 x\n\
00108 float64 y\n\
00109 float64 z\n\
00110 float64 w\n\
00111 \n\
00112 "; }
00113 public:
00114 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); }
00115
00116 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); }
00117
00118 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const
00119 {
00120 ros::serialization::OStream stream(write_ptr, 1000000000);
00121 ros::serialization::serialize(stream, object_pose);
00122 return stream.getData();
00123 }
00124
00125 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr)
00126 {
00127 ros::serialization::IStream stream(read_ptr, 1000000000);
00128 ros::serialization::deserialize(stream, object_pose);
00129 return stream.getData();
00130 }
00131
00132 ROS_DEPRECATED virtual uint32_t serializationLength() const
00133 {
00134 uint32_t size = 0;
00135 size += ros::serialization::serializationLength(object_pose);
00136 return size;
00137 }
00138
00139 typedef boost::shared_ptr< ::manipulation_transforms::MapObjectPoseToEffectorsRequest_<ContainerAllocator> > Ptr;
00140 typedef boost::shared_ptr< ::manipulation_transforms::MapObjectPoseToEffectorsRequest_<ContainerAllocator> const> ConstPtr;
00141 };
00142 typedef ::manipulation_transforms::MapObjectPoseToEffectorsRequest_<std::allocator<void> > MapObjectPoseToEffectorsRequest;
00143
00144 typedef boost::shared_ptr< ::manipulation_transforms::MapObjectPoseToEffectorsRequest> MapObjectPoseToEffectorsRequestPtr;
00145 typedef boost::shared_ptr< ::manipulation_transforms::MapObjectPoseToEffectorsRequest const> MapObjectPoseToEffectorsRequestConstPtr;
00146
00147
00148 template <class ContainerAllocator>
00149 struct MapObjectPoseToEffectorsResponse_ : public ros::Message
00150 {
00151 typedef MapObjectPoseToEffectorsResponse_<ContainerAllocator> Type;
00152
00153 MapObjectPoseToEffectorsResponse_()
00154 : effector_poses()
00155 {
00156 }
00157
00158 MapObjectPoseToEffectorsResponse_(const ContainerAllocator& _alloc)
00159 : effector_poses(_alloc)
00160 {
00161 }
00162
00163 typedef std::vector< ::geometry_msgs::PoseStamped_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::PoseStamped_<ContainerAllocator> >::other > _effector_poses_type;
00164 std::vector< ::geometry_msgs::PoseStamped_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::PoseStamped_<ContainerAllocator> >::other > effector_poses;
00165
00166
00167 ROS_DEPRECATED uint32_t get_effector_poses_size() const { return (uint32_t)effector_poses.size(); }
00168 ROS_DEPRECATED void set_effector_poses_size(uint32_t size) { effector_poses.resize((size_t)size); }
00169 ROS_DEPRECATED void get_effector_poses_vec(std::vector< ::geometry_msgs::PoseStamped_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::PoseStamped_<ContainerAllocator> >::other > & vec) const { vec = this->effector_poses; }
00170 ROS_DEPRECATED void set_effector_poses_vec(const std::vector< ::geometry_msgs::PoseStamped_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::PoseStamped_<ContainerAllocator> >::other > & vec) { this->effector_poses = vec; }
00171 private:
00172 static const char* __s_getDataType_() { return "manipulation_transforms/MapObjectPoseToEffectorsResponse"; }
00173 public:
00174 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); }
00175
00176 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); }
00177
00178 private:
00179 static const char* __s_getMD5Sum_() { return "175b382c67666ecb6c87e1a22c5729fc"; }
00180 public:
00181 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); }
00182
00183 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); }
00184
00185 private:
00186 static const char* __s_getServerMD5Sum_() { return "fe420bd1f193579a27ccff2bf656fb54"; }
00187 public:
00188 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); }
00189
00190 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); }
00191
00192 private:
00193 static const char* __s_getMessageDefinition_() { return "\n\
00194 geometry_msgs/PoseStamped[] effector_poses\n\
00195 \n\
00196 \n\
00197 \n\
00198 ================================================================================\n\
00199 MSG: geometry_msgs/PoseStamped\n\
00200 # A Pose with reference coordinate frame and timestamp\n\
00201 Header header\n\
00202 Pose pose\n\
00203 \n\
00204 ================================================================================\n\
00205 MSG: std_msgs/Header\n\
00206 # Standard metadata for higher-level stamped data types.\n\
00207 # This is generally used to communicate timestamped data \n\
00208 # in a particular coordinate frame.\n\
00209 # \n\
00210 # sequence ID: consecutively increasing ID \n\
00211 uint32 seq\n\
00212 #Two-integer timestamp that is expressed as:\n\
00213 # * stamp.secs: seconds (stamp_secs) since epoch\n\
00214 # * stamp.nsecs: nanoseconds since stamp_secs\n\
00215 # time-handling sugar is provided by the client library\n\
00216 time stamp\n\
00217 #Frame this data is associated with\n\
00218 # 0: no frame\n\
00219 # 1: global frame\n\
00220 string frame_id\n\
00221 \n\
00222 ================================================================================\n\
00223 MSG: geometry_msgs/Pose\n\
00224 # A representation of pose in free space, composed of postion and orientation. \n\
00225 Point position\n\
00226 Quaternion orientation\n\
00227 \n\
00228 ================================================================================\n\
00229 MSG: geometry_msgs/Point\n\
00230 # This contains the position of a point in free space\n\
00231 float64 x\n\
00232 float64 y\n\
00233 float64 z\n\
00234 \n\
00235 ================================================================================\n\
00236 MSG: geometry_msgs/Quaternion\n\
00237 # This represents an orientation in free space in quaternion form.\n\
00238 \n\
00239 float64 x\n\
00240 float64 y\n\
00241 float64 z\n\
00242 float64 w\n\
00243 \n\
00244 "; }
00245 public:
00246 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); }
00247
00248 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); }
00249
00250 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const
00251 {
00252 ros::serialization::OStream stream(write_ptr, 1000000000);
00253 ros::serialization::serialize(stream, effector_poses);
00254 return stream.getData();
00255 }
00256
00257 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr)
00258 {
00259 ros::serialization::IStream stream(read_ptr, 1000000000);
00260 ros::serialization::deserialize(stream, effector_poses);
00261 return stream.getData();
00262 }
00263
00264 ROS_DEPRECATED virtual uint32_t serializationLength() const
00265 {
00266 uint32_t size = 0;
00267 size += ros::serialization::serializationLength(effector_poses);
00268 return size;
00269 }
00270
00271 typedef boost::shared_ptr< ::manipulation_transforms::MapObjectPoseToEffectorsResponse_<ContainerAllocator> > Ptr;
00272 typedef boost::shared_ptr< ::manipulation_transforms::MapObjectPoseToEffectorsResponse_<ContainerAllocator> const> ConstPtr;
00273 };
00274 typedef ::manipulation_transforms::MapObjectPoseToEffectorsResponse_<std::allocator<void> > MapObjectPoseToEffectorsResponse;
00275
00276 typedef boost::shared_ptr< ::manipulation_transforms::MapObjectPoseToEffectorsResponse> MapObjectPoseToEffectorsResponsePtr;
00277 typedef boost::shared_ptr< ::manipulation_transforms::MapObjectPoseToEffectorsResponse const> MapObjectPoseToEffectorsResponseConstPtr;
00278
00279 struct MapObjectPoseToEffectors
00280 {
00281
00282 typedef MapObjectPoseToEffectorsRequest Request;
00283 typedef MapObjectPoseToEffectorsResponse Response;
00284 Request request;
00285 Response response;
00286
00287 typedef Request RequestType;
00288 typedef Response ResponseType;
00289 };
00290 }
00291
00292 namespace ros
00293 {
00294 namespace message_traits
00295 {
00296 template<class ContainerAllocator>
00297 struct MD5Sum< ::manipulation_transforms::MapObjectPoseToEffectorsRequest_<ContainerAllocator> > {
00298 static const char* value()
00299 {
00300 return "ce62f562fe862ddbebe5377023767cb7";
00301 }
00302
00303 static const char* value(const ::manipulation_transforms::MapObjectPoseToEffectorsRequest_<ContainerAllocator> &) { return value(); }
00304 static const uint64_t static_value1 = 0xce62f562fe862ddbULL;
00305 static const uint64_t static_value2 = 0xebe5377023767cb7ULL;
00306 };
00307
00308 template<class ContainerAllocator>
00309 struct DataType< ::manipulation_transforms::MapObjectPoseToEffectorsRequest_<ContainerAllocator> > {
00310 static const char* value()
00311 {
00312 return "manipulation_transforms/MapObjectPoseToEffectorsRequest";
00313 }
00314
00315 static const char* value(const ::manipulation_transforms::MapObjectPoseToEffectorsRequest_<ContainerAllocator> &) { return value(); }
00316 };
00317
00318 template<class ContainerAllocator>
00319 struct Definition< ::manipulation_transforms::MapObjectPoseToEffectorsRequest_<ContainerAllocator> > {
00320 static const char* value()
00321 {
00322 return "\n\
00323 geometry_msgs/PoseStamped object_pose\n\
00324 \n\
00325 ================================================================================\n\
00326 MSG: geometry_msgs/PoseStamped\n\
00327 # A Pose with reference coordinate frame and timestamp\n\
00328 Header header\n\
00329 Pose pose\n\
00330 \n\
00331 ================================================================================\n\
00332 MSG: std_msgs/Header\n\
00333 # Standard metadata for higher-level stamped data types.\n\
00334 # This is generally used to communicate timestamped data \n\
00335 # in a particular coordinate frame.\n\
00336 # \n\
00337 # sequence ID: consecutively increasing ID \n\
00338 uint32 seq\n\
00339 #Two-integer timestamp that is expressed as:\n\
00340 # * stamp.secs: seconds (stamp_secs) since epoch\n\
00341 # * stamp.nsecs: nanoseconds since stamp_secs\n\
00342 # time-handling sugar is provided by the client library\n\
00343 time stamp\n\
00344 #Frame this data is associated with\n\
00345 # 0: no frame\n\
00346 # 1: global frame\n\
00347 string frame_id\n\
00348 \n\
00349 ================================================================================\n\
00350 MSG: geometry_msgs/Pose\n\
00351 # A representation of pose in free space, composed of postion and orientation. \n\
00352 Point position\n\
00353 Quaternion orientation\n\
00354 \n\
00355 ================================================================================\n\
00356 MSG: geometry_msgs/Point\n\
00357 # This contains the position of a point in free space\n\
00358 float64 x\n\
00359 float64 y\n\
00360 float64 z\n\
00361 \n\
00362 ================================================================================\n\
00363 MSG: geometry_msgs/Quaternion\n\
00364 # This represents an orientation in free space in quaternion form.\n\
00365 \n\
00366 float64 x\n\
00367 float64 y\n\
00368 float64 z\n\
00369 float64 w\n\
00370 \n\
00371 ";
00372 }
00373
00374 static const char* value(const ::manipulation_transforms::MapObjectPoseToEffectorsRequest_<ContainerAllocator> &) { return value(); }
00375 };
00376
00377 }
00378 }
00379
00380
00381 namespace ros
00382 {
00383 namespace message_traits
00384 {
00385 template<class ContainerAllocator>
00386 struct MD5Sum< ::manipulation_transforms::MapObjectPoseToEffectorsResponse_<ContainerAllocator> > {
00387 static const char* value()
00388 {
00389 return "175b382c67666ecb6c87e1a22c5729fc";
00390 }
00391
00392 static const char* value(const ::manipulation_transforms::MapObjectPoseToEffectorsResponse_<ContainerAllocator> &) { return value(); }
00393 static const uint64_t static_value1 = 0x175b382c67666ecbULL;
00394 static const uint64_t static_value2 = 0x6c87e1a22c5729fcULL;
00395 };
00396
00397 template<class ContainerAllocator>
00398 struct DataType< ::manipulation_transforms::MapObjectPoseToEffectorsResponse_<ContainerAllocator> > {
00399 static const char* value()
00400 {
00401 return "manipulation_transforms/MapObjectPoseToEffectorsResponse";
00402 }
00403
00404 static const char* value(const ::manipulation_transforms::MapObjectPoseToEffectorsResponse_<ContainerAllocator> &) { return value(); }
00405 };
00406
00407 template<class ContainerAllocator>
00408 struct Definition< ::manipulation_transforms::MapObjectPoseToEffectorsResponse_<ContainerAllocator> > {
00409 static const char* value()
00410 {
00411 return "\n\
00412 geometry_msgs/PoseStamped[] effector_poses\n\
00413 \n\
00414 \n\
00415 \n\
00416 ================================================================================\n\
00417 MSG: geometry_msgs/PoseStamped\n\
00418 # A Pose with reference coordinate frame and timestamp\n\
00419 Header header\n\
00420 Pose pose\n\
00421 \n\
00422 ================================================================================\n\
00423 MSG: std_msgs/Header\n\
00424 # Standard metadata for higher-level stamped data types.\n\
00425 # This is generally used to communicate timestamped data \n\
00426 # in a particular coordinate frame.\n\
00427 # \n\
00428 # sequence ID: consecutively increasing ID \n\
00429 uint32 seq\n\
00430 #Two-integer timestamp that is expressed as:\n\
00431 # * stamp.secs: seconds (stamp_secs) since epoch\n\
00432 # * stamp.nsecs: nanoseconds since stamp_secs\n\
00433 # time-handling sugar is provided by the client library\n\
00434 time stamp\n\
00435 #Frame this data is associated with\n\
00436 # 0: no frame\n\
00437 # 1: global frame\n\
00438 string frame_id\n\
00439 \n\
00440 ================================================================================\n\
00441 MSG: geometry_msgs/Pose\n\
00442 # A representation of pose in free space, composed of postion and orientation. \n\
00443 Point position\n\
00444 Quaternion orientation\n\
00445 \n\
00446 ================================================================================\n\
00447 MSG: geometry_msgs/Point\n\
00448 # This contains the position of a point in free space\n\
00449 float64 x\n\
00450 float64 y\n\
00451 float64 z\n\
00452 \n\
00453 ================================================================================\n\
00454 MSG: geometry_msgs/Quaternion\n\
00455 # This represents an orientation in free space in quaternion form.\n\
00456 \n\
00457 float64 x\n\
00458 float64 y\n\
00459 float64 z\n\
00460 float64 w\n\
00461 \n\
00462 ";
00463 }
00464
00465 static const char* value(const ::manipulation_transforms::MapObjectPoseToEffectorsResponse_<ContainerAllocator> &) { return value(); }
00466 };
00467
00468 }
00469 }
00470
00471 namespace ros
00472 {
00473 namespace serialization
00474 {
00475
00476 template<class ContainerAllocator> struct Serializer< ::manipulation_transforms::MapObjectPoseToEffectorsRequest_<ContainerAllocator> >
00477 {
00478 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00479 {
00480 stream.next(m.object_pose);
00481 }
00482
00483 ROS_DECLARE_ALLINONE_SERIALIZER;
00484 };
00485 }
00486 }
00487
00488
00489 namespace ros
00490 {
00491 namespace serialization
00492 {
00493
00494 template<class ContainerAllocator> struct Serializer< ::manipulation_transforms::MapObjectPoseToEffectorsResponse_<ContainerAllocator> >
00495 {
00496 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00497 {
00498 stream.next(m.effector_poses);
00499 }
00500
00501 ROS_DECLARE_ALLINONE_SERIALIZER;
00502 };
00503 }
00504 }
00505
00506 namespace ros
00507 {
00508 namespace service_traits
00509 {
00510 template<>
00511 struct MD5Sum<manipulation_transforms::MapObjectPoseToEffectors> {
00512 static const char* value()
00513 {
00514 return "fe420bd1f193579a27ccff2bf656fb54";
00515 }
00516
00517 static const char* value(const manipulation_transforms::MapObjectPoseToEffectors&) { return value(); }
00518 };
00519
00520 template<>
00521 struct DataType<manipulation_transforms::MapObjectPoseToEffectors> {
00522 static const char* value()
00523 {
00524 return "manipulation_transforms/MapObjectPoseToEffectors";
00525 }
00526
00527 static const char* value(const manipulation_transforms::MapObjectPoseToEffectors&) { return value(); }
00528 };
00529
00530 template<class ContainerAllocator>
00531 struct MD5Sum<manipulation_transforms::MapObjectPoseToEffectorsRequest_<ContainerAllocator> > {
00532 static const char* value()
00533 {
00534 return "fe420bd1f193579a27ccff2bf656fb54";
00535 }
00536
00537 static const char* value(const manipulation_transforms::MapObjectPoseToEffectorsRequest_<ContainerAllocator> &) { return value(); }
00538 };
00539
00540 template<class ContainerAllocator>
00541 struct DataType<manipulation_transforms::MapObjectPoseToEffectorsRequest_<ContainerAllocator> > {
00542 static const char* value()
00543 {
00544 return "manipulation_transforms/MapObjectPoseToEffectors";
00545 }
00546
00547 static const char* value(const manipulation_transforms::MapObjectPoseToEffectorsRequest_<ContainerAllocator> &) { return value(); }
00548 };
00549
00550 template<class ContainerAllocator>
00551 struct MD5Sum<manipulation_transforms::MapObjectPoseToEffectorsResponse_<ContainerAllocator> > {
00552 static const char* value()
00553 {
00554 return "fe420bd1f193579a27ccff2bf656fb54";
00555 }
00556
00557 static const char* value(const manipulation_transforms::MapObjectPoseToEffectorsResponse_<ContainerAllocator> &) { return value(); }
00558 };
00559
00560 template<class ContainerAllocator>
00561 struct DataType<manipulation_transforms::MapObjectPoseToEffectorsResponse_<ContainerAllocator> > {
00562 static const char* value()
00563 {
00564 return "manipulation_transforms/MapObjectPoseToEffectors";
00565 }
00566
00567 static const char* value(const manipulation_transforms::MapObjectPoseToEffectorsResponse_<ContainerAllocator> &) { return value(); }
00568 };
00569
00570 }
00571 }
00572
00573 #endif // MANIPULATION_TRANSFORMS_SERVICE_MAPOBJECTPOSETOEFFECTORS_H
00574