00001
00002 #ifndef STEREO_WALL_DETECTION_SERVICE_DETECTWALL_H
00003 #define STEREO_WALL_DETECTION_SERVICE_DETECTWALL_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/PointStamped.h"
00018 #include "geometry_msgs/Vector3Stamped.h"
00019
00020 namespace stereo_wall_detection
00021 {
00022 template <class ContainerAllocator>
00023 struct DetectWallRequest_ : public ros::Message
00024 {
00025 typedef DetectWallRequest_<ContainerAllocator> Type;
00026
00027 DetectWallRequest_()
00028 {
00029 }
00030
00031 DetectWallRequest_(const ContainerAllocator& _alloc)
00032 {
00033 }
00034
00035
00036 private:
00037 static const char* __s_getDataType_() { return "stereo_wall_detection/DetectWallRequest"; }
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 "a6870b3c0e483b78cb98aac96d566717"; }
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< ::stereo_wall_detection::DetectWallRequest_<ContainerAllocator> > Ptr;
00084 typedef boost::shared_ptr< ::stereo_wall_detection::DetectWallRequest_<ContainerAllocator> const> ConstPtr;
00085 };
00086 typedef ::stereo_wall_detection::DetectWallRequest_<std::allocator<void> > DetectWallRequest;
00087
00088 typedef boost::shared_ptr< ::stereo_wall_detection::DetectWallRequest> DetectWallRequestPtr;
00089 typedef boost::shared_ptr< ::stereo_wall_detection::DetectWallRequest const> DetectWallRequestConstPtr;
00090
00091
00092 template <class ContainerAllocator>
00093 struct DetectWallResponse_ : public ros::Message
00094 {
00095 typedef DetectWallResponse_<ContainerAllocator> Type;
00096
00097 DetectWallResponse_()
00098 : wall_point()
00099 , wall_norm()
00100 {
00101 }
00102
00103 DetectWallResponse_(const ContainerAllocator& _alloc)
00104 : wall_point(_alloc)
00105 , wall_norm(_alloc)
00106 {
00107 }
00108
00109 typedef ::geometry_msgs::PointStamped_<ContainerAllocator> _wall_point_type;
00110 ::geometry_msgs::PointStamped_<ContainerAllocator> wall_point;
00111
00112 typedef ::geometry_msgs::Vector3Stamped_<ContainerAllocator> _wall_norm_type;
00113 ::geometry_msgs::Vector3Stamped_<ContainerAllocator> wall_norm;
00114
00115
00116 private:
00117 static const char* __s_getDataType_() { return "stereo_wall_detection/DetectWallResponse"; }
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 "a6870b3c0e483b78cb98aac96d566717"; }
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 "a6870b3c0e483b78cb98aac96d566717"; }
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 "geometry_msgs/PointStamped wall_point\n\
00139 geometry_msgs/Vector3Stamped wall_norm\n\
00140 \n\
00141 \n\
00142 ================================================================================\n\
00143 MSG: geometry_msgs/PointStamped\n\
00144 # This represents a Point with reference coordinate frame and timestamp\n\
00145 Header header\n\
00146 Point point\n\
00147 \n\
00148 ================================================================================\n\
00149 MSG: std_msgs/Header\n\
00150 # Standard metadata for higher-level stamped data types.\n\
00151 # This is generally used to communicate timestamped data \n\
00152 # in a particular coordinate frame.\n\
00153 # \n\
00154 # sequence ID: consecutively increasing ID \n\
00155 uint32 seq\n\
00156 #Two-integer timestamp that is expressed as:\n\
00157 # * stamp.secs: seconds (stamp_secs) since epoch\n\
00158 # * stamp.nsecs: nanoseconds since stamp_secs\n\
00159 # time-handling sugar is provided by the client library\n\
00160 time stamp\n\
00161 #Frame this data is associated with\n\
00162 # 0: no frame\n\
00163 # 1: global frame\n\
00164 string frame_id\n\
00165 \n\
00166 ================================================================================\n\
00167 MSG: geometry_msgs/Point\n\
00168 # This contains the position of a point in free space\n\
00169 float64 x\n\
00170 float64 y\n\
00171 float64 z\n\
00172 \n\
00173 ================================================================================\n\
00174 MSG: geometry_msgs/Vector3Stamped\n\
00175 # This represents a Vector3 with reference coordinate frame and timestamp\n\
00176 Header header\n\
00177 Vector3 vector\n\
00178 \n\
00179 ================================================================================\n\
00180 MSG: geometry_msgs/Vector3\n\
00181 # This represents a vector in free space. \n\
00182 \n\
00183 float64 x\n\
00184 float64 y\n\
00185 float64 z\n\
00186 "; }
00187 public:
00188 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); }
00189
00190 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); }
00191
00192 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const
00193 {
00194 ros::serialization::OStream stream(write_ptr, 1000000000);
00195 ros::serialization::serialize(stream, wall_point);
00196 ros::serialization::serialize(stream, wall_norm);
00197 return stream.getData();
00198 }
00199
00200 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr)
00201 {
00202 ros::serialization::IStream stream(read_ptr, 1000000000);
00203 ros::serialization::deserialize(stream, wall_point);
00204 ros::serialization::deserialize(stream, wall_norm);
00205 return stream.getData();
00206 }
00207
00208 ROS_DEPRECATED virtual uint32_t serializationLength() const
00209 {
00210 uint32_t size = 0;
00211 size += ros::serialization::serializationLength(wall_point);
00212 size += ros::serialization::serializationLength(wall_norm);
00213 return size;
00214 }
00215
00216 typedef boost::shared_ptr< ::stereo_wall_detection::DetectWallResponse_<ContainerAllocator> > Ptr;
00217 typedef boost::shared_ptr< ::stereo_wall_detection::DetectWallResponse_<ContainerAllocator> const> ConstPtr;
00218 };
00219 typedef ::stereo_wall_detection::DetectWallResponse_<std::allocator<void> > DetectWallResponse;
00220
00221 typedef boost::shared_ptr< ::stereo_wall_detection::DetectWallResponse> DetectWallResponsePtr;
00222 typedef boost::shared_ptr< ::stereo_wall_detection::DetectWallResponse const> DetectWallResponseConstPtr;
00223
00224 struct DetectWall
00225 {
00226
00227 typedef DetectWallRequest Request;
00228 typedef DetectWallResponse Response;
00229 Request request;
00230 Response response;
00231
00232 typedef Request RequestType;
00233 typedef Response ResponseType;
00234 };
00235 }
00236
00237 namespace ros
00238 {
00239 namespace message_traits
00240 {
00241 template<class ContainerAllocator>
00242 struct MD5Sum< ::stereo_wall_detection::DetectWallRequest_<ContainerAllocator> > {
00243 static const char* value()
00244 {
00245 return "d41d8cd98f00b204e9800998ecf8427e";
00246 }
00247
00248 static const char* value(const ::stereo_wall_detection::DetectWallRequest_<ContainerAllocator> &) { return value(); }
00249 static const uint64_t static_value1 = 0xd41d8cd98f00b204ULL;
00250 static const uint64_t static_value2 = 0xe9800998ecf8427eULL;
00251 };
00252
00253 template<class ContainerAllocator>
00254 struct DataType< ::stereo_wall_detection::DetectWallRequest_<ContainerAllocator> > {
00255 static const char* value()
00256 {
00257 return "stereo_wall_detection/DetectWallRequest";
00258 }
00259
00260 static const char* value(const ::stereo_wall_detection::DetectWallRequest_<ContainerAllocator> &) { return value(); }
00261 };
00262
00263 template<class ContainerAllocator>
00264 struct Definition< ::stereo_wall_detection::DetectWallRequest_<ContainerAllocator> > {
00265 static const char* value()
00266 {
00267 return "\n\
00268 ";
00269 }
00270
00271 static const char* value(const ::stereo_wall_detection::DetectWallRequest_<ContainerAllocator> &) { return value(); }
00272 };
00273
00274 template<class ContainerAllocator> struct IsFixedSize< ::stereo_wall_detection::DetectWallRequest_<ContainerAllocator> > : public TrueType {};
00275 }
00276 }
00277
00278
00279 namespace ros
00280 {
00281 namespace message_traits
00282 {
00283 template<class ContainerAllocator>
00284 struct MD5Sum< ::stereo_wall_detection::DetectWallResponse_<ContainerAllocator> > {
00285 static const char* value()
00286 {
00287 return "a6870b3c0e483b78cb98aac96d566717";
00288 }
00289
00290 static const char* value(const ::stereo_wall_detection::DetectWallResponse_<ContainerAllocator> &) { return value(); }
00291 static const uint64_t static_value1 = 0xa6870b3c0e483b78ULL;
00292 static const uint64_t static_value2 = 0xcb98aac96d566717ULL;
00293 };
00294
00295 template<class ContainerAllocator>
00296 struct DataType< ::stereo_wall_detection::DetectWallResponse_<ContainerAllocator> > {
00297 static const char* value()
00298 {
00299 return "stereo_wall_detection/DetectWallResponse";
00300 }
00301
00302 static const char* value(const ::stereo_wall_detection::DetectWallResponse_<ContainerAllocator> &) { return value(); }
00303 };
00304
00305 template<class ContainerAllocator>
00306 struct Definition< ::stereo_wall_detection::DetectWallResponse_<ContainerAllocator> > {
00307 static const char* value()
00308 {
00309 return "geometry_msgs/PointStamped wall_point\n\
00310 geometry_msgs/Vector3Stamped wall_norm\n\
00311 \n\
00312 \n\
00313 ================================================================================\n\
00314 MSG: geometry_msgs/PointStamped\n\
00315 # This represents a Point with reference coordinate frame and timestamp\n\
00316 Header header\n\
00317 Point point\n\
00318 \n\
00319 ================================================================================\n\
00320 MSG: std_msgs/Header\n\
00321 # Standard metadata for higher-level stamped data types.\n\
00322 # This is generally used to communicate timestamped data \n\
00323 # in a particular coordinate frame.\n\
00324 # \n\
00325 # sequence ID: consecutively increasing ID \n\
00326 uint32 seq\n\
00327 #Two-integer timestamp that is expressed as:\n\
00328 # * stamp.secs: seconds (stamp_secs) since epoch\n\
00329 # * stamp.nsecs: nanoseconds since stamp_secs\n\
00330 # time-handling sugar is provided by the client library\n\
00331 time stamp\n\
00332 #Frame this data is associated with\n\
00333 # 0: no frame\n\
00334 # 1: global frame\n\
00335 string frame_id\n\
00336 \n\
00337 ================================================================================\n\
00338 MSG: geometry_msgs/Point\n\
00339 # This contains the position of a point in free space\n\
00340 float64 x\n\
00341 float64 y\n\
00342 float64 z\n\
00343 \n\
00344 ================================================================================\n\
00345 MSG: geometry_msgs/Vector3Stamped\n\
00346 # This represents a Vector3 with reference coordinate frame and timestamp\n\
00347 Header header\n\
00348 Vector3 vector\n\
00349 \n\
00350 ================================================================================\n\
00351 MSG: geometry_msgs/Vector3\n\
00352 # This represents a vector in free space. \n\
00353 \n\
00354 float64 x\n\
00355 float64 y\n\
00356 float64 z\n\
00357 ";
00358 }
00359
00360 static const char* value(const ::stereo_wall_detection::DetectWallResponse_<ContainerAllocator> &) { return value(); }
00361 };
00362
00363 }
00364 }
00365
00366 namespace ros
00367 {
00368 namespace serialization
00369 {
00370
00371 template<class ContainerAllocator> struct Serializer< ::stereo_wall_detection::DetectWallRequest_<ContainerAllocator> >
00372 {
00373 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00374 {
00375 }
00376
00377 ROS_DECLARE_ALLINONE_SERIALIZER;
00378 };
00379 }
00380 }
00381
00382
00383 namespace ros
00384 {
00385 namespace serialization
00386 {
00387
00388 template<class ContainerAllocator> struct Serializer< ::stereo_wall_detection::DetectWallResponse_<ContainerAllocator> >
00389 {
00390 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00391 {
00392 stream.next(m.wall_point);
00393 stream.next(m.wall_norm);
00394 }
00395
00396 ROS_DECLARE_ALLINONE_SERIALIZER;
00397 };
00398 }
00399 }
00400
00401 namespace ros
00402 {
00403 namespace service_traits
00404 {
00405 template<>
00406 struct MD5Sum<stereo_wall_detection::DetectWall> {
00407 static const char* value()
00408 {
00409 return "a6870b3c0e483b78cb98aac96d566717";
00410 }
00411
00412 static const char* value(const stereo_wall_detection::DetectWall&) { return value(); }
00413 };
00414
00415 template<>
00416 struct DataType<stereo_wall_detection::DetectWall> {
00417 static const char* value()
00418 {
00419 return "stereo_wall_detection/DetectWall";
00420 }
00421
00422 static const char* value(const stereo_wall_detection::DetectWall&) { return value(); }
00423 };
00424
00425 template<class ContainerAllocator>
00426 struct MD5Sum<stereo_wall_detection::DetectWallRequest_<ContainerAllocator> > {
00427 static const char* value()
00428 {
00429 return "a6870b3c0e483b78cb98aac96d566717";
00430 }
00431
00432 static const char* value(const stereo_wall_detection::DetectWallRequest_<ContainerAllocator> &) { return value(); }
00433 };
00434
00435 template<class ContainerAllocator>
00436 struct DataType<stereo_wall_detection::DetectWallRequest_<ContainerAllocator> > {
00437 static const char* value()
00438 {
00439 return "stereo_wall_detection/DetectWall";
00440 }
00441
00442 static const char* value(const stereo_wall_detection::DetectWallRequest_<ContainerAllocator> &) { return value(); }
00443 };
00444
00445 template<class ContainerAllocator>
00446 struct MD5Sum<stereo_wall_detection::DetectWallResponse_<ContainerAllocator> > {
00447 static const char* value()
00448 {
00449 return "a6870b3c0e483b78cb98aac96d566717";
00450 }
00451
00452 static const char* value(const stereo_wall_detection::DetectWallResponse_<ContainerAllocator> &) { return value(); }
00453 };
00454
00455 template<class ContainerAllocator>
00456 struct DataType<stereo_wall_detection::DetectWallResponse_<ContainerAllocator> > {
00457 static const char* value()
00458 {
00459 return "stereo_wall_detection/DetectWall";
00460 }
00461
00462 static const char* value(const stereo_wall_detection::DetectWallResponse_<ContainerAllocator> &) { return value(); }
00463 };
00464
00465 }
00466 }
00467
00468 #endif // STEREO_WALL_DETECTION_SERVICE_DETECTWALL_H
00469