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