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