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