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