$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/MapObjectTwistToEffectors.srv */ 00002 #ifndef MANIPULATION_TRANSFORMS_SERVICE_MAPOBJECTTWISTTOEFFECTORS_H 00003 #define MANIPULATION_TRANSFORMS_SERVICE_MAPOBJECTTWISTTOEFFECTORS_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/TwistStamped.h" 00020 00021 00022 #include "geometry_msgs/TwistStamped.h" 00023 00024 namespace manipulation_transforms 00025 { 00026 template <class ContainerAllocator> 00027 struct MapObjectTwistToEffectorsRequest_ { 00028 typedef MapObjectTwistToEffectorsRequest_<ContainerAllocator> Type; 00029 00030 MapObjectTwistToEffectorsRequest_() 00031 : object_twist() 00032 { 00033 } 00034 00035 MapObjectTwistToEffectorsRequest_(const ContainerAllocator& _alloc) 00036 : object_twist(_alloc) 00037 { 00038 } 00039 00040 typedef ::geometry_msgs::TwistStamped_<ContainerAllocator> _object_twist_type; 00041 ::geometry_msgs::TwistStamped_<ContainerAllocator> object_twist; 00042 00043 00044 private: 00045 static const char* __s_getDataType_() { return "manipulation_transforms/MapObjectTwistToEffectorsRequest"; } 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 "520cb950a1ab872cff62b14155b5a20c"; } 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 "1bb5479e5565270d07bd4dd38bdd26c9"; } 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/TwistStamped object_twist\n\ 00068 \n\ 00069 ================================================================================\n\ 00070 MSG: geometry_msgs/TwistStamped\n\ 00071 # A twist with reference coordinate frame and timestamp\n\ 00072 Header header\n\ 00073 Twist twist\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/Twist\n\ 00095 # This expresses velocity in free space broken into it's linear and angular parts. \n\ 00096 Vector3 linear\n\ 00097 Vector3 angular\n\ 00098 \n\ 00099 ================================================================================\n\ 00100 MSG: geometry_msgs/Vector3\n\ 00101 # This represents a vector in free space. \n\ 00102 \n\ 00103 float64 x\n\ 00104 float64 y\n\ 00105 float64 z\n\ 00106 "; } 00107 public: 00108 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); } 00109 00110 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); } 00111 00112 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const 00113 { 00114 ros::serialization::OStream stream(write_ptr, 1000000000); 00115 ros::serialization::serialize(stream, object_twist); 00116 return stream.getData(); 00117 } 00118 00119 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr) 00120 { 00121 ros::serialization::IStream stream(read_ptr, 1000000000); 00122 ros::serialization::deserialize(stream, object_twist); 00123 return stream.getData(); 00124 } 00125 00126 ROS_DEPRECATED virtual uint32_t serializationLength() const 00127 { 00128 uint32_t size = 0; 00129 size += ros::serialization::serializationLength(object_twist); 00130 return size; 00131 } 00132 00133 typedef boost::shared_ptr< ::manipulation_transforms::MapObjectTwistToEffectorsRequest_<ContainerAllocator> > Ptr; 00134 typedef boost::shared_ptr< ::manipulation_transforms::MapObjectTwistToEffectorsRequest_<ContainerAllocator> const> ConstPtr; 00135 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00136 }; // struct MapObjectTwistToEffectorsRequest 00137 typedef ::manipulation_transforms::MapObjectTwistToEffectorsRequest_<std::allocator<void> > MapObjectTwistToEffectorsRequest; 00138 00139 typedef boost::shared_ptr< ::manipulation_transforms::MapObjectTwistToEffectorsRequest> MapObjectTwistToEffectorsRequestPtr; 00140 typedef boost::shared_ptr< ::manipulation_transforms::MapObjectTwistToEffectorsRequest const> MapObjectTwistToEffectorsRequestConstPtr; 00141 00142 00143 template <class ContainerAllocator> 00144 struct MapObjectTwistToEffectorsResponse_ { 00145 typedef MapObjectTwistToEffectorsResponse_<ContainerAllocator> Type; 00146 00147 MapObjectTwistToEffectorsResponse_() 00148 : effector_twists() 00149 { 00150 } 00151 00152 MapObjectTwistToEffectorsResponse_(const ContainerAllocator& _alloc) 00153 : effector_twists(_alloc) 00154 { 00155 } 00156 00157 typedef std::vector< ::geometry_msgs::TwistStamped_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::TwistStamped_<ContainerAllocator> >::other > _effector_twists_type; 00158 std::vector< ::geometry_msgs::TwistStamped_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::TwistStamped_<ContainerAllocator> >::other > effector_twists; 00159 00160 00161 ROS_DEPRECATED uint32_t get_effector_twists_size() const { return (uint32_t)effector_twists.size(); } 00162 ROS_DEPRECATED void set_effector_twists_size(uint32_t size) { effector_twists.resize((size_t)size); } 00163 ROS_DEPRECATED void get_effector_twists_vec(std::vector< ::geometry_msgs::TwistStamped_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::TwistStamped_<ContainerAllocator> >::other > & vec) const { vec = this->effector_twists; } 00164 ROS_DEPRECATED void set_effector_twists_vec(const std::vector< ::geometry_msgs::TwistStamped_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::TwistStamped_<ContainerAllocator> >::other > & vec) { this->effector_twists = vec; } 00165 private: 00166 static const char* __s_getDataType_() { return "manipulation_transforms/MapObjectTwistToEffectorsResponse"; } 00167 public: 00168 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); } 00169 00170 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); } 00171 00172 private: 00173 static const char* __s_getMD5Sum_() { return "9e6592ec3797ef41e0f2bd288e07c910"; } 00174 public: 00175 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); } 00176 00177 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); } 00178 00179 private: 00180 static const char* __s_getServerMD5Sum_() { return "1bb5479e5565270d07bd4dd38bdd26c9"; } 00181 public: 00182 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); } 00183 00184 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); } 00185 00186 private: 00187 static const char* __s_getMessageDefinition_() { return "\n\ 00188 geometry_msgs/TwistStamped[] effector_twists\n\ 00189 \n\ 00190 \n\ 00191 \n\ 00192 ================================================================================\n\ 00193 MSG: geometry_msgs/TwistStamped\n\ 00194 # A twist with reference coordinate frame and timestamp\n\ 00195 Header header\n\ 00196 Twist twist\n\ 00197 \n\ 00198 ================================================================================\n\ 00199 MSG: std_msgs/Header\n\ 00200 # Standard metadata for higher-level stamped data types.\n\ 00201 # This is generally used to communicate timestamped data \n\ 00202 # in a particular coordinate frame.\n\ 00203 # \n\ 00204 # sequence ID: consecutively increasing ID \n\ 00205 uint32 seq\n\ 00206 #Two-integer timestamp that is expressed as:\n\ 00207 # * stamp.secs: seconds (stamp_secs) since epoch\n\ 00208 # * stamp.nsecs: nanoseconds since stamp_secs\n\ 00209 # time-handling sugar is provided by the client library\n\ 00210 time stamp\n\ 00211 #Frame this data is associated with\n\ 00212 # 0: no frame\n\ 00213 # 1: global frame\n\ 00214 string frame_id\n\ 00215 \n\ 00216 ================================================================================\n\ 00217 MSG: geometry_msgs/Twist\n\ 00218 # This expresses velocity in free space broken into it's linear and angular parts. \n\ 00219 Vector3 linear\n\ 00220 Vector3 angular\n\ 00221 \n\ 00222 ================================================================================\n\ 00223 MSG: geometry_msgs/Vector3\n\ 00224 # This represents a vector in free space. \n\ 00225 \n\ 00226 float64 x\n\ 00227 float64 y\n\ 00228 float64 z\n\ 00229 "; } 00230 public: 00231 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); } 00232 00233 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); } 00234 00235 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const 00236 { 00237 ros::serialization::OStream stream(write_ptr, 1000000000); 00238 ros::serialization::serialize(stream, effector_twists); 00239 return stream.getData(); 00240 } 00241 00242 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr) 00243 { 00244 ros::serialization::IStream stream(read_ptr, 1000000000); 00245 ros::serialization::deserialize(stream, effector_twists); 00246 return stream.getData(); 00247 } 00248 00249 ROS_DEPRECATED virtual uint32_t serializationLength() const 00250 { 00251 uint32_t size = 0; 00252 size += ros::serialization::serializationLength(effector_twists); 00253 return size; 00254 } 00255 00256 typedef boost::shared_ptr< ::manipulation_transforms::MapObjectTwistToEffectorsResponse_<ContainerAllocator> > Ptr; 00257 typedef boost::shared_ptr< ::manipulation_transforms::MapObjectTwistToEffectorsResponse_<ContainerAllocator> const> ConstPtr; 00258 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00259 }; // struct MapObjectTwistToEffectorsResponse 00260 typedef ::manipulation_transforms::MapObjectTwistToEffectorsResponse_<std::allocator<void> > MapObjectTwistToEffectorsResponse; 00261 00262 typedef boost::shared_ptr< ::manipulation_transforms::MapObjectTwistToEffectorsResponse> MapObjectTwistToEffectorsResponsePtr; 00263 typedef boost::shared_ptr< ::manipulation_transforms::MapObjectTwistToEffectorsResponse const> MapObjectTwistToEffectorsResponseConstPtr; 00264 00265 struct MapObjectTwistToEffectors 00266 { 00267 00268 typedef MapObjectTwistToEffectorsRequest Request; 00269 typedef MapObjectTwistToEffectorsResponse Response; 00270 Request request; 00271 Response response; 00272 00273 typedef Request RequestType; 00274 typedef Response ResponseType; 00275 }; // struct MapObjectTwistToEffectors 00276 } // namespace manipulation_transforms 00277 00278 namespace ros 00279 { 00280 namespace message_traits 00281 { 00282 template<class ContainerAllocator> struct IsMessage< ::manipulation_transforms::MapObjectTwistToEffectorsRequest_<ContainerAllocator> > : public TrueType {}; 00283 template<class ContainerAllocator> struct IsMessage< ::manipulation_transforms::MapObjectTwistToEffectorsRequest_<ContainerAllocator> const> : public TrueType {}; 00284 template<class ContainerAllocator> 00285 struct MD5Sum< ::manipulation_transforms::MapObjectTwistToEffectorsRequest_<ContainerAllocator> > { 00286 static const char* value() 00287 { 00288 return "520cb950a1ab872cff62b14155b5a20c"; 00289 } 00290 00291 static const char* value(const ::manipulation_transforms::MapObjectTwistToEffectorsRequest_<ContainerAllocator> &) { return value(); } 00292 static const uint64_t static_value1 = 0x520cb950a1ab872cULL; 00293 static const uint64_t static_value2 = 0xff62b14155b5a20cULL; 00294 }; 00295 00296 template<class ContainerAllocator> 00297 struct DataType< ::manipulation_transforms::MapObjectTwistToEffectorsRequest_<ContainerAllocator> > { 00298 static const char* value() 00299 { 00300 return "manipulation_transforms/MapObjectTwistToEffectorsRequest"; 00301 } 00302 00303 static const char* value(const ::manipulation_transforms::MapObjectTwistToEffectorsRequest_<ContainerAllocator> &) { return value(); } 00304 }; 00305 00306 template<class ContainerAllocator> 00307 struct Definition< ::manipulation_transforms::MapObjectTwistToEffectorsRequest_<ContainerAllocator> > { 00308 static const char* value() 00309 { 00310 return "\n\ 00311 geometry_msgs/TwistStamped object_twist\n\ 00312 \n\ 00313 ================================================================================\n\ 00314 MSG: geometry_msgs/TwistStamped\n\ 00315 # A twist with reference coordinate frame and timestamp\n\ 00316 Header header\n\ 00317 Twist twist\n\ 00318 \n\ 00319 ================================================================================\n\ 00320 MSG: std_msgs/Header\n\ 00321 # Standard metadata for higher-level stamped data types.\n\ 00322 # This is generally used to communicate timestamped data \n\ 00323 # in a particular coordinate frame.\n\ 00324 # \n\ 00325 # sequence ID: consecutively increasing ID \n\ 00326 uint32 seq\n\ 00327 #Two-integer timestamp that is expressed as:\n\ 00328 # * stamp.secs: seconds (stamp_secs) since epoch\n\ 00329 # * stamp.nsecs: nanoseconds since stamp_secs\n\ 00330 # time-handling sugar is provided by the client library\n\ 00331 time stamp\n\ 00332 #Frame this data is associated with\n\ 00333 # 0: no frame\n\ 00334 # 1: global frame\n\ 00335 string frame_id\n\ 00336 \n\ 00337 ================================================================================\n\ 00338 MSG: geometry_msgs/Twist\n\ 00339 # This expresses velocity in free space broken into it's linear and angular parts. \n\ 00340 Vector3 linear\n\ 00341 Vector3 angular\n\ 00342 \n\ 00343 ================================================================================\n\ 00344 MSG: geometry_msgs/Vector3\n\ 00345 # This represents a vector in free space. \n\ 00346 \n\ 00347 float64 x\n\ 00348 float64 y\n\ 00349 float64 z\n\ 00350 "; 00351 } 00352 00353 static const char* value(const ::manipulation_transforms::MapObjectTwistToEffectorsRequest_<ContainerAllocator> &) { return value(); } 00354 }; 00355 00356 } // namespace message_traits 00357 } // namespace ros 00358 00359 00360 namespace ros 00361 { 00362 namespace message_traits 00363 { 00364 template<class ContainerAllocator> struct IsMessage< ::manipulation_transforms::MapObjectTwistToEffectorsResponse_<ContainerAllocator> > : public TrueType {}; 00365 template<class ContainerAllocator> struct IsMessage< ::manipulation_transforms::MapObjectTwistToEffectorsResponse_<ContainerAllocator> const> : public TrueType {}; 00366 template<class ContainerAllocator> 00367 struct MD5Sum< ::manipulation_transforms::MapObjectTwistToEffectorsResponse_<ContainerAllocator> > { 00368 static const char* value() 00369 { 00370 return "9e6592ec3797ef41e0f2bd288e07c910"; 00371 } 00372 00373 static const char* value(const ::manipulation_transforms::MapObjectTwistToEffectorsResponse_<ContainerAllocator> &) { return value(); } 00374 static const uint64_t static_value1 = 0x9e6592ec3797ef41ULL; 00375 static const uint64_t static_value2 = 0xe0f2bd288e07c910ULL; 00376 }; 00377 00378 template<class ContainerAllocator> 00379 struct DataType< ::manipulation_transforms::MapObjectTwistToEffectorsResponse_<ContainerAllocator> > { 00380 static const char* value() 00381 { 00382 return "manipulation_transforms/MapObjectTwistToEffectorsResponse"; 00383 } 00384 00385 static const char* value(const ::manipulation_transforms::MapObjectTwistToEffectorsResponse_<ContainerAllocator> &) { return value(); } 00386 }; 00387 00388 template<class ContainerAllocator> 00389 struct Definition< ::manipulation_transforms::MapObjectTwistToEffectorsResponse_<ContainerAllocator> > { 00390 static const char* value() 00391 { 00392 return "\n\ 00393 geometry_msgs/TwistStamped[] effector_twists\n\ 00394 \n\ 00395 \n\ 00396 \n\ 00397 ================================================================================\n\ 00398 MSG: geometry_msgs/TwistStamped\n\ 00399 # A twist with reference coordinate frame and timestamp\n\ 00400 Header header\n\ 00401 Twist twist\n\ 00402 \n\ 00403 ================================================================================\n\ 00404 MSG: std_msgs/Header\n\ 00405 # Standard metadata for higher-level stamped data types.\n\ 00406 # This is generally used to communicate timestamped data \n\ 00407 # in a particular coordinate frame.\n\ 00408 # \n\ 00409 # sequence ID: consecutively increasing ID \n\ 00410 uint32 seq\n\ 00411 #Two-integer timestamp that is expressed as:\n\ 00412 # * stamp.secs: seconds (stamp_secs) since epoch\n\ 00413 # * stamp.nsecs: nanoseconds since stamp_secs\n\ 00414 # time-handling sugar is provided by the client library\n\ 00415 time stamp\n\ 00416 #Frame this data is associated with\n\ 00417 # 0: no frame\n\ 00418 # 1: global frame\n\ 00419 string frame_id\n\ 00420 \n\ 00421 ================================================================================\n\ 00422 MSG: geometry_msgs/Twist\n\ 00423 # This expresses velocity in free space broken into it's linear and angular parts. \n\ 00424 Vector3 linear\n\ 00425 Vector3 angular\n\ 00426 \n\ 00427 ================================================================================\n\ 00428 MSG: geometry_msgs/Vector3\n\ 00429 # This represents a vector in free space. \n\ 00430 \n\ 00431 float64 x\n\ 00432 float64 y\n\ 00433 float64 z\n\ 00434 "; 00435 } 00436 00437 static const char* value(const ::manipulation_transforms::MapObjectTwistToEffectorsResponse_<ContainerAllocator> &) { return value(); } 00438 }; 00439 00440 } // namespace message_traits 00441 } // namespace ros 00442 00443 namespace ros 00444 { 00445 namespace serialization 00446 { 00447 00448 template<class ContainerAllocator> struct Serializer< ::manipulation_transforms::MapObjectTwistToEffectorsRequest_<ContainerAllocator> > 00449 { 00450 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00451 { 00452 stream.next(m.object_twist); 00453 } 00454 00455 ROS_DECLARE_ALLINONE_SERIALIZER; 00456 }; // struct MapObjectTwistToEffectorsRequest_ 00457 } // namespace serialization 00458 } // namespace ros 00459 00460 00461 namespace ros 00462 { 00463 namespace serialization 00464 { 00465 00466 template<class ContainerAllocator> struct Serializer< ::manipulation_transforms::MapObjectTwistToEffectorsResponse_<ContainerAllocator> > 00467 { 00468 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00469 { 00470 stream.next(m.effector_twists); 00471 } 00472 00473 ROS_DECLARE_ALLINONE_SERIALIZER; 00474 }; // struct MapObjectTwistToEffectorsResponse_ 00475 } // namespace serialization 00476 } // namespace ros 00477 00478 namespace ros 00479 { 00480 namespace service_traits 00481 { 00482 template<> 00483 struct MD5Sum<manipulation_transforms::MapObjectTwistToEffectors> { 00484 static const char* value() 00485 { 00486 return "1bb5479e5565270d07bd4dd38bdd26c9"; 00487 } 00488 00489 static const char* value(const manipulation_transforms::MapObjectTwistToEffectors&) { return value(); } 00490 }; 00491 00492 template<> 00493 struct DataType<manipulation_transforms::MapObjectTwistToEffectors> { 00494 static const char* value() 00495 { 00496 return "manipulation_transforms/MapObjectTwistToEffectors"; 00497 } 00498 00499 static const char* value(const manipulation_transforms::MapObjectTwistToEffectors&) { return value(); } 00500 }; 00501 00502 template<class ContainerAllocator> 00503 struct MD5Sum<manipulation_transforms::MapObjectTwistToEffectorsRequest_<ContainerAllocator> > { 00504 static const char* value() 00505 { 00506 return "1bb5479e5565270d07bd4dd38bdd26c9"; 00507 } 00508 00509 static const char* value(const manipulation_transforms::MapObjectTwistToEffectorsRequest_<ContainerAllocator> &) { return value(); } 00510 }; 00511 00512 template<class ContainerAllocator> 00513 struct DataType<manipulation_transforms::MapObjectTwistToEffectorsRequest_<ContainerAllocator> > { 00514 static const char* value() 00515 { 00516 return "manipulation_transforms/MapObjectTwistToEffectors"; 00517 } 00518 00519 static const char* value(const manipulation_transforms::MapObjectTwistToEffectorsRequest_<ContainerAllocator> &) { return value(); } 00520 }; 00521 00522 template<class ContainerAllocator> 00523 struct MD5Sum<manipulation_transforms::MapObjectTwistToEffectorsResponse_<ContainerAllocator> > { 00524 static const char* value() 00525 { 00526 return "1bb5479e5565270d07bd4dd38bdd26c9"; 00527 } 00528 00529 static const char* value(const manipulation_transforms::MapObjectTwistToEffectorsResponse_<ContainerAllocator> &) { return value(); } 00530 }; 00531 00532 template<class ContainerAllocator> 00533 struct DataType<manipulation_transforms::MapObjectTwistToEffectorsResponse_<ContainerAllocator> > { 00534 static const char* value() 00535 { 00536 return "manipulation_transforms/MapObjectTwistToEffectors"; 00537 } 00538 00539 static const char* value(const manipulation_transforms::MapObjectTwistToEffectorsResponse_<ContainerAllocator> &) { return value(); } 00540 }; 00541 00542 } // namespace service_traits 00543 } // namespace ros 00544 00545 #endif // MANIPULATION_TRANSFORMS_SERVICE_MAPOBJECTTWISTTOEFFECTORS_H 00546