$search
00001 /* Auto-generated by genmsg_cpp for file /home/rosbuild/hudson/workspace/doc-electric-arm_navigation_experimental/doc_stacks/2013-03-01_14-08-43.137802/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 private: 00052 static const char* __s_getDataType_() { return "collider/OccupancyBBXSizeQueryRequest"; } 00053 public: 00054 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); } 00055 00056 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); } 00057 00058 private: 00059 static const char* __s_getMD5Sum_() { return "17746d0996c54d9b8b0dfe6f3cd0b588"; } 00060 public: 00061 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); } 00062 00063 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); } 00064 00065 private: 00066 static const char* __s_getServerMD5Sum_() { return "80a34f6e7e97fad3d6204d238d32527b"; } 00067 public: 00068 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); } 00069 00070 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); } 00071 00072 private: 00073 static const char* __s_getMessageDefinition_() { return "\n\ 00074 geometry_msgs/Point center\n\ 00075 \n\ 00076 geometry_msgs/Point size\n\ 00077 \n\ 00078 ================================================================================\n\ 00079 MSG: geometry_msgs/Point\n\ 00080 # This contains the position of a point in free space\n\ 00081 float64 x\n\ 00082 float64 y\n\ 00083 float64 z\n\ 00084 \n\ 00085 "; } 00086 public: 00087 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); } 00088 00089 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); } 00090 00091 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const 00092 { 00093 ros::serialization::OStream stream(write_ptr, 1000000000); 00094 ros::serialization::serialize(stream, center); 00095 ros::serialization::serialize(stream, size); 00096 return stream.getData(); 00097 } 00098 00099 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr) 00100 { 00101 ros::serialization::IStream stream(read_ptr, 1000000000); 00102 ros::serialization::deserialize(stream, center); 00103 ros::serialization::deserialize(stream, size); 00104 return stream.getData(); 00105 } 00106 00107 ROS_DEPRECATED virtual uint32_t serializationLength() const 00108 { 00109 uint32_t size = 0; 00110 size += ros::serialization::serializationLength(center); 00111 size += ros::serialization::serializationLength(size); 00112 return size; 00113 } 00114 00115 typedef boost::shared_ptr< ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> > Ptr; 00116 typedef boost::shared_ptr< ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> const> ConstPtr; 00117 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00118 }; // struct OccupancyBBXSizeQueryRequest 00119 typedef ::collider::OccupancyBBXSizeQueryRequest_<std::allocator<void> > OccupancyBBXSizeQueryRequest; 00120 00121 typedef boost::shared_ptr< ::collider::OccupancyBBXSizeQueryRequest> OccupancyBBXSizeQueryRequestPtr; 00122 typedef boost::shared_ptr< ::collider::OccupancyBBXSizeQueryRequest const> OccupancyBBXSizeQueryRequestConstPtr; 00123 00124 00125 template <class ContainerAllocator> 00126 struct OccupancyBBXSizeQueryResponse_ { 00127 typedef OccupancyBBXSizeQueryResponse_<ContainerAllocator> Type; 00128 00129 OccupancyBBXSizeQueryResponse_() 00130 : occupied() 00131 , free() 00132 , resolution(0.0) 00133 { 00134 } 00135 00136 OccupancyBBXSizeQueryResponse_(const ContainerAllocator& _alloc) 00137 : occupied(_alloc) 00138 , free(_alloc) 00139 , resolution(0.0) 00140 { 00141 } 00142 00143 typedef std::vector< ::geometry_msgs::Point_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Point_<ContainerAllocator> >::other > _occupied_type; 00144 std::vector< ::geometry_msgs::Point_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Point_<ContainerAllocator> >::other > occupied; 00145 00146 typedef std::vector< ::geometry_msgs::Point_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Point_<ContainerAllocator> >::other > _free_type; 00147 std::vector< ::geometry_msgs::Point_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Point_<ContainerAllocator> >::other > free; 00148 00149 typedef double _resolution_type; 00150 double resolution; 00151 00152 00153 ROS_DEPRECATED uint32_t get_occupied_size() const { return (uint32_t)occupied.size(); } 00154 ROS_DEPRECATED void set_occupied_size(uint32_t size) { occupied.resize((size_t)size); } 00155 ROS_DEPRECATED void get_occupied_vec(std::vector< ::geometry_msgs::Point_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Point_<ContainerAllocator> >::other > & vec) const { vec = this->occupied; } 00156 ROS_DEPRECATED void set_occupied_vec(const std::vector< ::geometry_msgs::Point_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Point_<ContainerAllocator> >::other > & vec) { this->occupied = vec; } 00157 ROS_DEPRECATED uint32_t get_free_size() const { return (uint32_t)free.size(); } 00158 ROS_DEPRECATED void set_free_size(uint32_t size) { free.resize((size_t)size); } 00159 ROS_DEPRECATED void get_free_vec(std::vector< ::geometry_msgs::Point_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Point_<ContainerAllocator> >::other > & vec) const { vec = this->free; } 00160 ROS_DEPRECATED void set_free_vec(const std::vector< ::geometry_msgs::Point_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Point_<ContainerAllocator> >::other > & vec) { this->free = vec; } 00161 private: 00162 static const char* __s_getDataType_() { return "collider/OccupancyBBXSizeQueryResponse"; } 00163 public: 00164 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); } 00165 00166 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); } 00167 00168 private: 00169 static const char* __s_getMD5Sum_() { return "32bc6e43503cdc225deabb9cd6ec4d0b"; } 00170 public: 00171 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); } 00172 00173 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); } 00174 00175 private: 00176 static const char* __s_getServerMD5Sum_() { return "80a34f6e7e97fad3d6204d238d32527b"; } 00177 public: 00178 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); } 00179 00180 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); } 00181 00182 private: 00183 static const char* __s_getMessageDefinition_() { return "\n\ 00184 geometry_msgs/Point[] occupied\n\ 00185 \n\ 00186 \n\ 00187 geometry_msgs/Point[] free\n\ 00188 \n\ 00189 \n\ 00190 float64 resolution\n\ 00191 \n\ 00192 \n\ 00193 ================================================================================\n\ 00194 MSG: geometry_msgs/Point\n\ 00195 # This contains the position of a point in free space\n\ 00196 float64 x\n\ 00197 float64 y\n\ 00198 float64 z\n\ 00199 \n\ 00200 "; } 00201 public: 00202 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); } 00203 00204 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); } 00205 00206 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const 00207 { 00208 ros::serialization::OStream stream(write_ptr, 1000000000); 00209 ros::serialization::serialize(stream, occupied); 00210 ros::serialization::serialize(stream, free); 00211 ros::serialization::serialize(stream, resolution); 00212 return stream.getData(); 00213 } 00214 00215 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr) 00216 { 00217 ros::serialization::IStream stream(read_ptr, 1000000000); 00218 ros::serialization::deserialize(stream, occupied); 00219 ros::serialization::deserialize(stream, free); 00220 ros::serialization::deserialize(stream, resolution); 00221 return stream.getData(); 00222 } 00223 00224 ROS_DEPRECATED virtual uint32_t serializationLength() const 00225 { 00226 uint32_t size = 0; 00227 size += ros::serialization::serializationLength(occupied); 00228 size += ros::serialization::serializationLength(free); 00229 size += ros::serialization::serializationLength(resolution); 00230 return size; 00231 } 00232 00233 typedef boost::shared_ptr< ::collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> > Ptr; 00234 typedef boost::shared_ptr< ::collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> const> ConstPtr; 00235 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00236 }; // struct OccupancyBBXSizeQueryResponse 00237 typedef ::collider::OccupancyBBXSizeQueryResponse_<std::allocator<void> > OccupancyBBXSizeQueryResponse; 00238 00239 typedef boost::shared_ptr< ::collider::OccupancyBBXSizeQueryResponse> OccupancyBBXSizeQueryResponsePtr; 00240 typedef boost::shared_ptr< ::collider::OccupancyBBXSizeQueryResponse const> OccupancyBBXSizeQueryResponseConstPtr; 00241 00242 struct OccupancyBBXSizeQuery 00243 { 00244 00245 typedef OccupancyBBXSizeQueryRequest Request; 00246 typedef OccupancyBBXSizeQueryResponse Response; 00247 Request request; 00248 Response response; 00249 00250 typedef Request RequestType; 00251 typedef Response ResponseType; 00252 }; // struct OccupancyBBXSizeQuery 00253 } // namespace collider 00254 00255 namespace ros 00256 { 00257 namespace message_traits 00258 { 00259 template<class ContainerAllocator> struct IsMessage< ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> > : public TrueType {}; 00260 template<class ContainerAllocator> struct IsMessage< ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> const> : public TrueType {}; 00261 template<class ContainerAllocator> 00262 struct MD5Sum< ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> > { 00263 static const char* value() 00264 { 00265 return "17746d0996c54d9b8b0dfe6f3cd0b588"; 00266 } 00267 00268 static const char* value(const ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> &) { return value(); } 00269 static const uint64_t static_value1 = 0x17746d0996c54d9bULL; 00270 static const uint64_t static_value2 = 0x8b0dfe6f3cd0b588ULL; 00271 }; 00272 00273 template<class ContainerAllocator> 00274 struct DataType< ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> > { 00275 static const char* value() 00276 { 00277 return "collider/OccupancyBBXSizeQueryRequest"; 00278 } 00279 00280 static const char* value(const ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> &) { return value(); } 00281 }; 00282 00283 template<class ContainerAllocator> 00284 struct Definition< ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> > { 00285 static const char* value() 00286 { 00287 return "\n\ 00288 geometry_msgs/Point center\n\ 00289 \n\ 00290 geometry_msgs/Point size\n\ 00291 \n\ 00292 ================================================================================\n\ 00293 MSG: geometry_msgs/Point\n\ 00294 # This contains the position of a point in free space\n\ 00295 float64 x\n\ 00296 float64 y\n\ 00297 float64 z\n\ 00298 \n\ 00299 "; 00300 } 00301 00302 static const char* value(const ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> &) { return value(); } 00303 }; 00304 00305 template<class ContainerAllocator> struct IsFixedSize< ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> > : public TrueType {}; 00306 } // namespace message_traits 00307 } // namespace ros 00308 00309 00310 namespace ros 00311 { 00312 namespace message_traits 00313 { 00314 template<class ContainerAllocator> struct IsMessage< ::collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> > : public TrueType {}; 00315 template<class ContainerAllocator> struct IsMessage< ::collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> const> : public TrueType {}; 00316 template<class ContainerAllocator> 00317 struct MD5Sum< ::collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> > { 00318 static const char* value() 00319 { 00320 return "32bc6e43503cdc225deabb9cd6ec4d0b"; 00321 } 00322 00323 static const char* value(const ::collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> &) { return value(); } 00324 static const uint64_t static_value1 = 0x32bc6e43503cdc22ULL; 00325 static const uint64_t static_value2 = 0x5deabb9cd6ec4d0bULL; 00326 }; 00327 00328 template<class ContainerAllocator> 00329 struct DataType< ::collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> > { 00330 static const char* value() 00331 { 00332 return "collider/OccupancyBBXSizeQueryResponse"; 00333 } 00334 00335 static const char* value(const ::collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> &) { return value(); } 00336 }; 00337 00338 template<class ContainerAllocator> 00339 struct Definition< ::collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> > { 00340 static const char* value() 00341 { 00342 return "\n\ 00343 geometry_msgs/Point[] occupied\n\ 00344 \n\ 00345 \n\ 00346 geometry_msgs/Point[] free\n\ 00347 \n\ 00348 \n\ 00349 float64 resolution\n\ 00350 \n\ 00351 \n\ 00352 ================================================================================\n\ 00353 MSG: geometry_msgs/Point\n\ 00354 # This contains the position of a point in free space\n\ 00355 float64 x\n\ 00356 float64 y\n\ 00357 float64 z\n\ 00358 \n\ 00359 "; 00360 } 00361 00362 static const char* value(const ::collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> &) { return value(); } 00363 }; 00364 00365 } // namespace message_traits 00366 } // namespace ros 00367 00368 namespace ros 00369 { 00370 namespace serialization 00371 { 00372 00373 template<class ContainerAllocator> struct Serializer< ::collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> > 00374 { 00375 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00376 { 00377 stream.next(m.center); 00378 stream.next(m.size); 00379 } 00380 00381 ROS_DECLARE_ALLINONE_SERIALIZER; 00382 }; // struct OccupancyBBXSizeQueryRequest_ 00383 } // namespace serialization 00384 } // namespace ros 00385 00386 00387 namespace ros 00388 { 00389 namespace serialization 00390 { 00391 00392 template<class ContainerAllocator> struct Serializer< ::collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> > 00393 { 00394 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00395 { 00396 stream.next(m.occupied); 00397 stream.next(m.free); 00398 stream.next(m.resolution); 00399 } 00400 00401 ROS_DECLARE_ALLINONE_SERIALIZER; 00402 }; // struct OccupancyBBXSizeQueryResponse_ 00403 } // namespace serialization 00404 } // namespace ros 00405 00406 namespace ros 00407 { 00408 namespace service_traits 00409 { 00410 template<> 00411 struct MD5Sum<collider::OccupancyBBXSizeQuery> { 00412 static const char* value() 00413 { 00414 return "80a34f6e7e97fad3d6204d238d32527b"; 00415 } 00416 00417 static const char* value(const collider::OccupancyBBXSizeQuery&) { return value(); } 00418 }; 00419 00420 template<> 00421 struct DataType<collider::OccupancyBBXSizeQuery> { 00422 static const char* value() 00423 { 00424 return "collider/OccupancyBBXSizeQuery"; 00425 } 00426 00427 static const char* value(const collider::OccupancyBBXSizeQuery&) { return value(); } 00428 }; 00429 00430 template<class ContainerAllocator> 00431 struct MD5Sum<collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> > { 00432 static const char* value() 00433 { 00434 return "80a34f6e7e97fad3d6204d238d32527b"; 00435 } 00436 00437 static const char* value(const collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> &) { return value(); } 00438 }; 00439 00440 template<class ContainerAllocator> 00441 struct DataType<collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> > { 00442 static const char* value() 00443 { 00444 return "collider/OccupancyBBXSizeQuery"; 00445 } 00446 00447 static const char* value(const collider::OccupancyBBXSizeQueryRequest_<ContainerAllocator> &) { return value(); } 00448 }; 00449 00450 template<class ContainerAllocator> 00451 struct MD5Sum<collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> > { 00452 static const char* value() 00453 { 00454 return "80a34f6e7e97fad3d6204d238d32527b"; 00455 } 00456 00457 static const char* value(const collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> &) { return value(); } 00458 }; 00459 00460 template<class ContainerAllocator> 00461 struct DataType<collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> > { 00462 static const char* value() 00463 { 00464 return "collider/OccupancyBBXSizeQuery"; 00465 } 00466 00467 static const char* value(const collider::OccupancyBBXSizeQueryResponse_<ContainerAllocator> &) { return value(); } 00468 }; 00469 00470 } // namespace service_traits 00471 } // namespace ros 00472 00473 #endif // COLLIDER_SERVICE_OCCUPANCYBBXSIZEQUERY_H 00474