OccupancyBBXSizeQuery.h
Go to the documentation of this file.
00001 /* Auto-generated by genmsg_cpp for file /home/rosbuild/hudson/workspace/doc-fuerte-arm_navigation_experimental/doc_stacks/2013-12-12_11-03-06.264841/arm_navigation_experimental/collider/srv/OccupancyBBXSizeQuery.srv */
00002 #ifndef COLLIDER_SERVICE_OCCUPANCYBBXSIZEQUERY_H
00003 #define COLLIDER_SERVICE_OCCUPANCYBBXSIZEQUERY_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 #include "geometry_msgs/Point.h"
00020 #include "geometry_msgs/Point.h"
00021 
00022 
00023 #include "geometry_msgs/Point.h"
00024 #include "geometry_msgs/Point.h"
00025 
00026 namespace collider
00027 {
00028 template <class ContainerAllocator>
00029 struct OccupancyBBXSizeQueryRequest_ {
00030   typedef OccupancyBBXSizeQueryRequest_<ContainerAllocator> Type;
00031 
00032   OccupancyBBXSizeQueryRequest_()
00033   : center()
00034   , size()
00035   {
00036   }
00037 
00038   OccupancyBBXSizeQueryRequest_(const ContainerAllocator& _alloc)
00039   : center(_alloc)
00040   , size(_alloc)
00041   {
00042   }
00043 
00044   typedef  ::geometry_msgs::Point_<ContainerAllocator>  _center_type;
00045    ::geometry_msgs::Point_<ContainerAllocator>  center;
00046 
00047   typedef  ::geometry_msgs::Point_<ContainerAllocator>  _size_type;
00048    ::geometry_msgs::Point_<ContainerAllocator>  size;
00049 
00050 
00051   typedef boost::shared_ptr< ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> > Ptr;
00052   typedef boost::shared_ptr< ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator>  const> ConstPtr;
00053   boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00054 }; // struct OccupancyBBXSizeQueryRequest
00055 typedef  ::collider::OccupancyBBXSizeQueryRequest_<std::allocator<void> > OccupancyBBXSizeQueryRequest;
00056 
00057 typedef boost::shared_ptr< ::collider::OccupancyBBXSizeQueryRequest> OccupancyBBXSizeQueryRequestPtr;
00058 typedef boost::shared_ptr< ::collider::OccupancyBBXSizeQueryRequest const> OccupancyBBXSizeQueryRequestConstPtr;
00059 
00060 
00061 template <class ContainerAllocator>
00062 struct OccupancyBBXSizeQueryResponse_ {
00063   typedef OccupancyBBXSizeQueryResponse_<ContainerAllocator> Type;
00064 
00065   OccupancyBBXSizeQueryResponse_()
00066   : occupied()
00067   , free()
00068   , resolution(0.0)
00069   {
00070   }
00071 
00072   OccupancyBBXSizeQueryResponse_(const ContainerAllocator& _alloc)
00073   : occupied(_alloc)
00074   , free(_alloc)
00075   , resolution(0.0)
00076   {
00077   }
00078 
00079   typedef std::vector< ::geometry_msgs::Point_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Point_<ContainerAllocator> >::other >  _occupied_type;
00080   std::vector< ::geometry_msgs::Point_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Point_<ContainerAllocator> >::other >  occupied;
00081 
00082   typedef std::vector< ::geometry_msgs::Point_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Point_<ContainerAllocator> >::other >  _free_type;
00083   std::vector< ::geometry_msgs::Point_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Point_<ContainerAllocator> >::other >  free;
00084 
00085   typedef double _resolution_type;
00086   double resolution;
00087 
00088 
00089   typedef boost::shared_ptr< ::collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> > Ptr;
00090   typedef boost::shared_ptr< ::collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator>  const> ConstPtr;
00091   boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00092 }; // struct OccupancyBBXSizeQueryResponse
00093 typedef  ::collider::OccupancyBBXSizeQueryResponse_<std::allocator<void> > OccupancyBBXSizeQueryResponse;
00094 
00095 typedef boost::shared_ptr< ::collider::OccupancyBBXSizeQueryResponse> OccupancyBBXSizeQueryResponsePtr;
00096 typedef boost::shared_ptr< ::collider::OccupancyBBXSizeQueryResponse const> OccupancyBBXSizeQueryResponseConstPtr;
00097 
00098 struct OccupancyBBXSizeQuery
00099 {
00100 
00101 typedef OccupancyBBXSizeQueryRequest Request;
00102 typedef OccupancyBBXSizeQueryResponse Response;
00103 Request request;
00104 Response response;
00105 
00106 typedef Request RequestType;
00107 typedef Response ResponseType;
00108 }; // struct OccupancyBBXSizeQuery
00109 } // namespace collider
00110 
00111 namespace ros
00112 {
00113 namespace message_traits
00114 {
00115 template<class ContainerAllocator> struct IsMessage< ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> > : public TrueType {};
00116 template<class ContainerAllocator> struct IsMessage< ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator>  const> : public TrueType {};
00117 template<class ContainerAllocator>
00118 struct MD5Sum< ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> > {
00119   static const char* value() 
00120   {
00121     return "17746d0996c54d9b8b0dfe6f3cd0b588";
00122   }
00123 
00124   static const char* value(const  ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> &) { return value(); } 
00125   static const uint64_t static_value1 = 0x17746d0996c54d9bULL;
00126   static const uint64_t static_value2 = 0x8b0dfe6f3cd0b588ULL;
00127 };
00128 
00129 template<class ContainerAllocator>
00130 struct DataType< ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> > {
00131   static const char* value() 
00132   {
00133     return "collider/OccupancyBBXSizeQueryRequest";
00134   }
00135 
00136   static const char* value(const  ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> &) { return value(); } 
00137 };
00138 
00139 template<class ContainerAllocator>
00140 struct Definition< ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> > {
00141   static const char* value() 
00142   {
00143     return "\n\
00144 geometry_msgs/Point center\n\
00145 \n\
00146 geometry_msgs/Point size\n\
00147 \n\
00148 ================================================================================\n\
00149 MSG: geometry_msgs/Point\n\
00150 # This contains the position of a point in free space\n\
00151 float64 x\n\
00152 float64 y\n\
00153 float64 z\n\
00154 \n\
00155 ";
00156   }
00157 
00158   static const char* value(const  ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> &) { return value(); } 
00159 };
00160 
00161 template<class ContainerAllocator> struct IsFixedSize< ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> > : public TrueType {};
00162 } // namespace message_traits
00163 } // namespace ros
00164 
00165 
00166 namespace ros
00167 {
00168 namespace message_traits
00169 {
00170 template<class ContainerAllocator> struct IsMessage< ::collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> > : public TrueType {};
00171 template<class ContainerAllocator> struct IsMessage< ::collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator>  const> : public TrueType {};
00172 template<class ContainerAllocator>
00173 struct MD5Sum< ::collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> > {
00174   static const char* value() 
00175   {
00176     return "32bc6e43503cdc225deabb9cd6ec4d0b";
00177   }
00178 
00179   static const char* value(const  ::collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> &) { return value(); } 
00180   static const uint64_t static_value1 = 0x32bc6e43503cdc22ULL;
00181   static const uint64_t static_value2 = 0x5deabb9cd6ec4d0bULL;
00182 };
00183 
00184 template<class ContainerAllocator>
00185 struct DataType< ::collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> > {
00186   static const char* value() 
00187   {
00188     return "collider/OccupancyBBXSizeQueryResponse";
00189   }
00190 
00191   static const char* value(const  ::collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> &) { return value(); } 
00192 };
00193 
00194 template<class ContainerAllocator>
00195 struct Definition< ::collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> > {
00196   static const char* value() 
00197   {
00198     return "\n\
00199 geometry_msgs/Point[] occupied\n\
00200 \n\
00201 \n\
00202 geometry_msgs/Point[] free\n\
00203 \n\
00204 \n\
00205 float64 resolution\n\
00206 \n\
00207 \n\
00208 ================================================================================\n\
00209 MSG: geometry_msgs/Point\n\
00210 # This contains the position of a point in free space\n\
00211 float64 x\n\
00212 float64 y\n\
00213 float64 z\n\
00214 \n\
00215 ";
00216   }
00217 
00218   static const char* value(const  ::collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> &) { return value(); } 
00219 };
00220 
00221 } // namespace message_traits
00222 } // namespace ros
00223 
00224 namespace ros
00225 {
00226 namespace serialization
00227 {
00228 
00229 template<class ContainerAllocator> struct Serializer< ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> >
00230 {
00231   template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00232   {
00233     stream.next(m.center);
00234     stream.next(m.size);
00235   }
00236 
00237   ROS_DECLARE_ALLINONE_SERIALIZER;
00238 }; // struct OccupancyBBXSizeQueryRequest_
00239 } // namespace serialization
00240 } // namespace ros
00241 
00242 
00243 namespace ros
00244 {
00245 namespace serialization
00246 {
00247 
00248 template<class ContainerAllocator> struct Serializer< ::collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> >
00249 {
00250   template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00251   {
00252     stream.next(m.occupied);
00253     stream.next(m.free);
00254     stream.next(m.resolution);
00255   }
00256 
00257   ROS_DECLARE_ALLINONE_SERIALIZER;
00258 }; // struct OccupancyBBXSizeQueryResponse_
00259 } // namespace serialization
00260 } // namespace ros
00261 
00262 namespace ros
00263 {
00264 namespace service_traits
00265 {
00266 template<>
00267 struct MD5Sum<collider::OccupancyBBXSizeQuery> {
00268   static const char* value() 
00269   {
00270     return "80a34f6e7e97fad3d6204d238d32527b";
00271   }
00272 
00273   static const char* value(const collider::OccupancyBBXSizeQuery&) { return value(); } 
00274 };
00275 
00276 template<>
00277 struct DataType<collider::OccupancyBBXSizeQuery> {
00278   static const char* value() 
00279   {
00280     return "collider/OccupancyBBXSizeQuery";
00281   }
00282 
00283   static const char* value(const collider::OccupancyBBXSizeQuery&) { return value(); } 
00284 };
00285 
00286 template<class ContainerAllocator>
00287 struct MD5Sum<collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> > {
00288   static const char* value() 
00289   {
00290     return "80a34f6e7e97fad3d6204d238d32527b";
00291   }
00292 
00293   static const char* value(const collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> &) { return value(); } 
00294 };
00295 
00296 template<class ContainerAllocator>
00297 struct DataType<collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> > {
00298   static const char* value() 
00299   {
00300     return "collider/OccupancyBBXSizeQuery";
00301   }
00302 
00303   static const char* value(const collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> &) { return value(); } 
00304 };
00305 
00306 template<class ContainerAllocator>
00307 struct MD5Sum<collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> > {
00308   static const char* value() 
00309   {
00310     return "80a34f6e7e97fad3d6204d238d32527b";
00311   }
00312 
00313   static const char* value(const collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> &) { return value(); } 
00314 };
00315 
00316 template<class ContainerAllocator>
00317 struct DataType<collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> > {
00318   static const char* value() 
00319   {
00320     return "collider/OccupancyBBXSizeQuery";
00321   }
00322 
00323   static const char* value(const collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> &) { return value(); } 
00324 };
00325 
00326 } // namespace service_traits
00327 } // namespace ros
00328 
00329 #endif // COLLIDER_SERVICE_OCCUPANCYBBXSIZEQUERY_H
00330 


collider
Author(s): Adam Harmat, Gil E. Jones, Kai M. Wurm, Armin Hornung. Maintained by Gil E. Jones
autogenerated on Thu Dec 12 2013 11:07:38