$search
00001 /* Auto-generated by genmsg_cpp for file /home/rosbuild/hudson/workspace/doc-electric-cob_driver/doc_stacks/2013-03-01_14-39-27.991733/cob_driver/cob_footprint_observer/srv/GetFootprint.srv */ 00002 #ifndef COB_FOOTPRINT_OBSERVER_SERVICE_GETFOOTPRINT_H 00003 #define COB_FOOTPRINT_OBSERVER_SERVICE_GETFOOTPRINT_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/PolygonStamped.h" 00022 #include "std_msgs/Bool.h" 00023 00024 namespace cob_footprint_observer 00025 { 00026 template <class ContainerAllocator> 00027 struct GetFootprintRequest_ { 00028 typedef GetFootprintRequest_<ContainerAllocator> Type; 00029 00030 GetFootprintRequest_() 00031 { 00032 } 00033 00034 GetFootprintRequest_(const ContainerAllocator& _alloc) 00035 { 00036 } 00037 00038 00039 private: 00040 static const char* __s_getDataType_() { return "cob_footprint_observer/GetFootprintRequest"; } 00041 public: 00042 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); } 00043 00044 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); } 00045 00046 private: 00047 static const char* __s_getMD5Sum_() { return "d41d8cd98f00b204e9800998ecf8427e"; } 00048 public: 00049 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); } 00050 00051 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); } 00052 00053 private: 00054 static const char* __s_getServerMD5Sum_() { return "f40d48f5ad16c4c6dbedafd967306675"; } 00055 public: 00056 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); } 00057 00058 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); } 00059 00060 private: 00061 static const char* __s_getMessageDefinition_() { return "\n\ 00062 "; } 00063 public: 00064 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); } 00065 00066 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); } 00067 00068 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const 00069 { 00070 ros::serialization::OStream stream(write_ptr, 1000000000); 00071 return stream.getData(); 00072 } 00073 00074 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr) 00075 { 00076 ros::serialization::IStream stream(read_ptr, 1000000000); 00077 return stream.getData(); 00078 } 00079 00080 ROS_DEPRECATED virtual uint32_t serializationLength() const 00081 { 00082 uint32_t size = 0; 00083 return size; 00084 } 00085 00086 typedef boost::shared_ptr< ::cob_footprint_observer::GetFootprintRequest_<ContainerAllocator> > Ptr; 00087 typedef boost::shared_ptr< ::cob_footprint_observer::GetFootprintRequest_<ContainerAllocator> const> ConstPtr; 00088 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00089 }; // struct GetFootprintRequest 00090 typedef ::cob_footprint_observer::GetFootprintRequest_<std::allocator<void> > GetFootprintRequest; 00091 00092 typedef boost::shared_ptr< ::cob_footprint_observer::GetFootprintRequest> GetFootprintRequestPtr; 00093 typedef boost::shared_ptr< ::cob_footprint_observer::GetFootprintRequest const> GetFootprintRequestConstPtr; 00094 00095 00096 template <class ContainerAllocator> 00097 struct GetFootprintResponse_ { 00098 typedef GetFootprintResponse_<ContainerAllocator> Type; 00099 00100 GetFootprintResponse_() 00101 : footprint() 00102 , success() 00103 { 00104 } 00105 00106 GetFootprintResponse_(const ContainerAllocator& _alloc) 00107 : footprint(_alloc) 00108 , success(_alloc) 00109 { 00110 } 00111 00112 typedef ::geometry_msgs::PolygonStamped_<ContainerAllocator> _footprint_type; 00113 ::geometry_msgs::PolygonStamped_<ContainerAllocator> footprint; 00114 00115 typedef ::std_msgs::Bool_<ContainerAllocator> _success_type; 00116 ::std_msgs::Bool_<ContainerAllocator> success; 00117 00118 00119 private: 00120 static const char* __s_getDataType_() { return "cob_footprint_observer/GetFootprintResponse"; } 00121 public: 00122 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); } 00123 00124 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); } 00125 00126 private: 00127 static const char* __s_getMD5Sum_() { return "f40d48f5ad16c4c6dbedafd967306675"; } 00128 public: 00129 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); } 00130 00131 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); } 00132 00133 private: 00134 static const char* __s_getServerMD5Sum_() { return "f40d48f5ad16c4c6dbedafd967306675"; } 00135 public: 00136 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); } 00137 00138 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); } 00139 00140 private: 00141 static const char* __s_getMessageDefinition_() { return "geometry_msgs/PolygonStamped footprint\n\ 00142 std_msgs/Bool success\n\ 00143 \n\ 00144 \n\ 00145 ================================================================================\n\ 00146 MSG: geometry_msgs/PolygonStamped\n\ 00147 # This represents a Polygon with reference coordinate frame and timestamp\n\ 00148 Header header\n\ 00149 Polygon polygon\n\ 00150 \n\ 00151 ================================================================================\n\ 00152 MSG: std_msgs/Header\n\ 00153 # Standard metadata for higher-level stamped data types.\n\ 00154 # This is generally used to communicate timestamped data \n\ 00155 # in a particular coordinate frame.\n\ 00156 # \n\ 00157 # sequence ID: consecutively increasing ID \n\ 00158 uint32 seq\n\ 00159 #Two-integer timestamp that is expressed as:\n\ 00160 # * stamp.secs: seconds (stamp_secs) since epoch\n\ 00161 # * stamp.nsecs: nanoseconds since stamp_secs\n\ 00162 # time-handling sugar is provided by the client library\n\ 00163 time stamp\n\ 00164 #Frame this data is associated with\n\ 00165 # 0: no frame\n\ 00166 # 1: global frame\n\ 00167 string frame_id\n\ 00168 \n\ 00169 ================================================================================\n\ 00170 MSG: geometry_msgs/Polygon\n\ 00171 #A specification of a polygon where the first and last points are assumed to be connected\n\ 00172 geometry_msgs/Point32[] points\n\ 00173 \n\ 00174 ================================================================================\n\ 00175 MSG: geometry_msgs/Point32\n\ 00176 # This contains the position of a point in free space(with 32 bits of precision).\n\ 00177 # It is recommeded to use Point wherever possible instead of Point32. \n\ 00178 # \n\ 00179 # This recommendation is to promote interoperability. \n\ 00180 #\n\ 00181 # This message is designed to take up less space when sending\n\ 00182 # lots of points at once, as in the case of a PointCloud. \n\ 00183 \n\ 00184 float32 x\n\ 00185 float32 y\n\ 00186 float32 z\n\ 00187 ================================================================================\n\ 00188 MSG: std_msgs/Bool\n\ 00189 bool data\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, footprint); 00200 ros::serialization::serialize(stream, success); 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, footprint); 00208 ros::serialization::deserialize(stream, success); 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(footprint); 00216 size += ros::serialization::serializationLength(success); 00217 return size; 00218 } 00219 00220 typedef boost::shared_ptr< ::cob_footprint_observer::GetFootprintResponse_<ContainerAllocator> > Ptr; 00221 typedef boost::shared_ptr< ::cob_footprint_observer::GetFootprintResponse_<ContainerAllocator> const> ConstPtr; 00222 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00223 }; // struct GetFootprintResponse 00224 typedef ::cob_footprint_observer::GetFootprintResponse_<std::allocator<void> > GetFootprintResponse; 00225 00226 typedef boost::shared_ptr< ::cob_footprint_observer::GetFootprintResponse> GetFootprintResponsePtr; 00227 typedef boost::shared_ptr< ::cob_footprint_observer::GetFootprintResponse const> GetFootprintResponseConstPtr; 00228 00229 struct GetFootprint 00230 { 00231 00232 typedef GetFootprintRequest Request; 00233 typedef GetFootprintResponse Response; 00234 Request request; 00235 Response response; 00236 00237 typedef Request RequestType; 00238 typedef Response ResponseType; 00239 }; // struct GetFootprint 00240 } // namespace cob_footprint_observer 00241 00242 namespace ros 00243 { 00244 namespace message_traits 00245 { 00246 template<class ContainerAllocator> struct IsMessage< ::cob_footprint_observer::GetFootprintRequest_<ContainerAllocator> > : public TrueType {}; 00247 template<class ContainerAllocator> struct IsMessage< ::cob_footprint_observer::GetFootprintRequest_<ContainerAllocator> const> : public TrueType {}; 00248 template<class ContainerAllocator> 00249 struct MD5Sum< ::cob_footprint_observer::GetFootprintRequest_<ContainerAllocator> > { 00250 static const char* value() 00251 { 00252 return "d41d8cd98f00b204e9800998ecf8427e"; 00253 } 00254 00255 static const char* value(const ::cob_footprint_observer::GetFootprintRequest_<ContainerAllocator> &) { return value(); } 00256 static const uint64_t static_value1 = 0xd41d8cd98f00b204ULL; 00257 static const uint64_t static_value2 = 0xe9800998ecf8427eULL; 00258 }; 00259 00260 template<class ContainerAllocator> 00261 struct DataType< ::cob_footprint_observer::GetFootprintRequest_<ContainerAllocator> > { 00262 static const char* value() 00263 { 00264 return "cob_footprint_observer/GetFootprintRequest"; 00265 } 00266 00267 static const char* value(const ::cob_footprint_observer::GetFootprintRequest_<ContainerAllocator> &) { return value(); } 00268 }; 00269 00270 template<class ContainerAllocator> 00271 struct Definition< ::cob_footprint_observer::GetFootprintRequest_<ContainerAllocator> > { 00272 static const char* value() 00273 { 00274 return "\n\ 00275 "; 00276 } 00277 00278 static const char* value(const ::cob_footprint_observer::GetFootprintRequest_<ContainerAllocator> &) { return value(); } 00279 }; 00280 00281 template<class ContainerAllocator> struct IsFixedSize< ::cob_footprint_observer::GetFootprintRequest_<ContainerAllocator> > : public TrueType {}; 00282 } // namespace message_traits 00283 } // namespace ros 00284 00285 00286 namespace ros 00287 { 00288 namespace message_traits 00289 { 00290 template<class ContainerAllocator> struct IsMessage< ::cob_footprint_observer::GetFootprintResponse_<ContainerAllocator> > : public TrueType {}; 00291 template<class ContainerAllocator> struct IsMessage< ::cob_footprint_observer::GetFootprintResponse_<ContainerAllocator> const> : public TrueType {}; 00292 template<class ContainerAllocator> 00293 struct MD5Sum< ::cob_footprint_observer::GetFootprintResponse_<ContainerAllocator> > { 00294 static const char* value() 00295 { 00296 return "f40d48f5ad16c4c6dbedafd967306675"; 00297 } 00298 00299 static const char* value(const ::cob_footprint_observer::GetFootprintResponse_<ContainerAllocator> &) { return value(); } 00300 static const uint64_t static_value1 = 0xf40d48f5ad16c4c6ULL; 00301 static const uint64_t static_value2 = 0xdbedafd967306675ULL; 00302 }; 00303 00304 template<class ContainerAllocator> 00305 struct DataType< ::cob_footprint_observer::GetFootprintResponse_<ContainerAllocator> > { 00306 static const char* value() 00307 { 00308 return "cob_footprint_observer/GetFootprintResponse"; 00309 } 00310 00311 static const char* value(const ::cob_footprint_observer::GetFootprintResponse_<ContainerAllocator> &) { return value(); } 00312 }; 00313 00314 template<class ContainerAllocator> 00315 struct Definition< ::cob_footprint_observer::GetFootprintResponse_<ContainerAllocator> > { 00316 static const char* value() 00317 { 00318 return "geometry_msgs/PolygonStamped footprint\n\ 00319 std_msgs/Bool success\n\ 00320 \n\ 00321 \n\ 00322 ================================================================================\n\ 00323 MSG: geometry_msgs/PolygonStamped\n\ 00324 # This represents a Polygon with reference coordinate frame and timestamp\n\ 00325 Header header\n\ 00326 Polygon polygon\n\ 00327 \n\ 00328 ================================================================================\n\ 00329 MSG: std_msgs/Header\n\ 00330 # Standard metadata for higher-level stamped data types.\n\ 00331 # This is generally used to communicate timestamped data \n\ 00332 # in a particular coordinate frame.\n\ 00333 # \n\ 00334 # sequence ID: consecutively increasing ID \n\ 00335 uint32 seq\n\ 00336 #Two-integer timestamp that is expressed as:\n\ 00337 # * stamp.secs: seconds (stamp_secs) since epoch\n\ 00338 # * stamp.nsecs: nanoseconds since stamp_secs\n\ 00339 # time-handling sugar is provided by the client library\n\ 00340 time stamp\n\ 00341 #Frame this data is associated with\n\ 00342 # 0: no frame\n\ 00343 # 1: global frame\n\ 00344 string frame_id\n\ 00345 \n\ 00346 ================================================================================\n\ 00347 MSG: geometry_msgs/Polygon\n\ 00348 #A specification of a polygon where the first and last points are assumed to be connected\n\ 00349 geometry_msgs/Point32[] points\n\ 00350 \n\ 00351 ================================================================================\n\ 00352 MSG: geometry_msgs/Point32\n\ 00353 # This contains the position of a point in free space(with 32 bits of precision).\n\ 00354 # It is recommeded to use Point wherever possible instead of Point32. \n\ 00355 # \n\ 00356 # This recommendation is to promote interoperability. \n\ 00357 #\n\ 00358 # This message is designed to take up less space when sending\n\ 00359 # lots of points at once, as in the case of a PointCloud. \n\ 00360 \n\ 00361 float32 x\n\ 00362 float32 y\n\ 00363 float32 z\n\ 00364 ================================================================================\n\ 00365 MSG: std_msgs/Bool\n\ 00366 bool data\n\ 00367 "; 00368 } 00369 00370 static const char* value(const ::cob_footprint_observer::GetFootprintResponse_<ContainerAllocator> &) { return value(); } 00371 }; 00372 00373 } // namespace message_traits 00374 } // namespace ros 00375 00376 namespace ros 00377 { 00378 namespace serialization 00379 { 00380 00381 template<class ContainerAllocator> struct Serializer< ::cob_footprint_observer::GetFootprintRequest_<ContainerAllocator> > 00382 { 00383 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00384 { 00385 } 00386 00387 ROS_DECLARE_ALLINONE_SERIALIZER; 00388 }; // struct GetFootprintRequest_ 00389 } // namespace serialization 00390 } // namespace ros 00391 00392 00393 namespace ros 00394 { 00395 namespace serialization 00396 { 00397 00398 template<class ContainerAllocator> struct Serializer< ::cob_footprint_observer::GetFootprintResponse_<ContainerAllocator> > 00399 { 00400 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00401 { 00402 stream.next(m.footprint); 00403 stream.next(m.success); 00404 } 00405 00406 ROS_DECLARE_ALLINONE_SERIALIZER; 00407 }; // struct GetFootprintResponse_ 00408 } // namespace serialization 00409 } // namespace ros 00410 00411 namespace ros 00412 { 00413 namespace service_traits 00414 { 00415 template<> 00416 struct MD5Sum<cob_footprint_observer::GetFootprint> { 00417 static const char* value() 00418 { 00419 return "f40d48f5ad16c4c6dbedafd967306675"; 00420 } 00421 00422 static const char* value(const cob_footprint_observer::GetFootprint&) { return value(); } 00423 }; 00424 00425 template<> 00426 struct DataType<cob_footprint_observer::GetFootprint> { 00427 static const char* value() 00428 { 00429 return "cob_footprint_observer/GetFootprint"; 00430 } 00431 00432 static const char* value(const cob_footprint_observer::GetFootprint&) { return value(); } 00433 }; 00434 00435 template<class ContainerAllocator> 00436 struct MD5Sum<cob_footprint_observer::GetFootprintRequest_<ContainerAllocator> > { 00437 static const char* value() 00438 { 00439 return "f40d48f5ad16c4c6dbedafd967306675"; 00440 } 00441 00442 static const char* value(const cob_footprint_observer::GetFootprintRequest_<ContainerAllocator> &) { return value(); } 00443 }; 00444 00445 template<class ContainerAllocator> 00446 struct DataType<cob_footprint_observer::GetFootprintRequest_<ContainerAllocator> > { 00447 static const char* value() 00448 { 00449 return "cob_footprint_observer/GetFootprint"; 00450 } 00451 00452 static const char* value(const cob_footprint_observer::GetFootprintRequest_<ContainerAllocator> &) { return value(); } 00453 }; 00454 00455 template<class ContainerAllocator> 00456 struct MD5Sum<cob_footprint_observer::GetFootprintResponse_<ContainerAllocator> > { 00457 static const char* value() 00458 { 00459 return "f40d48f5ad16c4c6dbedafd967306675"; 00460 } 00461 00462 static const char* value(const cob_footprint_observer::GetFootprintResponse_<ContainerAllocator> &) { return value(); } 00463 }; 00464 00465 template<class ContainerAllocator> 00466 struct DataType<cob_footprint_observer::GetFootprintResponse_<ContainerAllocator> > { 00467 static const char* value() 00468 { 00469 return "cob_footprint_observer/GetFootprint"; 00470 } 00471 00472 static const char* value(const cob_footprint_observer::GetFootprintResponse_<ContainerAllocator> &) { return value(); } 00473 }; 00474 00475 } // namespace service_traits 00476 } // namespace ros 00477 00478 #endif // COB_FOOTPRINT_OBSERVER_SERVICE_GETFOOTPRINT_H 00479