$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_interaction_primitives/srv/GetBoundingBox.srv */ 00002 #ifndef SRS_INTERACTION_PRIMITIVES_SERVICE_GETBOUNDINGBOX_H 00003 #define SRS_INTERACTION_PRIMITIVES_SERVICE_GETBOUNDINGBOX_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/Pose.h" 00022 #include "geometry_msgs/Vector3.h" 00023 #include "std_msgs/ColorRGBA.h" 00024 00025 namespace srs_interaction_primitives 00026 { 00027 template <class ContainerAllocator> 00028 struct GetBoundingBoxRequest_ { 00029 typedef GetBoundingBoxRequest_<ContainerAllocator> Type; 00030 00031 GetBoundingBoxRequest_() 00032 : name() 00033 { 00034 } 00035 00036 GetBoundingBoxRequest_(const ContainerAllocator& _alloc) 00037 : name(_alloc) 00038 { 00039 } 00040 00041 typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > _name_type; 00042 std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > name; 00043 00044 00045 private: 00046 static const char* __s_getDataType_() { return "srs_interaction_primitives/GetBoundingBoxRequest"; } 00047 public: 00048 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); } 00049 00050 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); } 00051 00052 private: 00053 static const char* __s_getMD5Sum_() { return "c1f3d28f1b044c871e6eff2e9fc3c667"; } 00054 public: 00055 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); } 00056 00057 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); } 00058 00059 private: 00060 static const char* __s_getServerMD5Sum_() { return "c21d352cdd8c23ca9dcd65e579891521"; } 00061 public: 00062 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); } 00063 00064 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); } 00065 00066 private: 00067 static const char* __s_getMessageDefinition_() { return "string name\n\ 00068 \n\ 00069 "; } 00070 public: 00071 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); } 00072 00073 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); } 00074 00075 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const 00076 { 00077 ros::serialization::OStream stream(write_ptr, 1000000000); 00078 ros::serialization::serialize(stream, name); 00079 return stream.getData(); 00080 } 00081 00082 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr) 00083 { 00084 ros::serialization::IStream stream(read_ptr, 1000000000); 00085 ros::serialization::deserialize(stream, name); 00086 return stream.getData(); 00087 } 00088 00089 ROS_DEPRECATED virtual uint32_t serializationLength() const 00090 { 00091 uint32_t size = 0; 00092 size += ros::serialization::serializationLength(name); 00093 return size; 00094 } 00095 00096 typedef boost::shared_ptr< ::srs_interaction_primitives::GetBoundingBoxRequest_<ContainerAllocator> > Ptr; 00097 typedef boost::shared_ptr< ::srs_interaction_primitives::GetBoundingBoxRequest_<ContainerAllocator> const> ConstPtr; 00098 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00099 }; // struct GetBoundingBoxRequest 00100 typedef ::srs_interaction_primitives::GetBoundingBoxRequest_<std::allocator<void> > GetBoundingBoxRequest; 00101 00102 typedef boost::shared_ptr< ::srs_interaction_primitives::GetBoundingBoxRequest> GetBoundingBoxRequestPtr; 00103 typedef boost::shared_ptr< ::srs_interaction_primitives::GetBoundingBoxRequest const> GetBoundingBoxRequestConstPtr; 00104 00105 00106 template <class ContainerAllocator> 00107 struct GetBoundingBoxResponse_ { 00108 typedef GetBoundingBoxResponse_<ContainerAllocator> Type; 00109 00110 GetBoundingBoxResponse_() 00111 : frame_id() 00112 , name() 00113 , object_name() 00114 , description() 00115 , pose() 00116 , pose_type(0) 00117 , scale() 00118 , color() 00119 { 00120 } 00121 00122 GetBoundingBoxResponse_(const ContainerAllocator& _alloc) 00123 : frame_id(_alloc) 00124 , name(_alloc) 00125 , object_name(_alloc) 00126 , description(_alloc) 00127 , pose(_alloc) 00128 , pose_type(0) 00129 , scale(_alloc) 00130 , color(_alloc) 00131 { 00132 } 00133 00134 typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > _frame_id_type; 00135 std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > frame_id; 00136 00137 typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > _name_type; 00138 std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > name; 00139 00140 typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > _object_name_type; 00141 std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > object_name; 00142 00143 typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > _description_type; 00144 std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > description; 00145 00146 typedef ::geometry_msgs::Pose_<ContainerAllocator> _pose_type; 00147 ::geometry_msgs::Pose_<ContainerAllocator> pose; 00148 00149 typedef uint8_t _pose_type_type; 00150 uint8_t pose_type; 00151 00152 typedef ::geometry_msgs::Vector3_<ContainerAllocator> _scale_type; 00153 ::geometry_msgs::Vector3_<ContainerAllocator> scale; 00154 00155 typedef ::std_msgs::ColorRGBA_<ContainerAllocator> _color_type; 00156 ::std_msgs::ColorRGBA_<ContainerAllocator> color; 00157 00158 00159 private: 00160 static const char* __s_getDataType_() { return "srs_interaction_primitives/GetBoundingBoxResponse"; } 00161 public: 00162 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); } 00163 00164 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); } 00165 00166 private: 00167 static const char* __s_getMD5Sum_() { return "6248559b195674f45f109f2440a61758"; } 00168 public: 00169 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); } 00170 00171 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); } 00172 00173 private: 00174 static const char* __s_getServerMD5Sum_() { return "c21d352cdd8c23ca9dcd65e579891521"; } 00175 public: 00176 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); } 00177 00178 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); } 00179 00180 private: 00181 static const char* __s_getMessageDefinition_() { return "string frame_id\n\ 00182 string name\n\ 00183 string object_name\n\ 00184 string description\n\ 00185 geometry_msgs/Pose pose\n\ 00186 uint8 pose_type\n\ 00187 geometry_msgs/Vector3 scale\n\ 00188 std_msgs/ColorRGBA color\n\ 00189 \n\ 00190 ================================================================================\n\ 00191 MSG: geometry_msgs/Pose\n\ 00192 # A representation of pose in free space, composed of postion and orientation. \n\ 00193 Point position\n\ 00194 Quaternion orientation\n\ 00195 \n\ 00196 ================================================================================\n\ 00197 MSG: geometry_msgs/Point\n\ 00198 # This contains the position of a point in free space\n\ 00199 float64 x\n\ 00200 float64 y\n\ 00201 float64 z\n\ 00202 \n\ 00203 ================================================================================\n\ 00204 MSG: geometry_msgs/Quaternion\n\ 00205 # This represents an orientation in free space in quaternion form.\n\ 00206 \n\ 00207 float64 x\n\ 00208 float64 y\n\ 00209 float64 z\n\ 00210 float64 w\n\ 00211 \n\ 00212 ================================================================================\n\ 00213 MSG: geometry_msgs/Vector3\n\ 00214 # This represents a vector in free space. \n\ 00215 \n\ 00216 float64 x\n\ 00217 float64 y\n\ 00218 float64 z\n\ 00219 ================================================================================\n\ 00220 MSG: std_msgs/ColorRGBA\n\ 00221 float32 r\n\ 00222 float32 g\n\ 00223 float32 b\n\ 00224 float32 a\n\ 00225 \n\ 00226 "; } 00227 public: 00228 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); } 00229 00230 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); } 00231 00232 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const 00233 { 00234 ros::serialization::OStream stream(write_ptr, 1000000000); 00235 ros::serialization::serialize(stream, frame_id); 00236 ros::serialization::serialize(stream, name); 00237 ros::serialization::serialize(stream, object_name); 00238 ros::serialization::serialize(stream, description); 00239 ros::serialization::serialize(stream, pose); 00240 ros::serialization::serialize(stream, pose_type); 00241 ros::serialization::serialize(stream, scale); 00242 ros::serialization::serialize(stream, color); 00243 return stream.getData(); 00244 } 00245 00246 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr) 00247 { 00248 ros::serialization::IStream stream(read_ptr, 1000000000); 00249 ros::serialization::deserialize(stream, frame_id); 00250 ros::serialization::deserialize(stream, name); 00251 ros::serialization::deserialize(stream, object_name); 00252 ros::serialization::deserialize(stream, description); 00253 ros::serialization::deserialize(stream, pose); 00254 ros::serialization::deserialize(stream, pose_type); 00255 ros::serialization::deserialize(stream, scale); 00256 ros::serialization::deserialize(stream, color); 00257 return stream.getData(); 00258 } 00259 00260 ROS_DEPRECATED virtual uint32_t serializationLength() const 00261 { 00262 uint32_t size = 0; 00263 size += ros::serialization::serializationLength(frame_id); 00264 size += ros::serialization::serializationLength(name); 00265 size += ros::serialization::serializationLength(object_name); 00266 size += ros::serialization::serializationLength(description); 00267 size += ros::serialization::serializationLength(pose); 00268 size += ros::serialization::serializationLength(pose_type); 00269 size += ros::serialization::serializationLength(scale); 00270 size += ros::serialization::serializationLength(color); 00271 return size; 00272 } 00273 00274 typedef boost::shared_ptr< ::srs_interaction_primitives::GetBoundingBoxResponse_<ContainerAllocator> > Ptr; 00275 typedef boost::shared_ptr< ::srs_interaction_primitives::GetBoundingBoxResponse_<ContainerAllocator> const> ConstPtr; 00276 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00277 }; // struct GetBoundingBoxResponse 00278 typedef ::srs_interaction_primitives::GetBoundingBoxResponse_<std::allocator<void> > GetBoundingBoxResponse; 00279 00280 typedef boost::shared_ptr< ::srs_interaction_primitives::GetBoundingBoxResponse> GetBoundingBoxResponsePtr; 00281 typedef boost::shared_ptr< ::srs_interaction_primitives::GetBoundingBoxResponse const> GetBoundingBoxResponseConstPtr; 00282 00283 struct GetBoundingBox 00284 { 00285 00286 typedef GetBoundingBoxRequest Request; 00287 typedef GetBoundingBoxResponse Response; 00288 Request request; 00289 Response response; 00290 00291 typedef Request RequestType; 00292 typedef Response ResponseType; 00293 }; // struct GetBoundingBox 00294 } // namespace srs_interaction_primitives 00295 00296 namespace ros 00297 { 00298 namespace message_traits 00299 { 00300 template<class ContainerAllocator> struct IsMessage< ::srs_interaction_primitives::GetBoundingBoxRequest_<ContainerAllocator> > : public TrueType {}; 00301 template<class ContainerAllocator> struct IsMessage< ::srs_interaction_primitives::GetBoundingBoxRequest_<ContainerAllocator> const> : public TrueType {}; 00302 template<class ContainerAllocator> 00303 struct MD5Sum< ::srs_interaction_primitives::GetBoundingBoxRequest_<ContainerAllocator> > { 00304 static const char* value() 00305 { 00306 return "c1f3d28f1b044c871e6eff2e9fc3c667"; 00307 } 00308 00309 static const char* value(const ::srs_interaction_primitives::GetBoundingBoxRequest_<ContainerAllocator> &) { return value(); } 00310 static const uint64_t static_value1 = 0xc1f3d28f1b044c87ULL; 00311 static const uint64_t static_value2 = 0x1e6eff2e9fc3c667ULL; 00312 }; 00313 00314 template<class ContainerAllocator> 00315 struct DataType< ::srs_interaction_primitives::GetBoundingBoxRequest_<ContainerAllocator> > { 00316 static const char* value() 00317 { 00318 return "srs_interaction_primitives/GetBoundingBoxRequest"; 00319 } 00320 00321 static const char* value(const ::srs_interaction_primitives::GetBoundingBoxRequest_<ContainerAllocator> &) { return value(); } 00322 }; 00323 00324 template<class ContainerAllocator> 00325 struct Definition< ::srs_interaction_primitives::GetBoundingBoxRequest_<ContainerAllocator> > { 00326 static const char* value() 00327 { 00328 return "string name\n\ 00329 \n\ 00330 "; 00331 } 00332 00333 static const char* value(const ::srs_interaction_primitives::GetBoundingBoxRequest_<ContainerAllocator> &) { return value(); } 00334 }; 00335 00336 } // namespace message_traits 00337 } // namespace ros 00338 00339 00340 namespace ros 00341 { 00342 namespace message_traits 00343 { 00344 template<class ContainerAllocator> struct IsMessage< ::srs_interaction_primitives::GetBoundingBoxResponse_<ContainerAllocator> > : public TrueType {}; 00345 template<class ContainerAllocator> struct IsMessage< ::srs_interaction_primitives::GetBoundingBoxResponse_<ContainerAllocator> const> : public TrueType {}; 00346 template<class ContainerAllocator> 00347 struct MD5Sum< ::srs_interaction_primitives::GetBoundingBoxResponse_<ContainerAllocator> > { 00348 static const char* value() 00349 { 00350 return "6248559b195674f45f109f2440a61758"; 00351 } 00352 00353 static const char* value(const ::srs_interaction_primitives::GetBoundingBoxResponse_<ContainerAllocator> &) { return value(); } 00354 static const uint64_t static_value1 = 0x6248559b195674f4ULL; 00355 static const uint64_t static_value2 = 0x5f109f2440a61758ULL; 00356 }; 00357 00358 template<class ContainerAllocator> 00359 struct DataType< ::srs_interaction_primitives::GetBoundingBoxResponse_<ContainerAllocator> > { 00360 static const char* value() 00361 { 00362 return "srs_interaction_primitives/GetBoundingBoxResponse"; 00363 } 00364 00365 static const char* value(const ::srs_interaction_primitives::GetBoundingBoxResponse_<ContainerAllocator> &) { return value(); } 00366 }; 00367 00368 template<class ContainerAllocator> 00369 struct Definition< ::srs_interaction_primitives::GetBoundingBoxResponse_<ContainerAllocator> > { 00370 static const char* value() 00371 { 00372 return "string frame_id\n\ 00373 string name\n\ 00374 string object_name\n\ 00375 string description\n\ 00376 geometry_msgs/Pose pose\n\ 00377 uint8 pose_type\n\ 00378 geometry_msgs/Vector3 scale\n\ 00379 std_msgs/ColorRGBA color\n\ 00380 \n\ 00381 ================================================================================\n\ 00382 MSG: geometry_msgs/Pose\n\ 00383 # A representation of pose in free space, composed of postion and orientation. \n\ 00384 Point position\n\ 00385 Quaternion orientation\n\ 00386 \n\ 00387 ================================================================================\n\ 00388 MSG: geometry_msgs/Point\n\ 00389 # This contains the position of a point in free space\n\ 00390 float64 x\n\ 00391 float64 y\n\ 00392 float64 z\n\ 00393 \n\ 00394 ================================================================================\n\ 00395 MSG: geometry_msgs/Quaternion\n\ 00396 # This represents an orientation in free space in quaternion form.\n\ 00397 \n\ 00398 float64 x\n\ 00399 float64 y\n\ 00400 float64 z\n\ 00401 float64 w\n\ 00402 \n\ 00403 ================================================================================\n\ 00404 MSG: geometry_msgs/Vector3\n\ 00405 # This represents a vector in free space. \n\ 00406 \n\ 00407 float64 x\n\ 00408 float64 y\n\ 00409 float64 z\n\ 00410 ================================================================================\n\ 00411 MSG: std_msgs/ColorRGBA\n\ 00412 float32 r\n\ 00413 float32 g\n\ 00414 float32 b\n\ 00415 float32 a\n\ 00416 \n\ 00417 "; 00418 } 00419 00420 static const char* value(const ::srs_interaction_primitives::GetBoundingBoxResponse_<ContainerAllocator> &) { return value(); } 00421 }; 00422 00423 } // namespace message_traits 00424 } // namespace ros 00425 00426 namespace ros 00427 { 00428 namespace serialization 00429 { 00430 00431 template<class ContainerAllocator> struct Serializer< ::srs_interaction_primitives::GetBoundingBoxRequest_<ContainerAllocator> > 00432 { 00433 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00434 { 00435 stream.next(m.name); 00436 } 00437 00438 ROS_DECLARE_ALLINONE_SERIALIZER; 00439 }; // struct GetBoundingBoxRequest_ 00440 } // namespace serialization 00441 } // namespace ros 00442 00443 00444 namespace ros 00445 { 00446 namespace serialization 00447 { 00448 00449 template<class ContainerAllocator> struct Serializer< ::srs_interaction_primitives::GetBoundingBoxResponse_<ContainerAllocator> > 00450 { 00451 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00452 { 00453 stream.next(m.frame_id); 00454 stream.next(m.name); 00455 stream.next(m.object_name); 00456 stream.next(m.description); 00457 stream.next(m.pose); 00458 stream.next(m.pose_type); 00459 stream.next(m.scale); 00460 stream.next(m.color); 00461 } 00462 00463 ROS_DECLARE_ALLINONE_SERIALIZER; 00464 }; // struct GetBoundingBoxResponse_ 00465 } // namespace serialization 00466 } // namespace ros 00467 00468 namespace ros 00469 { 00470 namespace service_traits 00471 { 00472 template<> 00473 struct MD5Sum<srs_interaction_primitives::GetBoundingBox> { 00474 static const char* value() 00475 { 00476 return "c21d352cdd8c23ca9dcd65e579891521"; 00477 } 00478 00479 static const char* value(const srs_interaction_primitives::GetBoundingBox&) { return value(); } 00480 }; 00481 00482 template<> 00483 struct DataType<srs_interaction_primitives::GetBoundingBox> { 00484 static const char* value() 00485 { 00486 return "srs_interaction_primitives/GetBoundingBox"; 00487 } 00488 00489 static const char* value(const srs_interaction_primitives::GetBoundingBox&) { return value(); } 00490 }; 00491 00492 template<class ContainerAllocator> 00493 struct MD5Sum<srs_interaction_primitives::GetBoundingBoxRequest_<ContainerAllocator> > { 00494 static const char* value() 00495 { 00496 return "c21d352cdd8c23ca9dcd65e579891521"; 00497 } 00498 00499 static const char* value(const srs_interaction_primitives::GetBoundingBoxRequest_<ContainerAllocator> &) { return value(); } 00500 }; 00501 00502 template<class ContainerAllocator> 00503 struct DataType<srs_interaction_primitives::GetBoundingBoxRequest_<ContainerAllocator> > { 00504 static const char* value() 00505 { 00506 return "srs_interaction_primitives/GetBoundingBox"; 00507 } 00508 00509 static const char* value(const srs_interaction_primitives::GetBoundingBoxRequest_<ContainerAllocator> &) { return value(); } 00510 }; 00511 00512 template<class ContainerAllocator> 00513 struct MD5Sum<srs_interaction_primitives::GetBoundingBoxResponse_<ContainerAllocator> > { 00514 static const char* value() 00515 { 00516 return "c21d352cdd8c23ca9dcd65e579891521"; 00517 } 00518 00519 static const char* value(const srs_interaction_primitives::GetBoundingBoxResponse_<ContainerAllocator> &) { return value(); } 00520 }; 00521 00522 template<class ContainerAllocator> 00523 struct DataType<srs_interaction_primitives::GetBoundingBoxResponse_<ContainerAllocator> > { 00524 static const char* value() 00525 { 00526 return "srs_interaction_primitives/GetBoundingBox"; 00527 } 00528 00529 static const char* value(const srs_interaction_primitives::GetBoundingBoxResponse_<ContainerAllocator> &) { return value(); } 00530 }; 00531 00532 } // namespace service_traits 00533 } // namespace ros 00534 00535 #endif // SRS_INTERACTION_PRIMITIVES_SERVICE_GETBOUNDINGBOX_H 00536