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