00001
00002 #ifndef COB_CAMERA_SENSORS_SERVICE_GETTOFIMAGES_H
00003 #define COB_CAMERA_SENSORS_SERVICE_GETTOFIMAGES_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 "sensor_msgs/Image.h"
00018 #include "sensor_msgs/Image.h"
00019
00020 namespace cob_camera_sensors
00021 {
00022 template <class ContainerAllocator>
00023 struct GetTOFImagesRequest_ : public ros::Message
00024 {
00025 typedef GetTOFImagesRequest_<ContainerAllocator> Type;
00026
00027 GetTOFImagesRequest_()
00028 {
00029 }
00030
00031 GetTOFImagesRequest_(const ContainerAllocator& _alloc)
00032 {
00033 }
00034
00035
00036 private:
00037 static const char* __s_getDataType_() { return "cob_camera_sensors/GetTOFImagesRequest"; }
00038 public:
00039 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); }
00040
00041 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); }
00042
00043 private:
00044 static const char* __s_getMD5Sum_() { return "d41d8cd98f00b204e9800998ecf8427e"; }
00045 public:
00046 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); }
00047
00048 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); }
00049
00050 private:
00051 static const char* __s_getServerMD5Sum_() { return "245ce4e6dd0ec61a5c674c8191a91877"; }
00052 public:
00053 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); }
00054
00055 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); }
00056
00057 private:
00058 static const char* __s_getMessageDefinition_() { return "\n\
00059 "; }
00060 public:
00061 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); }
00062
00063 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); }
00064
00065 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const
00066 {
00067 ros::serialization::OStream stream(write_ptr, 1000000000);
00068 return stream.getData();
00069 }
00070
00071 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr)
00072 {
00073 ros::serialization::IStream stream(read_ptr, 1000000000);
00074 return stream.getData();
00075 }
00076
00077 ROS_DEPRECATED virtual uint32_t serializationLength() const
00078 {
00079 uint32_t size = 0;
00080 return size;
00081 }
00082
00083 typedef boost::shared_ptr< ::cob_camera_sensors::GetTOFImagesRequest_<ContainerAllocator> > Ptr;
00084 typedef boost::shared_ptr< ::cob_camera_sensors::GetTOFImagesRequest_<ContainerAllocator> const> ConstPtr;
00085 };
00086 typedef ::cob_camera_sensors::GetTOFImagesRequest_<std::allocator<void> > GetTOFImagesRequest;
00087
00088 typedef boost::shared_ptr< ::cob_camera_sensors::GetTOFImagesRequest> GetTOFImagesRequestPtr;
00089 typedef boost::shared_ptr< ::cob_camera_sensors::GetTOFImagesRequest const> GetTOFImagesRequestConstPtr;
00090
00091
00092 template <class ContainerAllocator>
00093 struct GetTOFImagesResponse_ : public ros::Message
00094 {
00095 typedef GetTOFImagesResponse_<ContainerAllocator> Type;
00096
00097 GetTOFImagesResponse_()
00098 : greyImage()
00099 , xyzImage()
00100 {
00101 }
00102
00103 GetTOFImagesResponse_(const ContainerAllocator& _alloc)
00104 : greyImage(_alloc)
00105 , xyzImage(_alloc)
00106 {
00107 }
00108
00109 typedef ::sensor_msgs::Image_<ContainerAllocator> _greyImage_type;
00110 ::sensor_msgs::Image_<ContainerAllocator> greyImage;
00111
00112 typedef ::sensor_msgs::Image_<ContainerAllocator> _xyzImage_type;
00113 ::sensor_msgs::Image_<ContainerAllocator> xyzImage;
00114
00115
00116 private:
00117 static const char* __s_getDataType_() { return "cob_camera_sensors/GetTOFImagesResponse"; }
00118 public:
00119 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); }
00120
00121 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); }
00122
00123 private:
00124 static const char* __s_getMD5Sum_() { return "245ce4e6dd0ec61a5c674c8191a91877"; }
00125 public:
00126 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); }
00127
00128 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); }
00129
00130 private:
00131 static const char* __s_getServerMD5Sum_() { return "245ce4e6dd0ec61a5c674c8191a91877"; }
00132 public:
00133 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); }
00134
00135 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); }
00136
00137 private:
00138 static const char* __s_getMessageDefinition_() { return "sensor_msgs/Image greyImage\n\
00139 sensor_msgs/Image xyzImage\n\
00140 \n\
00141 \n\
00142 ================================================================================\n\
00143 MSG: sensor_msgs/Image\n\
00144 # This message contains an uncompressed image\n\
00145 # (0, 0) is at top-left corner of image\n\
00146 #\n\
00147 \n\
00148 Header header # Header timestamp should be acquisition time of image\n\
00149 # Header frame_id should be optical frame of camera\n\
00150 # origin of frame should be optical center of cameara\n\
00151 # +x should point to the right in the image\n\
00152 # +y should point down in the image\n\
00153 # +z should point into to plane of the image\n\
00154 # If the frame_id here and the frame_id of the CameraInfo\n\
00155 # message associated with the image conflict\n\
00156 # the behavior is undefined\n\
00157 \n\
00158 uint32 height # image height, that is, number of rows\n\
00159 uint32 width # image width, that is, number of columns\n\
00160 \n\
00161 # The legal values for encoding are in file src/image_encodings.cpp\n\
00162 # If you want to standardize a new string format, join\n\
00163 # ros-users@lists.sourceforge.net and send an email proposing a new encoding.\n\
00164 \n\
00165 string encoding # Encoding of pixels -- channel meaning, ordering, size\n\
00166 # taken from the list of strings in src/image_encodings.cpp\n\
00167 \n\
00168 uint8 is_bigendian # is this data bigendian?\n\
00169 uint32 step # Full row length in bytes\n\
00170 uint8[] data # actual matrix data, size is (step * rows)\n\
00171 \n\
00172 ================================================================================\n\
00173 MSG: std_msgs/Header\n\
00174 # Standard metadata for higher-level stamped data types.\n\
00175 # This is generally used to communicate timestamped data \n\
00176 # in a particular coordinate frame.\n\
00177 # \n\
00178 # sequence ID: consecutively increasing ID \n\
00179 uint32 seq\n\
00180 #Two-integer timestamp that is expressed as:\n\
00181 # * stamp.secs: seconds (stamp_secs) since epoch\n\
00182 # * stamp.nsecs: nanoseconds since stamp_secs\n\
00183 # time-handling sugar is provided by the client library\n\
00184 time stamp\n\
00185 #Frame this data is associated with\n\
00186 # 0: no frame\n\
00187 # 1: global frame\n\
00188 string frame_id\n\
00189 \n\
00190 "; }
00191 public:
00192 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); }
00193
00194 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); }
00195
00196 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const
00197 {
00198 ros::serialization::OStream stream(write_ptr, 1000000000);
00199 ros::serialization::serialize(stream, greyImage);
00200 ros::serialization::serialize(stream, xyzImage);
00201 return stream.getData();
00202 }
00203
00204 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr)
00205 {
00206 ros::serialization::IStream stream(read_ptr, 1000000000);
00207 ros::serialization::deserialize(stream, greyImage);
00208 ros::serialization::deserialize(stream, xyzImage);
00209 return stream.getData();
00210 }
00211
00212 ROS_DEPRECATED virtual uint32_t serializationLength() const
00213 {
00214 uint32_t size = 0;
00215 size += ros::serialization::serializationLength(greyImage);
00216 size += ros::serialization::serializationLength(xyzImage);
00217 return size;
00218 }
00219
00220 typedef boost::shared_ptr< ::cob_camera_sensors::GetTOFImagesResponse_<ContainerAllocator> > Ptr;
00221 typedef boost::shared_ptr< ::cob_camera_sensors::GetTOFImagesResponse_<ContainerAllocator> const> ConstPtr;
00222 };
00223 typedef ::cob_camera_sensors::GetTOFImagesResponse_<std::allocator<void> > GetTOFImagesResponse;
00224
00225 typedef boost::shared_ptr< ::cob_camera_sensors::GetTOFImagesResponse> GetTOFImagesResponsePtr;
00226 typedef boost::shared_ptr< ::cob_camera_sensors::GetTOFImagesResponse const> GetTOFImagesResponseConstPtr;
00227
00228 struct GetTOFImages
00229 {
00230
00231 typedef GetTOFImagesRequest Request;
00232 typedef GetTOFImagesResponse Response;
00233 Request request;
00234 Response response;
00235
00236 typedef Request RequestType;
00237 typedef Response ResponseType;
00238 };
00239 }
00240
00241 namespace ros
00242 {
00243 namespace message_traits
00244 {
00245 template<class ContainerAllocator>
00246 struct MD5Sum< ::cob_camera_sensors::GetTOFImagesRequest_<ContainerAllocator> > {
00247 static const char* value()
00248 {
00249 return "d41d8cd98f00b204e9800998ecf8427e";
00250 }
00251
00252 static const char* value(const ::cob_camera_sensors::GetTOFImagesRequest_<ContainerAllocator> &) { return value(); }
00253 static const uint64_t static_value1 = 0xd41d8cd98f00b204ULL;
00254 static const uint64_t static_value2 = 0xe9800998ecf8427eULL;
00255 };
00256
00257 template<class ContainerAllocator>
00258 struct DataType< ::cob_camera_sensors::GetTOFImagesRequest_<ContainerAllocator> > {
00259 static const char* value()
00260 {
00261 return "cob_camera_sensors/GetTOFImagesRequest";
00262 }
00263
00264 static const char* value(const ::cob_camera_sensors::GetTOFImagesRequest_<ContainerAllocator> &) { return value(); }
00265 };
00266
00267 template<class ContainerAllocator>
00268 struct Definition< ::cob_camera_sensors::GetTOFImagesRequest_<ContainerAllocator> > {
00269 static const char* value()
00270 {
00271 return "\n\
00272 ";
00273 }
00274
00275 static const char* value(const ::cob_camera_sensors::GetTOFImagesRequest_<ContainerAllocator> &) { return value(); }
00276 };
00277
00278 template<class ContainerAllocator> struct IsFixedSize< ::cob_camera_sensors::GetTOFImagesRequest_<ContainerAllocator> > : public TrueType {};
00279 }
00280 }
00281
00282
00283 namespace ros
00284 {
00285 namespace message_traits
00286 {
00287 template<class ContainerAllocator>
00288 struct MD5Sum< ::cob_camera_sensors::GetTOFImagesResponse_<ContainerAllocator> > {
00289 static const char* value()
00290 {
00291 return "245ce4e6dd0ec61a5c674c8191a91877";
00292 }
00293
00294 static const char* value(const ::cob_camera_sensors::GetTOFImagesResponse_<ContainerAllocator> &) { return value(); }
00295 static const uint64_t static_value1 = 0x245ce4e6dd0ec61aULL;
00296 static const uint64_t static_value2 = 0x5c674c8191a91877ULL;
00297 };
00298
00299 template<class ContainerAllocator>
00300 struct DataType< ::cob_camera_sensors::GetTOFImagesResponse_<ContainerAllocator> > {
00301 static const char* value()
00302 {
00303 return "cob_camera_sensors/GetTOFImagesResponse";
00304 }
00305
00306 static const char* value(const ::cob_camera_sensors::GetTOFImagesResponse_<ContainerAllocator> &) { return value(); }
00307 };
00308
00309 template<class ContainerAllocator>
00310 struct Definition< ::cob_camera_sensors::GetTOFImagesResponse_<ContainerAllocator> > {
00311 static const char* value()
00312 {
00313 return "sensor_msgs/Image greyImage\n\
00314 sensor_msgs/Image xyzImage\n\
00315 \n\
00316 \n\
00317 ================================================================================\n\
00318 MSG: sensor_msgs/Image\n\
00319 # This message contains an uncompressed image\n\
00320 # (0, 0) is at top-left corner of image\n\
00321 #\n\
00322 \n\
00323 Header header # Header timestamp should be acquisition time of image\n\
00324 # Header frame_id should be optical frame of camera\n\
00325 # origin of frame should be optical center of cameara\n\
00326 # +x should point to the right in the image\n\
00327 # +y should point down in the image\n\
00328 # +z should point into to plane of the image\n\
00329 # If the frame_id here and the frame_id of the CameraInfo\n\
00330 # message associated with the image conflict\n\
00331 # the behavior is undefined\n\
00332 \n\
00333 uint32 height # image height, that is, number of rows\n\
00334 uint32 width # image width, that is, number of columns\n\
00335 \n\
00336 # The legal values for encoding are in file src/image_encodings.cpp\n\
00337 # If you want to standardize a new string format, join\n\
00338 # ros-users@lists.sourceforge.net and send an email proposing a new encoding.\n\
00339 \n\
00340 string encoding # Encoding of pixels -- channel meaning, ordering, size\n\
00341 # taken from the list of strings in src/image_encodings.cpp\n\
00342 \n\
00343 uint8 is_bigendian # is this data bigendian?\n\
00344 uint32 step # Full row length in bytes\n\
00345 uint8[] data # actual matrix data, size is (step * rows)\n\
00346 \n\
00347 ================================================================================\n\
00348 MSG: std_msgs/Header\n\
00349 # Standard metadata for higher-level stamped data types.\n\
00350 # This is generally used to communicate timestamped data \n\
00351 # in a particular coordinate frame.\n\
00352 # \n\
00353 # sequence ID: consecutively increasing ID \n\
00354 uint32 seq\n\
00355 #Two-integer timestamp that is expressed as:\n\
00356 # * stamp.secs: seconds (stamp_secs) since epoch\n\
00357 # * stamp.nsecs: nanoseconds since stamp_secs\n\
00358 # time-handling sugar is provided by the client library\n\
00359 time stamp\n\
00360 #Frame this data is associated with\n\
00361 # 0: no frame\n\
00362 # 1: global frame\n\
00363 string frame_id\n\
00364 \n\
00365 ";
00366 }
00367
00368 static const char* value(const ::cob_camera_sensors::GetTOFImagesResponse_<ContainerAllocator> &) { return value(); }
00369 };
00370
00371 }
00372 }
00373
00374 namespace ros
00375 {
00376 namespace serialization
00377 {
00378
00379 template<class ContainerAllocator> struct Serializer< ::cob_camera_sensors::GetTOFImagesRequest_<ContainerAllocator> >
00380 {
00381 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00382 {
00383 }
00384
00385 ROS_DECLARE_ALLINONE_SERIALIZER;
00386 };
00387 }
00388 }
00389
00390
00391 namespace ros
00392 {
00393 namespace serialization
00394 {
00395
00396 template<class ContainerAllocator> struct Serializer< ::cob_camera_sensors::GetTOFImagesResponse_<ContainerAllocator> >
00397 {
00398 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00399 {
00400 stream.next(m.greyImage);
00401 stream.next(m.xyzImage);
00402 }
00403
00404 ROS_DECLARE_ALLINONE_SERIALIZER;
00405 };
00406 }
00407 }
00408
00409 namespace ros
00410 {
00411 namespace service_traits
00412 {
00413 template<>
00414 struct MD5Sum<cob_camera_sensors::GetTOFImages> {
00415 static const char* value()
00416 {
00417 return "245ce4e6dd0ec61a5c674c8191a91877";
00418 }
00419
00420 static const char* value(const cob_camera_sensors::GetTOFImages&) { return value(); }
00421 };
00422
00423 template<>
00424 struct DataType<cob_camera_sensors::GetTOFImages> {
00425 static const char* value()
00426 {
00427 return "cob_camera_sensors/GetTOFImages";
00428 }
00429
00430 static const char* value(const cob_camera_sensors::GetTOFImages&) { return value(); }
00431 };
00432
00433 template<class ContainerAllocator>
00434 struct MD5Sum<cob_camera_sensors::GetTOFImagesRequest_<ContainerAllocator> > {
00435 static const char* value()
00436 {
00437 return "245ce4e6dd0ec61a5c674c8191a91877";
00438 }
00439
00440 static const char* value(const cob_camera_sensors::GetTOFImagesRequest_<ContainerAllocator> &) { return value(); }
00441 };
00442
00443 template<class ContainerAllocator>
00444 struct DataType<cob_camera_sensors::GetTOFImagesRequest_<ContainerAllocator> > {
00445 static const char* value()
00446 {
00447 return "cob_camera_sensors/GetTOFImages";
00448 }
00449
00450 static const char* value(const cob_camera_sensors::GetTOFImagesRequest_<ContainerAllocator> &) { return value(); }
00451 };
00452
00453 template<class ContainerAllocator>
00454 struct MD5Sum<cob_camera_sensors::GetTOFImagesResponse_<ContainerAllocator> > {
00455 static const char* value()
00456 {
00457 return "245ce4e6dd0ec61a5c674c8191a91877";
00458 }
00459
00460 static const char* value(const cob_camera_sensors::GetTOFImagesResponse_<ContainerAllocator> &) { return value(); }
00461 };
00462
00463 template<class ContainerAllocator>
00464 struct DataType<cob_camera_sensors::GetTOFImagesResponse_<ContainerAllocator> > {
00465 static const char* value()
00466 {
00467 return "cob_camera_sensors/GetTOFImages";
00468 }
00469
00470 static const char* value(const cob_camera_sensors::GetTOFImagesResponse_<ContainerAllocator> &) { return value(); }
00471 };
00472
00473 }
00474 }
00475
00476 #endif // COB_CAMERA_SENSORS_SERVICE_GETTOFIMAGES_H
00477