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