$search
00001 /* Auto-generated by genmsg_cpp for file /home/rosbuild/hudson/workspace/doc-electric-pr2_object_manipulation/doc_stacks/2013-03-05_12-10-38.333207/pr2_object_manipulation/perception/vfh_recognizer_db/srv/remove_duplicate_views.srv */ 00002 #ifndef VFH_RECOGNIZER_DB_SERVICE_REMOVE_DUPLICATE_VIEWS_H 00003 #define VFH_RECOGNIZER_DB_SERVICE_REMOVE_DUPLICATE_VIEWS_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 "std_msgs/Int32.h" 00020 #include "std_msgs/Int32.h" 00021 00022 00023 00024 namespace vfh_recognizer_db 00025 { 00026 template <class ContainerAllocator> 00027 struct remove_duplicate_viewsRequest_ { 00028 typedef remove_duplicate_viewsRequest_<ContainerAllocator> Type; 00029 00030 remove_duplicate_viewsRequest_() 00031 : scaled_model_id() 00032 , iteration() 00033 { 00034 } 00035 00036 remove_duplicate_viewsRequest_(const ContainerAllocator& _alloc) 00037 : scaled_model_id(_alloc) 00038 , iteration(_alloc) 00039 { 00040 } 00041 00042 typedef ::std_msgs::Int32_<ContainerAllocator> _scaled_model_id_type; 00043 ::std_msgs::Int32_<ContainerAllocator> scaled_model_id; 00044 00045 typedef ::std_msgs::Int32_<ContainerAllocator> _iteration_type; 00046 ::std_msgs::Int32_<ContainerAllocator> iteration; 00047 00048 00049 private: 00050 static const char* __s_getDataType_() { return "vfh_recognizer_db/remove_duplicate_viewsRequest"; } 00051 public: 00052 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); } 00053 00054 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); } 00055 00056 private: 00057 static const char* __s_getMD5Sum_() { return "756ac673cc480e7ac7af4e69f0643534"; } 00058 public: 00059 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); } 00060 00061 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); } 00062 00063 private: 00064 static const char* __s_getServerMD5Sum_() { return "756ac673cc480e7ac7af4e69f0643534"; } 00065 public: 00066 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); } 00067 00068 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); } 00069 00070 private: 00071 static const char* __s_getMessageDefinition_() { return "std_msgs/Int32 scaled_model_id\n\ 00072 std_msgs/Int32 iteration\n\ 00073 \n\ 00074 ================================================================================\n\ 00075 MSG: std_msgs/Int32\n\ 00076 int32 data\n\ 00077 "; } 00078 public: 00079 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); } 00080 00081 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); } 00082 00083 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const 00084 { 00085 ros::serialization::OStream stream(write_ptr, 1000000000); 00086 ros::serialization::serialize(stream, scaled_model_id); 00087 ros::serialization::serialize(stream, iteration); 00088 return stream.getData(); 00089 } 00090 00091 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr) 00092 { 00093 ros::serialization::IStream stream(read_ptr, 1000000000); 00094 ros::serialization::deserialize(stream, scaled_model_id); 00095 ros::serialization::deserialize(stream, iteration); 00096 return stream.getData(); 00097 } 00098 00099 ROS_DEPRECATED virtual uint32_t serializationLength() const 00100 { 00101 uint32_t size = 0; 00102 size += ros::serialization::serializationLength(scaled_model_id); 00103 size += ros::serialization::serializationLength(iteration); 00104 return size; 00105 } 00106 00107 typedef boost::shared_ptr< ::vfh_recognizer_db::remove_duplicate_viewsRequest_<ContainerAllocator> > Ptr; 00108 typedef boost::shared_ptr< ::vfh_recognizer_db::remove_duplicate_viewsRequest_<ContainerAllocator> const> ConstPtr; 00109 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00110 }; // struct remove_duplicate_viewsRequest 00111 typedef ::vfh_recognizer_db::remove_duplicate_viewsRequest_<std::allocator<void> > remove_duplicate_viewsRequest; 00112 00113 typedef boost::shared_ptr< ::vfh_recognizer_db::remove_duplicate_viewsRequest> remove_duplicate_viewsRequestPtr; 00114 typedef boost::shared_ptr< ::vfh_recognizer_db::remove_duplicate_viewsRequest const> remove_duplicate_viewsRequestConstPtr; 00115 00116 00117 template <class ContainerAllocator> 00118 struct remove_duplicate_viewsResponse_ { 00119 typedef remove_duplicate_viewsResponse_<ContainerAllocator> Type; 00120 00121 remove_duplicate_viewsResponse_() 00122 { 00123 } 00124 00125 remove_duplicate_viewsResponse_(const ContainerAllocator& _alloc) 00126 { 00127 } 00128 00129 00130 private: 00131 static const char* __s_getDataType_() { return "vfh_recognizer_db/remove_duplicate_viewsResponse"; } 00132 public: 00133 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); } 00134 00135 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); } 00136 00137 private: 00138 static const char* __s_getMD5Sum_() { return "d41d8cd98f00b204e9800998ecf8427e"; } 00139 public: 00140 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); } 00141 00142 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); } 00143 00144 private: 00145 static const char* __s_getServerMD5Sum_() { return "756ac673cc480e7ac7af4e69f0643534"; } 00146 public: 00147 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); } 00148 00149 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); } 00150 00151 private: 00152 static const char* __s_getMessageDefinition_() { return "\n\ 00153 "; } 00154 public: 00155 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); } 00156 00157 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); } 00158 00159 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const 00160 { 00161 ros::serialization::OStream stream(write_ptr, 1000000000); 00162 return stream.getData(); 00163 } 00164 00165 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr) 00166 { 00167 ros::serialization::IStream stream(read_ptr, 1000000000); 00168 return stream.getData(); 00169 } 00170 00171 ROS_DEPRECATED virtual uint32_t serializationLength() const 00172 { 00173 uint32_t size = 0; 00174 return size; 00175 } 00176 00177 typedef boost::shared_ptr< ::vfh_recognizer_db::remove_duplicate_viewsResponse_<ContainerAllocator> > Ptr; 00178 typedef boost::shared_ptr< ::vfh_recognizer_db::remove_duplicate_viewsResponse_<ContainerAllocator> const> ConstPtr; 00179 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00180 }; // struct remove_duplicate_viewsResponse 00181 typedef ::vfh_recognizer_db::remove_duplicate_viewsResponse_<std::allocator<void> > remove_duplicate_viewsResponse; 00182 00183 typedef boost::shared_ptr< ::vfh_recognizer_db::remove_duplicate_viewsResponse> remove_duplicate_viewsResponsePtr; 00184 typedef boost::shared_ptr< ::vfh_recognizer_db::remove_duplicate_viewsResponse const> remove_duplicate_viewsResponseConstPtr; 00185 00186 struct remove_duplicate_views 00187 { 00188 00189 typedef remove_duplicate_viewsRequest Request; 00190 typedef remove_duplicate_viewsResponse Response; 00191 Request request; 00192 Response response; 00193 00194 typedef Request RequestType; 00195 typedef Response ResponseType; 00196 }; // struct remove_duplicate_views 00197 } // namespace vfh_recognizer_db 00198 00199 namespace ros 00200 { 00201 namespace message_traits 00202 { 00203 template<class ContainerAllocator> struct IsMessage< ::vfh_recognizer_db::remove_duplicate_viewsRequest_<ContainerAllocator> > : public TrueType {}; 00204 template<class ContainerAllocator> struct IsMessage< ::vfh_recognizer_db::remove_duplicate_viewsRequest_<ContainerAllocator> const> : public TrueType {}; 00205 template<class ContainerAllocator> 00206 struct MD5Sum< ::vfh_recognizer_db::remove_duplicate_viewsRequest_<ContainerAllocator> > { 00207 static const char* value() 00208 { 00209 return "756ac673cc480e7ac7af4e69f0643534"; 00210 } 00211 00212 static const char* value(const ::vfh_recognizer_db::remove_duplicate_viewsRequest_<ContainerAllocator> &) { return value(); } 00213 static const uint64_t static_value1 = 0x756ac673cc480e7aULL; 00214 static const uint64_t static_value2 = 0xc7af4e69f0643534ULL; 00215 }; 00216 00217 template<class ContainerAllocator> 00218 struct DataType< ::vfh_recognizer_db::remove_duplicate_viewsRequest_<ContainerAllocator> > { 00219 static const char* value() 00220 { 00221 return "vfh_recognizer_db/remove_duplicate_viewsRequest"; 00222 } 00223 00224 static const char* value(const ::vfh_recognizer_db::remove_duplicate_viewsRequest_<ContainerAllocator> &) { return value(); } 00225 }; 00226 00227 template<class ContainerAllocator> 00228 struct Definition< ::vfh_recognizer_db::remove_duplicate_viewsRequest_<ContainerAllocator> > { 00229 static const char* value() 00230 { 00231 return "std_msgs/Int32 scaled_model_id\n\ 00232 std_msgs/Int32 iteration\n\ 00233 \n\ 00234 ================================================================================\n\ 00235 MSG: std_msgs/Int32\n\ 00236 int32 data\n\ 00237 "; 00238 } 00239 00240 static const char* value(const ::vfh_recognizer_db::remove_duplicate_viewsRequest_<ContainerAllocator> &) { return value(); } 00241 }; 00242 00243 template<class ContainerAllocator> struct IsFixedSize< ::vfh_recognizer_db::remove_duplicate_viewsRequest_<ContainerAllocator> > : public TrueType {}; 00244 } // namespace message_traits 00245 } // namespace ros 00246 00247 00248 namespace ros 00249 { 00250 namespace message_traits 00251 { 00252 template<class ContainerAllocator> struct IsMessage< ::vfh_recognizer_db::remove_duplicate_viewsResponse_<ContainerAllocator> > : public TrueType {}; 00253 template<class ContainerAllocator> struct IsMessage< ::vfh_recognizer_db::remove_duplicate_viewsResponse_<ContainerAllocator> const> : public TrueType {}; 00254 template<class ContainerAllocator> 00255 struct MD5Sum< ::vfh_recognizer_db::remove_duplicate_viewsResponse_<ContainerAllocator> > { 00256 static const char* value() 00257 { 00258 return "d41d8cd98f00b204e9800998ecf8427e"; 00259 } 00260 00261 static const char* value(const ::vfh_recognizer_db::remove_duplicate_viewsResponse_<ContainerAllocator> &) { return value(); } 00262 static const uint64_t static_value1 = 0xd41d8cd98f00b204ULL; 00263 static const uint64_t static_value2 = 0xe9800998ecf8427eULL; 00264 }; 00265 00266 template<class ContainerAllocator> 00267 struct DataType< ::vfh_recognizer_db::remove_duplicate_viewsResponse_<ContainerAllocator> > { 00268 static const char* value() 00269 { 00270 return "vfh_recognizer_db/remove_duplicate_viewsResponse"; 00271 } 00272 00273 static const char* value(const ::vfh_recognizer_db::remove_duplicate_viewsResponse_<ContainerAllocator> &) { return value(); } 00274 }; 00275 00276 template<class ContainerAllocator> 00277 struct Definition< ::vfh_recognizer_db::remove_duplicate_viewsResponse_<ContainerAllocator> > { 00278 static const char* value() 00279 { 00280 return "\n\ 00281 "; 00282 } 00283 00284 static const char* value(const ::vfh_recognizer_db::remove_duplicate_viewsResponse_<ContainerAllocator> &) { return value(); } 00285 }; 00286 00287 template<class ContainerAllocator> struct IsFixedSize< ::vfh_recognizer_db::remove_duplicate_viewsResponse_<ContainerAllocator> > : public TrueType {}; 00288 } // namespace message_traits 00289 } // namespace ros 00290 00291 namespace ros 00292 { 00293 namespace serialization 00294 { 00295 00296 template<class ContainerAllocator> struct Serializer< ::vfh_recognizer_db::remove_duplicate_viewsRequest_<ContainerAllocator> > 00297 { 00298 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00299 { 00300 stream.next(m.scaled_model_id); 00301 stream.next(m.iteration); 00302 } 00303 00304 ROS_DECLARE_ALLINONE_SERIALIZER; 00305 }; // struct remove_duplicate_viewsRequest_ 00306 } // namespace serialization 00307 } // namespace ros 00308 00309 00310 namespace ros 00311 { 00312 namespace serialization 00313 { 00314 00315 template<class ContainerAllocator> struct Serializer< ::vfh_recognizer_db::remove_duplicate_viewsResponse_<ContainerAllocator> > 00316 { 00317 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00318 { 00319 } 00320 00321 ROS_DECLARE_ALLINONE_SERIALIZER; 00322 }; // struct remove_duplicate_viewsResponse_ 00323 } // namespace serialization 00324 } // namespace ros 00325 00326 namespace ros 00327 { 00328 namespace service_traits 00329 { 00330 template<> 00331 struct MD5Sum<vfh_recognizer_db::remove_duplicate_views> { 00332 static const char* value() 00333 { 00334 return "756ac673cc480e7ac7af4e69f0643534"; 00335 } 00336 00337 static const char* value(const vfh_recognizer_db::remove_duplicate_views&) { return value(); } 00338 }; 00339 00340 template<> 00341 struct DataType<vfh_recognizer_db::remove_duplicate_views> { 00342 static const char* value() 00343 { 00344 return "vfh_recognizer_db/remove_duplicate_views"; 00345 } 00346 00347 static const char* value(const vfh_recognizer_db::remove_duplicate_views&) { return value(); } 00348 }; 00349 00350 template<class ContainerAllocator> 00351 struct MD5Sum<vfh_recognizer_db::remove_duplicate_viewsRequest_<ContainerAllocator> > { 00352 static const char* value() 00353 { 00354 return "756ac673cc480e7ac7af4e69f0643534"; 00355 } 00356 00357 static const char* value(const vfh_recognizer_db::remove_duplicate_viewsRequest_<ContainerAllocator> &) { return value(); } 00358 }; 00359 00360 template<class ContainerAllocator> 00361 struct DataType<vfh_recognizer_db::remove_duplicate_viewsRequest_<ContainerAllocator> > { 00362 static const char* value() 00363 { 00364 return "vfh_recognizer_db/remove_duplicate_views"; 00365 } 00366 00367 static const char* value(const vfh_recognizer_db::remove_duplicate_viewsRequest_<ContainerAllocator> &) { return value(); } 00368 }; 00369 00370 template<class ContainerAllocator> 00371 struct MD5Sum<vfh_recognizer_db::remove_duplicate_viewsResponse_<ContainerAllocator> > { 00372 static const char* value() 00373 { 00374 return "756ac673cc480e7ac7af4e69f0643534"; 00375 } 00376 00377 static const char* value(const vfh_recognizer_db::remove_duplicate_viewsResponse_<ContainerAllocator> &) { return value(); } 00378 }; 00379 00380 template<class ContainerAllocator> 00381 struct DataType<vfh_recognizer_db::remove_duplicate_viewsResponse_<ContainerAllocator> > { 00382 static const char* value() 00383 { 00384 return "vfh_recognizer_db/remove_duplicate_views"; 00385 } 00386 00387 static const char* value(const vfh_recognizer_db::remove_duplicate_viewsResponse_<ContainerAllocator> &) { return value(); } 00388 }; 00389 00390 } // namespace service_traits 00391 } // namespace ros 00392 00393 #endif // VFH_RECOGNIZER_DB_SERVICE_REMOVE_DUPLICATE_VIEWS_H 00394