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