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