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