Go to the documentation of this file.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 <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/PointStamped.h"
00022 #include "geometry_msgs/Vector3Stamped.h"
00023
00024 namespace stereo_wall_detection
00025 {
00026 template <class ContainerAllocator>
00027 struct DetectWallRequest_ {
00028 typedef DetectWallRequest_<ContainerAllocator> Type;
00029
00030 DetectWallRequest_()
00031 {
00032 }
00033
00034 DetectWallRequest_(const ContainerAllocator& _alloc)
00035 {
00036 }
00037
00038
00039 typedef boost::shared_ptr< ::stereo_wall_detection::DetectWallRequest_<ContainerAllocator> > Ptr;
00040 typedef boost::shared_ptr< ::stereo_wall_detection::DetectWallRequest_<ContainerAllocator> const> ConstPtr;
00041 boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00042 };
00043 typedef ::stereo_wall_detection::DetectWallRequest_<std::allocator<void> > DetectWallRequest;
00044
00045 typedef boost::shared_ptr< ::stereo_wall_detection::DetectWallRequest> DetectWallRequestPtr;
00046 typedef boost::shared_ptr< ::stereo_wall_detection::DetectWallRequest const> DetectWallRequestConstPtr;
00047
00048
00049 template <class ContainerAllocator>
00050 struct DetectWallResponse_ {
00051 typedef DetectWallResponse_<ContainerAllocator> Type;
00052
00053 DetectWallResponse_()
00054 : wall_point()
00055 , wall_norm()
00056 {
00057 }
00058
00059 DetectWallResponse_(const ContainerAllocator& _alloc)
00060 : wall_point(_alloc)
00061 , wall_norm(_alloc)
00062 {
00063 }
00064
00065 typedef ::geometry_msgs::PointStamped_<ContainerAllocator> _wall_point_type;
00066 ::geometry_msgs::PointStamped_<ContainerAllocator> wall_point;
00067
00068 typedef ::geometry_msgs::Vector3Stamped_<ContainerAllocator> _wall_norm_type;
00069 ::geometry_msgs::Vector3Stamped_<ContainerAllocator> wall_norm;
00070
00071
00072 typedef boost::shared_ptr< ::stereo_wall_detection::DetectWallResponse_<ContainerAllocator> > Ptr;
00073 typedef boost::shared_ptr< ::stereo_wall_detection::DetectWallResponse_<ContainerAllocator> const> ConstPtr;
00074 boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00075 };
00076 typedef ::stereo_wall_detection::DetectWallResponse_<std::allocator<void> > DetectWallResponse;
00077
00078 typedef boost::shared_ptr< ::stereo_wall_detection::DetectWallResponse> DetectWallResponsePtr;
00079 typedef boost::shared_ptr< ::stereo_wall_detection::DetectWallResponse const> DetectWallResponseConstPtr;
00080
00081 struct DetectWall
00082 {
00083
00084 typedef DetectWallRequest Request;
00085 typedef DetectWallResponse Response;
00086 Request request;
00087 Response response;
00088
00089 typedef Request RequestType;
00090 typedef Response ResponseType;
00091 };
00092 }
00093
00094 namespace ros
00095 {
00096 namespace message_traits
00097 {
00098 template<class ContainerAllocator> struct IsMessage< ::stereo_wall_detection::DetectWallRequest_<ContainerAllocator> > : public TrueType {};
00099 template<class ContainerAllocator> struct IsMessage< ::stereo_wall_detection::DetectWallRequest_<ContainerAllocator> const> : public TrueType {};
00100 template<class ContainerAllocator>
00101 struct MD5Sum< ::stereo_wall_detection::DetectWallRequest_<ContainerAllocator> > {
00102 static const char* value()
00103 {
00104 return "d41d8cd98f00b204e9800998ecf8427e";
00105 }
00106
00107 static const char* value(const ::stereo_wall_detection::DetectWallRequest_<ContainerAllocator> &) { return value(); }
00108 static const uint64_t static_value1 = 0xd41d8cd98f00b204ULL;
00109 static const uint64_t static_value2 = 0xe9800998ecf8427eULL;
00110 };
00111
00112 template<class ContainerAllocator>
00113 struct DataType< ::stereo_wall_detection::DetectWallRequest_<ContainerAllocator> > {
00114 static const char* value()
00115 {
00116 return "stereo_wall_detection/DetectWallRequest";
00117 }
00118
00119 static const char* value(const ::stereo_wall_detection::DetectWallRequest_<ContainerAllocator> &) { return value(); }
00120 };
00121
00122 template<class ContainerAllocator>
00123 struct Definition< ::stereo_wall_detection::DetectWallRequest_<ContainerAllocator> > {
00124 static const char* value()
00125 {
00126 return "\n\
00127 ";
00128 }
00129
00130 static const char* value(const ::stereo_wall_detection::DetectWallRequest_<ContainerAllocator> &) { return value(); }
00131 };
00132
00133 template<class ContainerAllocator> struct IsFixedSize< ::stereo_wall_detection::DetectWallRequest_<ContainerAllocator> > : public TrueType {};
00134 }
00135 }
00136
00137
00138 namespace ros
00139 {
00140 namespace message_traits
00141 {
00142 template<class ContainerAllocator> struct IsMessage< ::stereo_wall_detection::DetectWallResponse_<ContainerAllocator> > : public TrueType {};
00143 template<class ContainerAllocator> struct IsMessage< ::stereo_wall_detection::DetectWallResponse_<ContainerAllocator> const> : public TrueType {};
00144 template<class ContainerAllocator>
00145 struct MD5Sum< ::stereo_wall_detection::DetectWallResponse_<ContainerAllocator> > {
00146 static const char* value()
00147 {
00148 return "a6870b3c0e483b78cb98aac96d566717";
00149 }
00150
00151 static const char* value(const ::stereo_wall_detection::DetectWallResponse_<ContainerAllocator> &) { return value(); }
00152 static const uint64_t static_value1 = 0xa6870b3c0e483b78ULL;
00153 static const uint64_t static_value2 = 0xcb98aac96d566717ULL;
00154 };
00155
00156 template<class ContainerAllocator>
00157 struct DataType< ::stereo_wall_detection::DetectWallResponse_<ContainerAllocator> > {
00158 static const char* value()
00159 {
00160 return "stereo_wall_detection/DetectWallResponse";
00161 }
00162
00163 static const char* value(const ::stereo_wall_detection::DetectWallResponse_<ContainerAllocator> &) { return value(); }
00164 };
00165
00166 template<class ContainerAllocator>
00167 struct Definition< ::stereo_wall_detection::DetectWallResponse_<ContainerAllocator> > {
00168 static const char* value()
00169 {
00170 return "geometry_msgs/PointStamped wall_point\n\
00171 geometry_msgs/Vector3Stamped wall_norm\n\
00172 \n\
00173 \n\
00174 ================================================================================\n\
00175 MSG: geometry_msgs/PointStamped\n\
00176 # This represents a Point with reference coordinate frame and timestamp\n\
00177 Header header\n\
00178 Point point\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/Point\n\
00200 # This contains the position of a point in free space\n\
00201 float64 x\n\
00202 float64 y\n\
00203 float64 z\n\
00204 \n\
00205 ================================================================================\n\
00206 MSG: geometry_msgs/Vector3Stamped\n\
00207 # This represents a Vector3 with reference coordinate frame and timestamp\n\
00208 Header header\n\
00209 Vector3 vector\n\
00210 \n\
00211 ================================================================================\n\
00212 MSG: geometry_msgs/Vector3\n\
00213 # This represents a vector in free space. \n\
00214 \n\
00215 float64 x\n\
00216 float64 y\n\
00217 float64 z\n\
00218 ";
00219 }
00220
00221 static const char* value(const ::stereo_wall_detection::DetectWallResponse_<ContainerAllocator> &) { return value(); }
00222 };
00223
00224 }
00225 }
00226
00227 namespace ros
00228 {
00229 namespace serialization
00230 {
00231
00232 template<class ContainerAllocator> struct Serializer< ::stereo_wall_detection::DetectWallRequest_<ContainerAllocator> >
00233 {
00234 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00235 {
00236 }
00237
00238 ROS_DECLARE_ALLINONE_SERIALIZER;
00239 };
00240 }
00241 }
00242
00243
00244 namespace ros
00245 {
00246 namespace serialization
00247 {
00248
00249 template<class ContainerAllocator> struct Serializer< ::stereo_wall_detection::DetectWallResponse_<ContainerAllocator> >
00250 {
00251 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00252 {
00253 stream.next(m.wall_point);
00254 stream.next(m.wall_norm);
00255 }
00256
00257 ROS_DECLARE_ALLINONE_SERIALIZER;
00258 };
00259 }
00260 }
00261
00262 namespace ros
00263 {
00264 namespace service_traits
00265 {
00266 template<>
00267 struct MD5Sum<stereo_wall_detection::DetectWall> {
00268 static const char* value()
00269 {
00270 return "a6870b3c0e483b78cb98aac96d566717";
00271 }
00272
00273 static const char* value(const stereo_wall_detection::DetectWall&) { return value(); }
00274 };
00275
00276 template<>
00277 struct DataType<stereo_wall_detection::DetectWall> {
00278 static const char* value()
00279 {
00280 return "stereo_wall_detection/DetectWall";
00281 }
00282
00283 static const char* value(const stereo_wall_detection::DetectWall&) { return value(); }
00284 };
00285
00286 template<class ContainerAllocator>
00287 struct MD5Sum<stereo_wall_detection::DetectWallRequest_<ContainerAllocator> > {
00288 static const char* value()
00289 {
00290 return "a6870b3c0e483b78cb98aac96d566717";
00291 }
00292
00293 static const char* value(const stereo_wall_detection::DetectWallRequest_<ContainerAllocator> &) { return value(); }
00294 };
00295
00296 template<class ContainerAllocator>
00297 struct DataType<stereo_wall_detection::DetectWallRequest_<ContainerAllocator> > {
00298 static const char* value()
00299 {
00300 return "stereo_wall_detection/DetectWall";
00301 }
00302
00303 static const char* value(const stereo_wall_detection::DetectWallRequest_<ContainerAllocator> &) { return value(); }
00304 };
00305
00306 template<class ContainerAllocator>
00307 struct MD5Sum<stereo_wall_detection::DetectWallResponse_<ContainerAllocator> > {
00308 static const char* value()
00309 {
00310 return "a6870b3c0e483b78cb98aac96d566717";
00311 }
00312
00313 static const char* value(const stereo_wall_detection::DetectWallResponse_<ContainerAllocator> &) { return value(); }
00314 };
00315
00316 template<class ContainerAllocator>
00317 struct DataType<stereo_wall_detection::DetectWallResponse_<ContainerAllocator> > {
00318 static const char* value()
00319 {
00320 return "stereo_wall_detection/DetectWall";
00321 }
00322
00323 static const char* value(const stereo_wall_detection::DetectWallResponse_<ContainerAllocator> &) { return value(); }
00324 };
00325
00326 }
00327 }
00328
00329 #endif // STEREO_WALL_DETECTION_SERVICE_DETECTWALL_H
00330