00001
00002 #ifndef KIDNAPPED_ROBOT_SERVICE_RECOGNIZEPLACE_H
00003 #define KIDNAPPED_ROBOT_SERVICE_RECOGNIZEPLACE_H
00004 #include <string>
00005 #include <vector>
00006 #include <ostream>
00007 #include "ros/serialization.h"
00008 #include "ros/builtin_message_traits.h"
00009 #include "ros/message_operations.h"
00010 #include "ros/message.h"
00011 #include "ros/time.h"
00012
00013 #include "ros/service_traits.h"
00014
00015
00016
00017 #include "geometry_msgs/PoseStamped.h"
00018
00019 namespace kidnapped_robot
00020 {
00021 template <class ContainerAllocator>
00022 struct RecognizePlaceRequest_ : public ros::Message
00023 {
00024 typedef RecognizePlaceRequest_<ContainerAllocator> Type;
00025
00026 RecognizePlaceRequest_()
00027 {
00028 }
00029
00030 RecognizePlaceRequest_(const ContainerAllocator& _alloc)
00031 {
00032 }
00033
00034
00035 private:
00036 static const char* __s_getDataType_() { return "kidnapped_robot/RecognizePlaceRequest"; }
00037 public:
00038 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); }
00039
00040 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); }
00041
00042 private:
00043 static const char* __s_getMD5Sum_() { return "d41d8cd98f00b204e9800998ecf8427e"; }
00044 public:
00045 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); }
00046
00047 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); }
00048
00049 private:
00050 static const char* __s_getServerMD5Sum_() { return "d0f933c333979d9974126ed3d4eed372"; }
00051 public:
00052 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); }
00053
00054 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); }
00055
00056 private:
00057 static const char* __s_getMessageDefinition_() { return "\n\
00058 "; }
00059 public:
00060 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); }
00061
00062 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); }
00063
00064 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const
00065 {
00066 ros::serialization::OStream stream(write_ptr, 1000000000);
00067 return stream.getData();
00068 }
00069
00070 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr)
00071 {
00072 ros::serialization::IStream stream(read_ptr, 1000000000);
00073 return stream.getData();
00074 }
00075
00076 ROS_DEPRECATED virtual uint32_t serializationLength() const
00077 {
00078 uint32_t size = 0;
00079 return size;
00080 }
00081
00082 typedef boost::shared_ptr< ::kidnapped_robot::RecognizePlaceRequest_<ContainerAllocator> > Ptr;
00083 typedef boost::shared_ptr< ::kidnapped_robot::RecognizePlaceRequest_<ContainerAllocator> const> ConstPtr;
00084 };
00085 typedef ::kidnapped_robot::RecognizePlaceRequest_<std::allocator<void> > RecognizePlaceRequest;
00086
00087 typedef boost::shared_ptr< ::kidnapped_robot::RecognizePlaceRequest> RecognizePlaceRequestPtr;
00088 typedef boost::shared_ptr< ::kidnapped_robot::RecognizePlaceRequest const> RecognizePlaceRequestConstPtr;
00089
00090
00091 template <class ContainerAllocator>
00092 struct RecognizePlaceResponse_ : public ros::Message
00093 {
00094 typedef RecognizePlaceResponse_<ContainerAllocator> Type;
00095
00096 RecognizePlaceResponse_()
00097 : pose()
00098 , inliers(0)
00099 {
00100 }
00101
00102 RecognizePlaceResponse_(const ContainerAllocator& _alloc)
00103 : pose(_alloc)
00104 , inliers(0)
00105 {
00106 }
00107
00108 typedef ::geometry_msgs::PoseStamped_<ContainerAllocator> _pose_type;
00109 ::geometry_msgs::PoseStamped_<ContainerAllocator> pose;
00110
00111 typedef int32_t _inliers_type;
00112 int32_t inliers;
00113
00114
00115 private:
00116 static const char* __s_getDataType_() { return "kidnapped_robot/RecognizePlaceResponse"; }
00117 public:
00118 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); }
00119
00120 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); }
00121
00122 private:
00123 static const char* __s_getMD5Sum_() { return "d0f933c333979d9974126ed3d4eed372"; }
00124 public:
00125 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); }
00126
00127 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); }
00128
00129 private:
00130 static const char* __s_getServerMD5Sum_() { return "d0f933c333979d9974126ed3d4eed372"; }
00131 public:
00132 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); }
00133
00134 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); }
00135
00136 private:
00137 static const char* __s_getMessageDefinition_() { return "geometry_msgs/PoseStamped pose\n\
00138 int32 inliers\n\
00139 \n\
00140 \n\
00141 ================================================================================\n\
00142 MSG: geometry_msgs/PoseStamped\n\
00143 # A Pose with reference coordinate frame and timestamp\n\
00144 Header header\n\
00145 Pose pose\n\
00146 \n\
00147 ================================================================================\n\
00148 MSG: std_msgs/Header\n\
00149 # Standard metadata for higher-level stamped data types.\n\
00150 # This is generally used to communicate timestamped data \n\
00151 # in a particular coordinate frame.\n\
00152 # \n\
00153 # sequence ID: consecutively increasing ID \n\
00154 uint32 seq\n\
00155 #Two-integer timestamp that is expressed as:\n\
00156 # * stamp.secs: seconds (stamp_secs) since epoch\n\
00157 # * stamp.nsecs: nanoseconds since stamp_secs\n\
00158 # time-handling sugar is provided by the client library\n\
00159 time stamp\n\
00160 #Frame this data is associated with\n\
00161 # 0: no frame\n\
00162 # 1: global frame\n\
00163 string frame_id\n\
00164 \n\
00165 ================================================================================\n\
00166 MSG: geometry_msgs/Pose\n\
00167 # A representation of pose in free space, composed of postion and orientation. \n\
00168 Point position\n\
00169 Quaternion orientation\n\
00170 \n\
00171 ================================================================================\n\
00172 MSG: geometry_msgs/Point\n\
00173 # This contains the position of a point in free space\n\
00174 float64 x\n\
00175 float64 y\n\
00176 float64 z\n\
00177 \n\
00178 ================================================================================\n\
00179 MSG: geometry_msgs/Quaternion\n\
00180 # This represents an orientation in free space in quaternion form.\n\
00181 \n\
00182 float64 x\n\
00183 float64 y\n\
00184 float64 z\n\
00185 float64 w\n\
00186 \n\
00187 "; }
00188 public:
00189 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); }
00190
00191 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); }
00192
00193 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const
00194 {
00195 ros::serialization::OStream stream(write_ptr, 1000000000);
00196 ros::serialization::serialize(stream, pose);
00197 ros::serialization::serialize(stream, inliers);
00198 return stream.getData();
00199 }
00200
00201 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr)
00202 {
00203 ros::serialization::IStream stream(read_ptr, 1000000000);
00204 ros::serialization::deserialize(stream, pose);
00205 ros::serialization::deserialize(stream, inliers);
00206 return stream.getData();
00207 }
00208
00209 ROS_DEPRECATED virtual uint32_t serializationLength() const
00210 {
00211 uint32_t size = 0;
00212 size += ros::serialization::serializationLength(pose);
00213 size += ros::serialization::serializationLength(inliers);
00214 return size;
00215 }
00216
00217 typedef boost::shared_ptr< ::kidnapped_robot::RecognizePlaceResponse_<ContainerAllocator> > Ptr;
00218 typedef boost::shared_ptr< ::kidnapped_robot::RecognizePlaceResponse_<ContainerAllocator> const> ConstPtr;
00219 };
00220 typedef ::kidnapped_robot::RecognizePlaceResponse_<std::allocator<void> > RecognizePlaceResponse;
00221
00222 typedef boost::shared_ptr< ::kidnapped_robot::RecognizePlaceResponse> RecognizePlaceResponsePtr;
00223 typedef boost::shared_ptr< ::kidnapped_robot::RecognizePlaceResponse const> RecognizePlaceResponseConstPtr;
00224
00225 struct RecognizePlace
00226 {
00227
00228 typedef RecognizePlaceRequest Request;
00229 typedef RecognizePlaceResponse Response;
00230 Request request;
00231 Response response;
00232
00233 typedef Request RequestType;
00234 typedef Response ResponseType;
00235 };
00236 }
00237
00238 namespace ros
00239 {
00240 namespace message_traits
00241 {
00242 template<class ContainerAllocator>
00243 struct MD5Sum< ::kidnapped_robot::RecognizePlaceRequest_<ContainerAllocator> > {
00244 static const char* value()
00245 {
00246 return "d41d8cd98f00b204e9800998ecf8427e";
00247 }
00248
00249 static const char* value(const ::kidnapped_robot::RecognizePlaceRequest_<ContainerAllocator> &) { return value(); }
00250 static const uint64_t static_value1 = 0xd41d8cd98f00b204ULL;
00251 static const uint64_t static_value2 = 0xe9800998ecf8427eULL;
00252 };
00253
00254 template<class ContainerAllocator>
00255 struct DataType< ::kidnapped_robot::RecognizePlaceRequest_<ContainerAllocator> > {
00256 static const char* value()
00257 {
00258 return "kidnapped_robot/RecognizePlaceRequest";
00259 }
00260
00261 static const char* value(const ::kidnapped_robot::RecognizePlaceRequest_<ContainerAllocator> &) { return value(); }
00262 };
00263
00264 template<class ContainerAllocator>
00265 struct Definition< ::kidnapped_robot::RecognizePlaceRequest_<ContainerAllocator> > {
00266 static const char* value()
00267 {
00268 return "\n\
00269 ";
00270 }
00271
00272 static const char* value(const ::kidnapped_robot::RecognizePlaceRequest_<ContainerAllocator> &) { return value(); }
00273 };
00274
00275 template<class ContainerAllocator> struct IsFixedSize< ::kidnapped_robot::RecognizePlaceRequest_<ContainerAllocator> > : public TrueType {};
00276 }
00277 }
00278
00279
00280 namespace ros
00281 {
00282 namespace message_traits
00283 {
00284 template<class ContainerAllocator>
00285 struct MD5Sum< ::kidnapped_robot::RecognizePlaceResponse_<ContainerAllocator> > {
00286 static const char* value()
00287 {
00288 return "d0f933c333979d9974126ed3d4eed372";
00289 }
00290
00291 static const char* value(const ::kidnapped_robot::RecognizePlaceResponse_<ContainerAllocator> &) { return value(); }
00292 static const uint64_t static_value1 = 0xd0f933c333979d99ULL;
00293 static const uint64_t static_value2 = 0x74126ed3d4eed372ULL;
00294 };
00295
00296 template<class ContainerAllocator>
00297 struct DataType< ::kidnapped_robot::RecognizePlaceResponse_<ContainerAllocator> > {
00298 static const char* value()
00299 {
00300 return "kidnapped_robot/RecognizePlaceResponse";
00301 }
00302
00303 static const char* value(const ::kidnapped_robot::RecognizePlaceResponse_<ContainerAllocator> &) { return value(); }
00304 };
00305
00306 template<class ContainerAllocator>
00307 struct Definition< ::kidnapped_robot::RecognizePlaceResponse_<ContainerAllocator> > {
00308 static const char* value()
00309 {
00310 return "geometry_msgs/PoseStamped pose\n\
00311 int32 inliers\n\
00312 \n\
00313 \n\
00314 ================================================================================\n\
00315 MSG: geometry_msgs/PoseStamped\n\
00316 # A Pose with reference coordinate frame and timestamp\n\
00317 Header header\n\
00318 Pose pose\n\
00319 \n\
00320 ================================================================================\n\
00321 MSG: std_msgs/Header\n\
00322 # Standard metadata for higher-level stamped data types.\n\
00323 # This is generally used to communicate timestamped data \n\
00324 # in a particular coordinate frame.\n\
00325 # \n\
00326 # sequence ID: consecutively increasing ID \n\
00327 uint32 seq\n\
00328 #Two-integer timestamp that is expressed as:\n\
00329 # * stamp.secs: seconds (stamp_secs) since epoch\n\
00330 # * stamp.nsecs: nanoseconds since stamp_secs\n\
00331 # time-handling sugar is provided by the client library\n\
00332 time stamp\n\
00333 #Frame this data is associated with\n\
00334 # 0: no frame\n\
00335 # 1: global frame\n\
00336 string frame_id\n\
00337 \n\
00338 ================================================================================\n\
00339 MSG: geometry_msgs/Pose\n\
00340 # A representation of pose in free space, composed of postion and orientation. \n\
00341 Point position\n\
00342 Quaternion orientation\n\
00343 \n\
00344 ================================================================================\n\
00345 MSG: geometry_msgs/Point\n\
00346 # This contains the position of a point in free space\n\
00347 float64 x\n\
00348 float64 y\n\
00349 float64 z\n\
00350 \n\
00351 ================================================================================\n\
00352 MSG: geometry_msgs/Quaternion\n\
00353 # This represents an orientation in free space in quaternion form.\n\
00354 \n\
00355 float64 x\n\
00356 float64 y\n\
00357 float64 z\n\
00358 float64 w\n\
00359 \n\
00360 ";
00361 }
00362
00363 static const char* value(const ::kidnapped_robot::RecognizePlaceResponse_<ContainerAllocator> &) { return value(); }
00364 };
00365
00366 }
00367 }
00368
00369 namespace ros
00370 {
00371 namespace serialization
00372 {
00373
00374 template<class ContainerAllocator> struct Serializer< ::kidnapped_robot::RecognizePlaceRequest_<ContainerAllocator> >
00375 {
00376 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00377 {
00378 }
00379
00380 ROS_DECLARE_ALLINONE_SERIALIZER;
00381 };
00382 }
00383 }
00384
00385
00386 namespace ros
00387 {
00388 namespace serialization
00389 {
00390
00391 template<class ContainerAllocator> struct Serializer< ::kidnapped_robot::RecognizePlaceResponse_<ContainerAllocator> >
00392 {
00393 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00394 {
00395 stream.next(m.pose);
00396 stream.next(m.inliers);
00397 }
00398
00399 ROS_DECLARE_ALLINONE_SERIALIZER;
00400 };
00401 }
00402 }
00403
00404 namespace ros
00405 {
00406 namespace service_traits
00407 {
00408 template<>
00409 struct MD5Sum<kidnapped_robot::RecognizePlace> {
00410 static const char* value()
00411 {
00412 return "d0f933c333979d9974126ed3d4eed372";
00413 }
00414
00415 static const char* value(const kidnapped_robot::RecognizePlace&) { return value(); }
00416 };
00417
00418 template<>
00419 struct DataType<kidnapped_robot::RecognizePlace> {
00420 static const char* value()
00421 {
00422 return "kidnapped_robot/RecognizePlace";
00423 }
00424
00425 static const char* value(const kidnapped_robot::RecognizePlace&) { return value(); }
00426 };
00427
00428 template<class ContainerAllocator>
00429 struct MD5Sum<kidnapped_robot::RecognizePlaceRequest_<ContainerAllocator> > {
00430 static const char* value()
00431 {
00432 return "d0f933c333979d9974126ed3d4eed372";
00433 }
00434
00435 static const char* value(const kidnapped_robot::RecognizePlaceRequest_<ContainerAllocator> &) { return value(); }
00436 };
00437
00438 template<class ContainerAllocator>
00439 struct DataType<kidnapped_robot::RecognizePlaceRequest_<ContainerAllocator> > {
00440 static const char* value()
00441 {
00442 return "kidnapped_robot/RecognizePlace";
00443 }
00444
00445 static const char* value(const kidnapped_robot::RecognizePlaceRequest_<ContainerAllocator> &) { return value(); }
00446 };
00447
00448 template<class ContainerAllocator>
00449 struct MD5Sum<kidnapped_robot::RecognizePlaceResponse_<ContainerAllocator> > {
00450 static const char* value()
00451 {
00452 return "d0f933c333979d9974126ed3d4eed372";
00453 }
00454
00455 static const char* value(const kidnapped_robot::RecognizePlaceResponse_<ContainerAllocator> &) { return value(); }
00456 };
00457
00458 template<class ContainerAllocator>
00459 struct DataType<kidnapped_robot::RecognizePlaceResponse_<ContainerAllocator> > {
00460 static const char* value()
00461 {
00462 return "kidnapped_robot/RecognizePlace";
00463 }
00464
00465 static const char* value(const kidnapped_robot::RecognizePlaceResponse_<ContainerAllocator> &) { return value(); }
00466 };
00467
00468 }
00469 }
00470
00471 #endif // KIDNAPPED_ROBOT_SERVICE_RECOGNIZEPLACE_H
00472