$search
00001 /* Auto-generated by genmsg_cpp for file /home/rosbuild/hudson/workspace/doc-electric-srs_public/doc_stacks/2013-03-05_12-22-34.333426/srs_public/srs_symbolic_grounding/srv/SymbolGroundingDeliverBaseRegion.srv */ 00002 #ifndef SRS_SYMBOLIC_GROUNDING_SERVICE_SYMBOLGROUNDINGDELIVERBASEREGION_H 00003 #define SRS_SYMBOLIC_GROUNDING_SERVICE_SYMBOLGROUNDINGDELIVERBASEREGION_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 "srs_msgs/SRSSpatialInfo.h" 00020 #include "srs_msgs/SRSSpatialInfo.h" 00021 00022 00023 #include "geometry_msgs/Pose2D.h" 00024 00025 namespace srs_symbolic_grounding 00026 { 00027 template <class ContainerAllocator> 00028 struct SymbolGroundingDeliverBaseRegionRequest_ { 00029 typedef SymbolGroundingDeliverBaseRegionRequest_<ContainerAllocator> Type; 00030 00031 SymbolGroundingDeliverBaseRegionRequest_() 00032 : parent_obj_geometry() 00033 , furniture_geometry_list() 00034 { 00035 } 00036 00037 SymbolGroundingDeliverBaseRegionRequest_(const ContainerAllocator& _alloc) 00038 : parent_obj_geometry(_alloc) 00039 , furniture_geometry_list(_alloc) 00040 { 00041 } 00042 00043 typedef ::srs_msgs::SRSSpatialInfo_<ContainerAllocator> _parent_obj_geometry_type; 00044 ::srs_msgs::SRSSpatialInfo_<ContainerAllocator> parent_obj_geometry; 00045 00046 typedef std::vector< ::srs_msgs::SRSSpatialInfo_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::srs_msgs::SRSSpatialInfo_<ContainerAllocator> >::other > _furniture_geometry_list_type; 00047 std::vector< ::srs_msgs::SRSSpatialInfo_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::srs_msgs::SRSSpatialInfo_<ContainerAllocator> >::other > furniture_geometry_list; 00048 00049 00050 ROS_DEPRECATED uint32_t get_furniture_geometry_list_size() const { return (uint32_t)furniture_geometry_list.size(); } 00051 ROS_DEPRECATED void set_furniture_geometry_list_size(uint32_t size) { furniture_geometry_list.resize((size_t)size); } 00052 ROS_DEPRECATED void get_furniture_geometry_list_vec(std::vector< ::srs_msgs::SRSSpatialInfo_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::srs_msgs::SRSSpatialInfo_<ContainerAllocator> >::other > & vec) const { vec = this->furniture_geometry_list; } 00053 ROS_DEPRECATED void set_furniture_geometry_list_vec(const std::vector< ::srs_msgs::SRSSpatialInfo_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::srs_msgs::SRSSpatialInfo_<ContainerAllocator> >::other > & vec) { this->furniture_geometry_list = vec; } 00054 private: 00055 static const char* __s_getDataType_() { return "srs_symbolic_grounding/SymbolGroundingDeliverBaseRegionRequest"; } 00056 public: 00057 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); } 00058 00059 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); } 00060 00061 private: 00062 static const char* __s_getMD5Sum_() { return "23cc208c15dce6f450656fc4c209b68c"; } 00063 public: 00064 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); } 00065 00066 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); } 00067 00068 private: 00069 static const char* __s_getServerMD5Sum_() { return "1414d0f804748752b8fb6a7b28c03566"; } 00070 public: 00071 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); } 00072 00073 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); } 00074 00075 private: 00076 static const char* __s_getMessageDefinition_() { return "\n\ 00077 \n\ 00078 srs_msgs/SRSSpatialInfo parent_obj_geometry\n\ 00079 srs_msgs/SRSSpatialInfo[] furniture_geometry_list\n\ 00080 \n\ 00081 ================================================================================\n\ 00082 MSG: srs_msgs/SRSSpatialInfo\n\ 00083 # Point point\n\ 00084 # Orientation angles\n\ 00085 float32 l\n\ 00086 float32 w\n\ 00087 float32 h\n\ 00088 \n\ 00089 geometry_msgs/Pose pose\n\ 00090 \n\ 00091 ================================================================================\n\ 00092 MSG: geometry_msgs/Pose\n\ 00093 # A representation of pose in free space, composed of postion and orientation. \n\ 00094 Point position\n\ 00095 Quaternion orientation\n\ 00096 \n\ 00097 ================================================================================\n\ 00098 MSG: geometry_msgs/Point\n\ 00099 # This contains the position of a point in free space\n\ 00100 float64 x\n\ 00101 float64 y\n\ 00102 float64 z\n\ 00103 \n\ 00104 ================================================================================\n\ 00105 MSG: geometry_msgs/Quaternion\n\ 00106 # This represents an orientation in free space in quaternion form.\n\ 00107 \n\ 00108 float64 x\n\ 00109 float64 y\n\ 00110 float64 z\n\ 00111 float64 w\n\ 00112 \n\ 00113 "; } 00114 public: 00115 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); } 00116 00117 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); } 00118 00119 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const 00120 { 00121 ros::serialization::OStream stream(write_ptr, 1000000000); 00122 ros::serialization::serialize(stream, parent_obj_geometry); 00123 ros::serialization::serialize(stream, furniture_geometry_list); 00124 return stream.getData(); 00125 } 00126 00127 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr) 00128 { 00129 ros::serialization::IStream stream(read_ptr, 1000000000); 00130 ros::serialization::deserialize(stream, parent_obj_geometry); 00131 ros::serialization::deserialize(stream, furniture_geometry_list); 00132 return stream.getData(); 00133 } 00134 00135 ROS_DEPRECATED virtual uint32_t serializationLength() const 00136 { 00137 uint32_t size = 0; 00138 size += ros::serialization::serializationLength(parent_obj_geometry); 00139 size += ros::serialization::serializationLength(furniture_geometry_list); 00140 return size; 00141 } 00142 00143 typedef boost::shared_ptr< ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionRequest_<ContainerAllocator> > Ptr; 00144 typedef boost::shared_ptr< ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionRequest_<ContainerAllocator> const> ConstPtr; 00145 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00146 }; // struct SymbolGroundingDeliverBaseRegionRequest 00147 typedef ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionRequest_<std::allocator<void> > SymbolGroundingDeliverBaseRegionRequest; 00148 00149 typedef boost::shared_ptr< ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionRequest> SymbolGroundingDeliverBaseRegionRequestPtr; 00150 typedef boost::shared_ptr< ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionRequest const> SymbolGroundingDeliverBaseRegionRequestConstPtr; 00151 00152 00153 template <class ContainerAllocator> 00154 struct SymbolGroundingDeliverBaseRegionResponse_ { 00155 typedef SymbolGroundingDeliverBaseRegionResponse_<ContainerAllocator> Type; 00156 00157 SymbolGroundingDeliverBaseRegionResponse_() 00158 : deliver_base_pose() 00159 , R(0.0) 00160 { 00161 } 00162 00163 SymbolGroundingDeliverBaseRegionResponse_(const ContainerAllocator& _alloc) 00164 : deliver_base_pose(_alloc) 00165 , R(0.0) 00166 { 00167 } 00168 00169 typedef ::geometry_msgs::Pose2D_<ContainerAllocator> _deliver_base_pose_type; 00170 ::geometry_msgs::Pose2D_<ContainerAllocator> deliver_base_pose; 00171 00172 typedef float _R_type; 00173 float R; 00174 00175 00176 private: 00177 static const char* __s_getDataType_() { return "srs_symbolic_grounding/SymbolGroundingDeliverBaseRegionResponse"; } 00178 public: 00179 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); } 00180 00181 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); } 00182 00183 private: 00184 static const char* __s_getMD5Sum_() { return "35fceac223189b79e30fef6faae61e1e"; } 00185 public: 00186 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); } 00187 00188 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); } 00189 00190 private: 00191 static const char* __s_getServerMD5Sum_() { return "1414d0f804748752b8fb6a7b28c03566"; } 00192 public: 00193 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); } 00194 00195 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); } 00196 00197 private: 00198 static const char* __s_getMessageDefinition_() { return "geometry_msgs/Pose2D deliver_base_pose\n\ 00199 float32 R\n\ 00200 \n\ 00201 \n\ 00202 \n\ 00203 \n\ 00204 \n\ 00205 ================================================================================\n\ 00206 MSG: geometry_msgs/Pose2D\n\ 00207 # This expresses a position and orientation on a 2D manifold.\n\ 00208 \n\ 00209 float64 x\n\ 00210 float64 y\n\ 00211 float64 theta\n\ 00212 "; } 00213 public: 00214 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); } 00215 00216 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); } 00217 00218 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const 00219 { 00220 ros::serialization::OStream stream(write_ptr, 1000000000); 00221 ros::serialization::serialize(stream, deliver_base_pose); 00222 ros::serialization::serialize(stream, R); 00223 return stream.getData(); 00224 } 00225 00226 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr) 00227 { 00228 ros::serialization::IStream stream(read_ptr, 1000000000); 00229 ros::serialization::deserialize(stream, deliver_base_pose); 00230 ros::serialization::deserialize(stream, R); 00231 return stream.getData(); 00232 } 00233 00234 ROS_DEPRECATED virtual uint32_t serializationLength() const 00235 { 00236 uint32_t size = 0; 00237 size += ros::serialization::serializationLength(deliver_base_pose); 00238 size += ros::serialization::serializationLength(R); 00239 return size; 00240 } 00241 00242 typedef boost::shared_ptr< ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionResponse_<ContainerAllocator> > Ptr; 00243 typedef boost::shared_ptr< ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionResponse_<ContainerAllocator> const> ConstPtr; 00244 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00245 }; // struct SymbolGroundingDeliverBaseRegionResponse 00246 typedef ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionResponse_<std::allocator<void> > SymbolGroundingDeliverBaseRegionResponse; 00247 00248 typedef boost::shared_ptr< ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionResponse> SymbolGroundingDeliverBaseRegionResponsePtr; 00249 typedef boost::shared_ptr< ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionResponse const> SymbolGroundingDeliverBaseRegionResponseConstPtr; 00250 00251 struct SymbolGroundingDeliverBaseRegion 00252 { 00253 00254 typedef SymbolGroundingDeliverBaseRegionRequest Request; 00255 typedef SymbolGroundingDeliverBaseRegionResponse Response; 00256 Request request; 00257 Response response; 00258 00259 typedef Request RequestType; 00260 typedef Response ResponseType; 00261 }; // struct SymbolGroundingDeliverBaseRegion 00262 } // namespace srs_symbolic_grounding 00263 00264 namespace ros 00265 { 00266 namespace message_traits 00267 { 00268 template<class ContainerAllocator> struct IsMessage< ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionRequest_<ContainerAllocator> > : public TrueType {}; 00269 template<class ContainerAllocator> struct IsMessage< ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionRequest_<ContainerAllocator> const> : public TrueType {}; 00270 template<class ContainerAllocator> 00271 struct MD5Sum< ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionRequest_<ContainerAllocator> > { 00272 static const char* value() 00273 { 00274 return "23cc208c15dce6f450656fc4c209b68c"; 00275 } 00276 00277 static const char* value(const ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionRequest_<ContainerAllocator> &) { return value(); } 00278 static const uint64_t static_value1 = 0x23cc208c15dce6f4ULL; 00279 static const uint64_t static_value2 = 0x50656fc4c209b68cULL; 00280 }; 00281 00282 template<class ContainerAllocator> 00283 struct DataType< ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionRequest_<ContainerAllocator> > { 00284 static const char* value() 00285 { 00286 return "srs_symbolic_grounding/SymbolGroundingDeliverBaseRegionRequest"; 00287 } 00288 00289 static const char* value(const ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionRequest_<ContainerAllocator> &) { return value(); } 00290 }; 00291 00292 template<class ContainerAllocator> 00293 struct Definition< ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionRequest_<ContainerAllocator> > { 00294 static const char* value() 00295 { 00296 return "\n\ 00297 \n\ 00298 srs_msgs/SRSSpatialInfo parent_obj_geometry\n\ 00299 srs_msgs/SRSSpatialInfo[] furniture_geometry_list\n\ 00300 \n\ 00301 ================================================================================\n\ 00302 MSG: srs_msgs/SRSSpatialInfo\n\ 00303 # Point point\n\ 00304 # Orientation angles\n\ 00305 float32 l\n\ 00306 float32 w\n\ 00307 float32 h\n\ 00308 \n\ 00309 geometry_msgs/Pose pose\n\ 00310 \n\ 00311 ================================================================================\n\ 00312 MSG: geometry_msgs/Pose\n\ 00313 # A representation of pose in free space, composed of postion and orientation. \n\ 00314 Point position\n\ 00315 Quaternion orientation\n\ 00316 \n\ 00317 ================================================================================\n\ 00318 MSG: geometry_msgs/Point\n\ 00319 # This contains the position of a point in free space\n\ 00320 float64 x\n\ 00321 float64 y\n\ 00322 float64 z\n\ 00323 \n\ 00324 ================================================================================\n\ 00325 MSG: geometry_msgs/Quaternion\n\ 00326 # This represents an orientation in free space in quaternion form.\n\ 00327 \n\ 00328 float64 x\n\ 00329 float64 y\n\ 00330 float64 z\n\ 00331 float64 w\n\ 00332 \n\ 00333 "; 00334 } 00335 00336 static const char* value(const ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionRequest_<ContainerAllocator> &) { return value(); } 00337 }; 00338 00339 } // namespace message_traits 00340 } // namespace ros 00341 00342 00343 namespace ros 00344 { 00345 namespace message_traits 00346 { 00347 template<class ContainerAllocator> struct IsMessage< ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionResponse_<ContainerAllocator> > : public TrueType {}; 00348 template<class ContainerAllocator> struct IsMessage< ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionResponse_<ContainerAllocator> const> : public TrueType {}; 00349 template<class ContainerAllocator> 00350 struct MD5Sum< ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionResponse_<ContainerAllocator> > { 00351 static const char* value() 00352 { 00353 return "35fceac223189b79e30fef6faae61e1e"; 00354 } 00355 00356 static const char* value(const ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionResponse_<ContainerAllocator> &) { return value(); } 00357 static const uint64_t static_value1 = 0x35fceac223189b79ULL; 00358 static const uint64_t static_value2 = 0xe30fef6faae61e1eULL; 00359 }; 00360 00361 template<class ContainerAllocator> 00362 struct DataType< ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionResponse_<ContainerAllocator> > { 00363 static const char* value() 00364 { 00365 return "srs_symbolic_grounding/SymbolGroundingDeliverBaseRegionResponse"; 00366 } 00367 00368 static const char* value(const ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionResponse_<ContainerAllocator> &) { return value(); } 00369 }; 00370 00371 template<class ContainerAllocator> 00372 struct Definition< ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionResponse_<ContainerAllocator> > { 00373 static const char* value() 00374 { 00375 return "geometry_msgs/Pose2D deliver_base_pose\n\ 00376 float32 R\n\ 00377 \n\ 00378 \n\ 00379 \n\ 00380 \n\ 00381 \n\ 00382 ================================================================================\n\ 00383 MSG: geometry_msgs/Pose2D\n\ 00384 # This expresses a position and orientation on a 2D manifold.\n\ 00385 \n\ 00386 float64 x\n\ 00387 float64 y\n\ 00388 float64 theta\n\ 00389 "; 00390 } 00391 00392 static const char* value(const ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionResponse_<ContainerAllocator> &) { return value(); } 00393 }; 00394 00395 template<class ContainerAllocator> struct IsFixedSize< ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionResponse_<ContainerAllocator> > : public TrueType {}; 00396 } // namespace message_traits 00397 } // namespace ros 00398 00399 namespace ros 00400 { 00401 namespace serialization 00402 { 00403 00404 template<class ContainerAllocator> struct Serializer< ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionRequest_<ContainerAllocator> > 00405 { 00406 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00407 { 00408 stream.next(m.parent_obj_geometry); 00409 stream.next(m.furniture_geometry_list); 00410 } 00411 00412 ROS_DECLARE_ALLINONE_SERIALIZER; 00413 }; // struct SymbolGroundingDeliverBaseRegionRequest_ 00414 } // namespace serialization 00415 } // namespace ros 00416 00417 00418 namespace ros 00419 { 00420 namespace serialization 00421 { 00422 00423 template<class ContainerAllocator> struct Serializer< ::srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionResponse_<ContainerAllocator> > 00424 { 00425 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00426 { 00427 stream.next(m.deliver_base_pose); 00428 stream.next(m.R); 00429 } 00430 00431 ROS_DECLARE_ALLINONE_SERIALIZER; 00432 }; // struct SymbolGroundingDeliverBaseRegionResponse_ 00433 } // namespace serialization 00434 } // namespace ros 00435 00436 namespace ros 00437 { 00438 namespace service_traits 00439 { 00440 template<> 00441 struct MD5Sum<srs_symbolic_grounding::SymbolGroundingDeliverBaseRegion> { 00442 static const char* value() 00443 { 00444 return "1414d0f804748752b8fb6a7b28c03566"; 00445 } 00446 00447 static const char* value(const srs_symbolic_grounding::SymbolGroundingDeliverBaseRegion&) { return value(); } 00448 }; 00449 00450 template<> 00451 struct DataType<srs_symbolic_grounding::SymbolGroundingDeliverBaseRegion> { 00452 static const char* value() 00453 { 00454 return "srs_symbolic_grounding/SymbolGroundingDeliverBaseRegion"; 00455 } 00456 00457 static const char* value(const srs_symbolic_grounding::SymbolGroundingDeliverBaseRegion&) { return value(); } 00458 }; 00459 00460 template<class ContainerAllocator> 00461 struct MD5Sum<srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionRequest_<ContainerAllocator> > { 00462 static const char* value() 00463 { 00464 return "1414d0f804748752b8fb6a7b28c03566"; 00465 } 00466 00467 static const char* value(const srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionRequest_<ContainerAllocator> &) { return value(); } 00468 }; 00469 00470 template<class ContainerAllocator> 00471 struct DataType<srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionRequest_<ContainerAllocator> > { 00472 static const char* value() 00473 { 00474 return "srs_symbolic_grounding/SymbolGroundingDeliverBaseRegion"; 00475 } 00476 00477 static const char* value(const srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionRequest_<ContainerAllocator> &) { return value(); } 00478 }; 00479 00480 template<class ContainerAllocator> 00481 struct MD5Sum<srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionResponse_<ContainerAllocator> > { 00482 static const char* value() 00483 { 00484 return "1414d0f804748752b8fb6a7b28c03566"; 00485 } 00486 00487 static const char* value(const srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionResponse_<ContainerAllocator> &) { return value(); } 00488 }; 00489 00490 template<class ContainerAllocator> 00491 struct DataType<srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionResponse_<ContainerAllocator> > { 00492 static const char* value() 00493 { 00494 return "srs_symbolic_grounding/SymbolGroundingDeliverBaseRegion"; 00495 } 00496 00497 static const char* value(const srs_symbolic_grounding::SymbolGroundingDeliverBaseRegionResponse_<ContainerAllocator> &) { return value(); } 00498 }; 00499 00500 } // namespace service_traits 00501 } // namespace ros 00502 00503 #endif // SRS_SYMBOLIC_GROUNDING_SERVICE_SYMBOLGROUNDINGDELIVERBASEREGION_H 00504