Go to the documentation of this file.00001
00002 #ifndef KINECT_DEPTH_CALIBRATION_SERVICE_GETCHECKERBOARDPOSE_H
00003 #define KINECT_DEPTH_CALIBRATION_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 kinect_depth_calibration
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 typedef boost::shared_ptr< ::kinect_depth_calibration::GetCheckerboardPoseRequest_<ContainerAllocator> > Ptr;
00059 typedef boost::shared_ptr< ::kinect_depth_calibration::GetCheckerboardPoseRequest_<ContainerAllocator> const> ConstPtr;
00060 boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00061 };
00062 typedef ::kinect_depth_calibration::GetCheckerboardPoseRequest_<std::allocator<void> > GetCheckerboardPoseRequest;
00063
00064 typedef boost::shared_ptr< ::kinect_depth_calibration::GetCheckerboardPoseRequest> GetCheckerboardPoseRequestPtr;
00065 typedef boost::shared_ptr< ::kinect_depth_calibration::GetCheckerboardPoseRequest const> GetCheckerboardPoseRequestConstPtr;
00066
00067
00068
00069 template <class ContainerAllocator>
00070 struct GetCheckerboardPoseResponse_ {
00071 typedef GetCheckerboardPoseResponse_<ContainerAllocator> Type;
00072
00073 GetCheckerboardPoseResponse_()
00074 : board_pose()
00075 , min_x(0.0)
00076 , max_x(0.0)
00077 , min_y(0.0)
00078 , max_y(0.0)
00079 , noise_vel(0.0)
00080 , noise_rot(0.0)
00081 {
00082 }
00083
00084 GetCheckerboardPoseResponse_(const ContainerAllocator& _alloc)
00085 : board_pose(_alloc)
00086 , min_x(0.0)
00087 , max_x(0.0)
00088 , min_y(0.0)
00089 , max_y(0.0)
00090 , noise_vel(0.0)
00091 , noise_rot(0.0)
00092 {
00093 }
00094
00095 typedef ::geometry_msgs::PoseStamped_<ContainerAllocator> _board_pose_type;
00096 ::geometry_msgs::PoseStamped_<ContainerAllocator> board_pose;
00097
00098 typedef float _min_x_type;
00099 float min_x;
00100
00101 typedef float _max_x_type;
00102 float max_x;
00103
00104 typedef float _min_y_type;
00105 float min_y;
00106
00107 typedef float _max_y_type;
00108 float max_y;
00109
00110 typedef float _noise_vel_type;
00111 float noise_vel;
00112
00113 typedef float _noise_rot_type;
00114 float noise_rot;
00115
00116
00117 typedef boost::shared_ptr< ::kinect_depth_calibration::GetCheckerboardPoseResponse_<ContainerAllocator> > Ptr;
00118 typedef boost::shared_ptr< ::kinect_depth_calibration::GetCheckerboardPoseResponse_<ContainerAllocator> const> ConstPtr;
00119 boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00120 };
00121 typedef ::kinect_depth_calibration::GetCheckerboardPoseResponse_<std::allocator<void> > GetCheckerboardPoseResponse;
00122
00123 typedef boost::shared_ptr< ::kinect_depth_calibration::GetCheckerboardPoseResponse> GetCheckerboardPoseResponsePtr;
00124 typedef boost::shared_ptr< ::kinect_depth_calibration::GetCheckerboardPoseResponse const> GetCheckerboardPoseResponseConstPtr;
00125
00126
00127 struct GetCheckerboardPose
00128 {
00129
00130 typedef GetCheckerboardPoseRequest Request;
00131 typedef GetCheckerboardPoseResponse Response;
00132 Request request;
00133 Response response;
00134
00135 typedef Request RequestType;
00136 typedef Response ResponseType;
00137 };
00138 }
00139
00140 namespace ros
00141 {
00142 namespace message_traits
00143 {
00144 template<class ContainerAllocator> struct IsMessage< ::kinect_depth_calibration::GetCheckerboardPoseRequest_<ContainerAllocator> > : public TrueType {};
00145 template<class ContainerAllocator> struct IsMessage< ::kinect_depth_calibration::GetCheckerboardPoseRequest_<ContainerAllocator> const> : public TrueType {};
00146 template<class ContainerAllocator>
00147 struct MD5Sum< ::kinect_depth_calibration::GetCheckerboardPoseRequest_<ContainerAllocator> > {
00148 static const char* value()
00149 {
00150 return "f9dc7d7f2c73b6a404e26f1d03ad4ec2";
00151 }
00152
00153 static const char* value(const ::kinect_depth_calibration::GetCheckerboardPoseRequest_<ContainerAllocator> &) { return value(); }
00154 static const uint64_t static_value1 = 0xf9dc7d7f2c73b6a4ULL;
00155 static const uint64_t static_value2 = 0x04e26f1d03ad4ec2ULL;
00156 };
00157
00158 template<class ContainerAllocator>
00159 struct DataType< ::kinect_depth_calibration::GetCheckerboardPoseRequest_<ContainerAllocator> > {
00160 static const char* value()
00161 {
00162 return "kinect_depth_calibration/GetCheckerboardPoseRequest";
00163 }
00164
00165 static const char* value(const ::kinect_depth_calibration::GetCheckerboardPoseRequest_<ContainerAllocator> &) { return value(); }
00166 };
00167
00168 template<class ContainerAllocator>
00169 struct Definition< ::kinect_depth_calibration::GetCheckerboardPoseRequest_<ContainerAllocator> > {
00170 static const char* value()
00171 {
00172 return "int32 corners_x\n\
00173 int32 corners_y\n\
00174 float32 spacing_x\n\
00175 float32 spacing_y\n\
00176 \n\
00177 ";
00178 }
00179
00180 static const char* value(const ::kinect_depth_calibration::GetCheckerboardPoseRequest_<ContainerAllocator> &) { return value(); }
00181 };
00182
00183 template<class ContainerAllocator> struct IsFixedSize< ::kinect_depth_calibration::GetCheckerboardPoseRequest_<ContainerAllocator> > : public TrueType {};
00184 }
00185 }
00186
00187
00188 namespace ros
00189 {
00190 namespace message_traits
00191 {
00192 template<class ContainerAllocator> struct IsMessage< ::kinect_depth_calibration::GetCheckerboardPoseResponse_<ContainerAllocator> > : public TrueType {};
00193 template<class ContainerAllocator> struct IsMessage< ::kinect_depth_calibration::GetCheckerboardPoseResponse_<ContainerAllocator> const> : public TrueType {};
00194 template<class ContainerAllocator>
00195 struct MD5Sum< ::kinect_depth_calibration::GetCheckerboardPoseResponse_<ContainerAllocator> > {
00196 static const char* value()
00197 {
00198 return "f2e4d5e733b7a98672707e8a53a68cd4";
00199 }
00200
00201 static const char* value(const ::kinect_depth_calibration::GetCheckerboardPoseResponse_<ContainerAllocator> &) { return value(); }
00202 static const uint64_t static_value1 = 0xf2e4d5e733b7a986ULL;
00203 static const uint64_t static_value2 = 0x72707e8a53a68cd4ULL;
00204 };
00205
00206 template<class ContainerAllocator>
00207 struct DataType< ::kinect_depth_calibration::GetCheckerboardPoseResponse_<ContainerAllocator> > {
00208 static const char* value()
00209 {
00210 return "kinect_depth_calibration/GetCheckerboardPoseResponse";
00211 }
00212
00213 static const char* value(const ::kinect_depth_calibration::GetCheckerboardPoseResponse_<ContainerAllocator> &) { return value(); }
00214 };
00215
00216 template<class ContainerAllocator>
00217 struct Definition< ::kinect_depth_calibration::GetCheckerboardPoseResponse_<ContainerAllocator> > {
00218 static const char* value()
00219 {
00220 return "geometry_msgs/PoseStamped board_pose\n\
00221 float32 min_x\n\
00222 float32 max_x\n\
00223 float32 min_y\n\
00224 float32 max_y\n\
00225 float32 noise_vel\n\
00226 float32 noise_rot\n\
00227 \n\
00228 ================================================================================\n\
00229 MSG: geometry_msgs/PoseStamped\n\
00230 # A Pose with reference coordinate frame and timestamp\n\
00231 Header header\n\
00232 Pose pose\n\
00233 \n\
00234 ================================================================================\n\
00235 MSG: std_msgs/Header\n\
00236 # Standard metadata for higher-level stamped data types.\n\
00237 # This is generally used to communicate timestamped data \n\
00238 # in a particular coordinate frame.\n\
00239 # \n\
00240 # sequence ID: consecutively increasing ID \n\
00241 uint32 seq\n\
00242 #Two-integer timestamp that is expressed as:\n\
00243 # * stamp.secs: seconds (stamp_secs) since epoch\n\
00244 # * stamp.nsecs: nanoseconds since stamp_secs\n\
00245 # time-handling sugar is provided by the client library\n\
00246 time stamp\n\
00247 #Frame this data is associated with\n\
00248 # 0: no frame\n\
00249 # 1: global frame\n\
00250 string frame_id\n\
00251 \n\
00252 ================================================================================\n\
00253 MSG: geometry_msgs/Pose\n\
00254 # A representation of pose in free space, composed of postion and orientation. \n\
00255 Point position\n\
00256 Quaternion orientation\n\
00257 \n\
00258 ================================================================================\n\
00259 MSG: geometry_msgs/Point\n\
00260 # This contains the position of a point in free space\n\
00261 float64 x\n\
00262 float64 y\n\
00263 float64 z\n\
00264 \n\
00265 ================================================================================\n\
00266 MSG: geometry_msgs/Quaternion\n\
00267 # This represents an orientation in free space in quaternion form.\n\
00268 \n\
00269 float64 x\n\
00270 float64 y\n\
00271 float64 z\n\
00272 float64 w\n\
00273 \n\
00274 ";
00275 }
00276
00277 static const char* value(const ::kinect_depth_calibration::GetCheckerboardPoseResponse_<ContainerAllocator> &) { return value(); }
00278 };
00279
00280 }
00281 }
00282
00283 namespace ros
00284 {
00285 namespace serialization
00286 {
00287
00288 template<class ContainerAllocator> struct Serializer< ::kinect_depth_calibration::GetCheckerboardPoseRequest_<ContainerAllocator> >
00289 {
00290 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00291 {
00292 stream.next(m.corners_x);
00293 stream.next(m.corners_y);
00294 stream.next(m.spacing_x);
00295 stream.next(m.spacing_y);
00296 }
00297
00298 ROS_DECLARE_ALLINONE_SERIALIZER;
00299 };
00300 }
00301 }
00302
00303
00304 namespace ros
00305 {
00306 namespace serialization
00307 {
00308
00309 template<class ContainerAllocator> struct Serializer< ::kinect_depth_calibration::GetCheckerboardPoseResponse_<ContainerAllocator> >
00310 {
00311 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00312 {
00313 stream.next(m.board_pose);
00314 stream.next(m.min_x);
00315 stream.next(m.max_x);
00316 stream.next(m.min_y);
00317 stream.next(m.max_y);
00318 stream.next(m.noise_vel);
00319 stream.next(m.noise_rot);
00320 }
00321
00322 ROS_DECLARE_ALLINONE_SERIALIZER;
00323 };
00324 }
00325 }
00326
00327 namespace ros
00328 {
00329 namespace service_traits
00330 {
00331 template<>
00332 struct MD5Sum<kinect_depth_calibration::GetCheckerboardPose> {
00333 static const char* value()
00334 {
00335 return "f515725e9bae2b07fb95aab5c6865589";
00336 }
00337
00338 static const char* value(const kinect_depth_calibration::GetCheckerboardPose&) { return value(); }
00339 };
00340
00341 template<>
00342 struct DataType<kinect_depth_calibration::GetCheckerboardPose> {
00343 static const char* value()
00344 {
00345 return "kinect_depth_calibration/GetCheckerboardPose";
00346 }
00347
00348 static const char* value(const kinect_depth_calibration::GetCheckerboardPose&) { return value(); }
00349 };
00350
00351 template<class ContainerAllocator>
00352 struct MD5Sum<kinect_depth_calibration::GetCheckerboardPoseRequest_<ContainerAllocator> > {
00353 static const char* value()
00354 {
00355 return "f515725e9bae2b07fb95aab5c6865589";
00356 }
00357
00358 static const char* value(const kinect_depth_calibration::GetCheckerboardPoseRequest_<ContainerAllocator> &) { return value(); }
00359 };
00360
00361 template<class ContainerAllocator>
00362 struct DataType<kinect_depth_calibration::GetCheckerboardPoseRequest_<ContainerAllocator> > {
00363 static const char* value()
00364 {
00365 return "kinect_depth_calibration/GetCheckerboardPose";
00366 }
00367
00368 static const char* value(const kinect_depth_calibration::GetCheckerboardPoseRequest_<ContainerAllocator> &) { return value(); }
00369 };
00370
00371 template<class ContainerAllocator>
00372 struct MD5Sum<kinect_depth_calibration::GetCheckerboardPoseResponse_<ContainerAllocator> > {
00373 static const char* value()
00374 {
00375 return "f515725e9bae2b07fb95aab5c6865589";
00376 }
00377
00378 static const char* value(const kinect_depth_calibration::GetCheckerboardPoseResponse_<ContainerAllocator> &) { return value(); }
00379 };
00380
00381 template<class ContainerAllocator>
00382 struct DataType<kinect_depth_calibration::GetCheckerboardPoseResponse_<ContainerAllocator> > {
00383 static const char* value()
00384 {
00385 return "kinect_depth_calibration/GetCheckerboardPose";
00386 }
00387
00388 static const char* value(const kinect_depth_calibration::GetCheckerboardPoseResponse_<ContainerAllocator> &) { return value(); }
00389 };
00390
00391 }
00392 }
00393
00394 #endif // KINECT_DEPTH_CALIBRATION_SERVICE_GETCHECKERBOARDPOSE_H
00395