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