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