$search
00001 /* Auto-generated by genmsg_cpp for file /home/rosbuild/hudson/workspace/doc-electric-cob_object_perception/doc_stacks/2013-03-01_14-45-40.878742/cob_object_perception/cob_object_detection_msgs/srv/BaTestEnvironment.srv */ 00002 #ifndef COB_OBJECT_DETECTION_MSGS_SERVICE_BATESTENVIRONMENT_H 00003 #define COB_OBJECT_DETECTION_MSGS_SERVICE_BATESTENVIRONMENT_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 "std_msgs/String.h" 00022 00023 namespace cob_object_detection_msgs 00024 { 00025 template <class ContainerAllocator> 00026 struct BaTestEnvironmentRequest_ { 00027 typedef BaTestEnvironmentRequest_<ContainerAllocator> Type; 00028 00029 BaTestEnvironmentRequest_() 00030 : number_points(0) 00031 , frame_view_number(0.0) 00032 , cone_points_per_plane(0.0) 00033 , limit_error_matching(0.0) 00034 , ba_kernel_param(0.0) 00035 , ba_num_iter(0) 00036 , ba_initial_mu(0.0) 00037 , ba_final_mu_factor(0.0) 00038 , ba_tau(0.0) 00039 , angle_sigma_degree(0.0) 00040 , translate_sigma_m(0.0) 00041 , obs_point_sigma_m(0.0) 00042 , world_point_sigma_m(0.0) 00043 { 00044 } 00045 00046 BaTestEnvironmentRequest_(const ContainerAllocator& _alloc) 00047 : number_points(0) 00048 , frame_view_number(0.0) 00049 , cone_points_per_plane(0.0) 00050 , limit_error_matching(0.0) 00051 , ba_kernel_param(0.0) 00052 , ba_num_iter(0) 00053 , ba_initial_mu(0.0) 00054 , ba_final_mu_factor(0.0) 00055 , ba_tau(0.0) 00056 , angle_sigma_degree(0.0) 00057 , translate_sigma_m(0.0) 00058 , obs_point_sigma_m(0.0) 00059 , world_point_sigma_m(0.0) 00060 { 00061 } 00062 00063 typedef int32_t _number_points_type; 00064 int32_t number_points; 00065 00066 typedef float _frame_view_number_type; 00067 float frame_view_number; 00068 00069 typedef float _cone_points_per_plane_type; 00070 float cone_points_per_plane; 00071 00072 typedef float _limit_error_matching_type; 00073 float limit_error_matching; 00074 00075 typedef float _ba_kernel_param_type; 00076 float ba_kernel_param; 00077 00078 typedef int32_t _ba_num_iter_type; 00079 int32_t ba_num_iter; 00080 00081 typedef float _ba_initial_mu_type; 00082 float ba_initial_mu; 00083 00084 typedef float _ba_final_mu_factor_type; 00085 float ba_final_mu_factor; 00086 00087 typedef float _ba_tau_type; 00088 float ba_tau; 00089 00090 typedef float _angle_sigma_degree_type; 00091 float angle_sigma_degree; 00092 00093 typedef float _translate_sigma_m_type; 00094 float translate_sigma_m; 00095 00096 typedef float _obs_point_sigma_m_type; 00097 float obs_point_sigma_m; 00098 00099 typedef float _world_point_sigma_m_type; 00100 float world_point_sigma_m; 00101 00102 00103 private: 00104 static const char* __s_getDataType_() { return "cob_object_detection_msgs/BaTestEnvironmentRequest"; } 00105 public: 00106 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); } 00107 00108 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); } 00109 00110 private: 00111 static const char* __s_getMD5Sum_() { return "65aeb9eaa6cbc248861e82cf7f7464c0"; } 00112 public: 00113 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); } 00114 00115 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); } 00116 00117 private: 00118 static const char* __s_getServerMD5Sum_() { return "e3abe6b136e84d507dcba74e019ba61e"; } 00119 public: 00120 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); } 00121 00122 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); } 00123 00124 private: 00125 static const char* __s_getMessageDefinition_() { return "\n\ 00126 \n\ 00127 int32 number_points\n\ 00128 float32 frame_view_number\n\ 00129 float32 cone_points_per_plane\n\ 00130 \n\ 00131 \n\ 00132 float32 limit_error_matching\n\ 00133 \n\ 00134 float32 ba_kernel_param\n\ 00135 int32 ba_num_iter\n\ 00136 float32 ba_initial_mu\n\ 00137 float32 ba_final_mu_factor\n\ 00138 float32 ba_tau\n\ 00139 \n\ 00140 float32 angle_sigma_degree\n\ 00141 float32 translate_sigma_m\n\ 00142 float32 obs_point_sigma_m\n\ 00143 float32 world_point_sigma_m\n\ 00144 \n\ 00145 \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, number_points); 00156 ros::serialization::serialize(stream, frame_view_number); 00157 ros::serialization::serialize(stream, cone_points_per_plane); 00158 ros::serialization::serialize(stream, limit_error_matching); 00159 ros::serialization::serialize(stream, ba_kernel_param); 00160 ros::serialization::serialize(stream, ba_num_iter); 00161 ros::serialization::serialize(stream, ba_initial_mu); 00162 ros::serialization::serialize(stream, ba_final_mu_factor); 00163 ros::serialization::serialize(stream, ba_tau); 00164 ros::serialization::serialize(stream, angle_sigma_degree); 00165 ros::serialization::serialize(stream, translate_sigma_m); 00166 ros::serialization::serialize(stream, obs_point_sigma_m); 00167 ros::serialization::serialize(stream, world_point_sigma_m); 00168 return stream.getData(); 00169 } 00170 00171 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr) 00172 { 00173 ros::serialization::IStream stream(read_ptr, 1000000000); 00174 ros::serialization::deserialize(stream, number_points); 00175 ros::serialization::deserialize(stream, frame_view_number); 00176 ros::serialization::deserialize(stream, cone_points_per_plane); 00177 ros::serialization::deserialize(stream, limit_error_matching); 00178 ros::serialization::deserialize(stream, ba_kernel_param); 00179 ros::serialization::deserialize(stream, ba_num_iter); 00180 ros::serialization::deserialize(stream, ba_initial_mu); 00181 ros::serialization::deserialize(stream, ba_final_mu_factor); 00182 ros::serialization::deserialize(stream, ba_tau); 00183 ros::serialization::deserialize(stream, angle_sigma_degree); 00184 ros::serialization::deserialize(stream, translate_sigma_m); 00185 ros::serialization::deserialize(stream, obs_point_sigma_m); 00186 ros::serialization::deserialize(stream, world_point_sigma_m); 00187 return stream.getData(); 00188 } 00189 00190 ROS_DEPRECATED virtual uint32_t serializationLength() const 00191 { 00192 uint32_t size = 0; 00193 size += ros::serialization::serializationLength(number_points); 00194 size += ros::serialization::serializationLength(frame_view_number); 00195 size += ros::serialization::serializationLength(cone_points_per_plane); 00196 size += ros::serialization::serializationLength(limit_error_matching); 00197 size += ros::serialization::serializationLength(ba_kernel_param); 00198 size += ros::serialization::serializationLength(ba_num_iter); 00199 size += ros::serialization::serializationLength(ba_initial_mu); 00200 size += ros::serialization::serializationLength(ba_final_mu_factor); 00201 size += ros::serialization::serializationLength(ba_tau); 00202 size += ros::serialization::serializationLength(angle_sigma_degree); 00203 size += ros::serialization::serializationLength(translate_sigma_m); 00204 size += ros::serialization::serializationLength(obs_point_sigma_m); 00205 size += ros::serialization::serializationLength(world_point_sigma_m); 00206 return size; 00207 } 00208 00209 typedef boost::shared_ptr< ::cob_object_detection_msgs::BaTestEnvironmentRequest_<ContainerAllocator> > Ptr; 00210 typedef boost::shared_ptr< ::cob_object_detection_msgs::BaTestEnvironmentRequest_<ContainerAllocator> const> ConstPtr; 00211 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00212 }; // struct BaTestEnvironmentRequest 00213 typedef ::cob_object_detection_msgs::BaTestEnvironmentRequest_<std::allocator<void> > BaTestEnvironmentRequest; 00214 00215 typedef boost::shared_ptr< ::cob_object_detection_msgs::BaTestEnvironmentRequest> BaTestEnvironmentRequestPtr; 00216 typedef boost::shared_ptr< ::cob_object_detection_msgs::BaTestEnvironmentRequest const> BaTestEnvironmentRequestConstPtr; 00217 00218 00219 template <class ContainerAllocator> 00220 struct BaTestEnvironmentResponse_ { 00221 typedef BaTestEnvironmentResponse_<ContainerAllocator> Type; 00222 00223 BaTestEnvironmentResponse_() 00224 : mean_error(0.0) 00225 , std_dev(0.0) 00226 , min_error(0.0) 00227 , max_error(0.0) 00228 , runs_count(0.0) 00229 , runs_sum(0.0) 00230 , runs_sum2(0.0) 00231 , time_duration(0.0) 00232 , observations(0) 00233 , false_matchings(0) 00234 , result() 00235 { 00236 } 00237 00238 BaTestEnvironmentResponse_(const ContainerAllocator& _alloc) 00239 : mean_error(0.0) 00240 , std_dev(0.0) 00241 , min_error(0.0) 00242 , max_error(0.0) 00243 , runs_count(0.0) 00244 , runs_sum(0.0) 00245 , runs_sum2(0.0) 00246 , time_duration(0.0) 00247 , observations(0) 00248 , false_matchings(0) 00249 , result(_alloc) 00250 { 00251 } 00252 00253 typedef float _mean_error_type; 00254 float mean_error; 00255 00256 typedef float _std_dev_type; 00257 float std_dev; 00258 00259 typedef float _min_error_type; 00260 float min_error; 00261 00262 typedef float _max_error_type; 00263 float max_error; 00264 00265 typedef float _runs_count_type; 00266 float runs_count; 00267 00268 typedef float _runs_sum_type; 00269 float runs_sum; 00270 00271 typedef float _runs_sum2_type; 00272 float runs_sum2; 00273 00274 typedef float _time_duration_type; 00275 float time_duration; 00276 00277 typedef int32_t _observations_type; 00278 int32_t observations; 00279 00280 typedef int32_t _false_matchings_type; 00281 int32_t false_matchings; 00282 00283 typedef ::std_msgs::String_<ContainerAllocator> _result_type; 00284 ::std_msgs::String_<ContainerAllocator> result; 00285 00286 00287 private: 00288 static const char* __s_getDataType_() { return "cob_object_detection_msgs/BaTestEnvironmentResponse"; } 00289 public: 00290 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); } 00291 00292 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); } 00293 00294 private: 00295 static const char* __s_getMD5Sum_() { return "73db4f13e99b7e554aa13b596abbef41"; } 00296 public: 00297 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); } 00298 00299 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); } 00300 00301 private: 00302 static const char* __s_getServerMD5Sum_() { return "e3abe6b136e84d507dcba74e019ba61e"; } 00303 public: 00304 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); } 00305 00306 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); } 00307 00308 private: 00309 static const char* __s_getMessageDefinition_() { return "float32 mean_error\n\ 00310 float32 std_dev\n\ 00311 float32 min_error\n\ 00312 float32 max_error\n\ 00313 float32 runs_count\n\ 00314 float32 runs_sum\n\ 00315 float32 runs_sum2\n\ 00316 \n\ 00317 float32 time_duration\n\ 00318 int32 observations\n\ 00319 int32 false_matchings\n\ 00320 \n\ 00321 std_msgs/String result\n\ 00322 \n\ 00323 \n\ 00324 ================================================================================\n\ 00325 MSG: std_msgs/String\n\ 00326 string data\n\ 00327 \n\ 00328 "; } 00329 public: 00330 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); } 00331 00332 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); } 00333 00334 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const 00335 { 00336 ros::serialization::OStream stream(write_ptr, 1000000000); 00337 ros::serialization::serialize(stream, mean_error); 00338 ros::serialization::serialize(stream, std_dev); 00339 ros::serialization::serialize(stream, min_error); 00340 ros::serialization::serialize(stream, max_error); 00341 ros::serialization::serialize(stream, runs_count); 00342 ros::serialization::serialize(stream, runs_sum); 00343 ros::serialization::serialize(stream, runs_sum2); 00344 ros::serialization::serialize(stream, time_duration); 00345 ros::serialization::serialize(stream, observations); 00346 ros::serialization::serialize(stream, false_matchings); 00347 ros::serialization::serialize(stream, result); 00348 return stream.getData(); 00349 } 00350 00351 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr) 00352 { 00353 ros::serialization::IStream stream(read_ptr, 1000000000); 00354 ros::serialization::deserialize(stream, mean_error); 00355 ros::serialization::deserialize(stream, std_dev); 00356 ros::serialization::deserialize(stream, min_error); 00357 ros::serialization::deserialize(stream, max_error); 00358 ros::serialization::deserialize(stream, runs_count); 00359 ros::serialization::deserialize(stream, runs_sum); 00360 ros::serialization::deserialize(stream, runs_sum2); 00361 ros::serialization::deserialize(stream, time_duration); 00362 ros::serialization::deserialize(stream, observations); 00363 ros::serialization::deserialize(stream, false_matchings); 00364 ros::serialization::deserialize(stream, result); 00365 return stream.getData(); 00366 } 00367 00368 ROS_DEPRECATED virtual uint32_t serializationLength() const 00369 { 00370 uint32_t size = 0; 00371 size += ros::serialization::serializationLength(mean_error); 00372 size += ros::serialization::serializationLength(std_dev); 00373 size += ros::serialization::serializationLength(min_error); 00374 size += ros::serialization::serializationLength(max_error); 00375 size += ros::serialization::serializationLength(runs_count); 00376 size += ros::serialization::serializationLength(runs_sum); 00377 size += ros::serialization::serializationLength(runs_sum2); 00378 size += ros::serialization::serializationLength(time_duration); 00379 size += ros::serialization::serializationLength(observations); 00380 size += ros::serialization::serializationLength(false_matchings); 00381 size += ros::serialization::serializationLength(result); 00382 return size; 00383 } 00384 00385 typedef boost::shared_ptr< ::cob_object_detection_msgs::BaTestEnvironmentResponse_<ContainerAllocator> > Ptr; 00386 typedef boost::shared_ptr< ::cob_object_detection_msgs::BaTestEnvironmentResponse_<ContainerAllocator> const> ConstPtr; 00387 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00388 }; // struct BaTestEnvironmentResponse 00389 typedef ::cob_object_detection_msgs::BaTestEnvironmentResponse_<std::allocator<void> > BaTestEnvironmentResponse; 00390 00391 typedef boost::shared_ptr< ::cob_object_detection_msgs::BaTestEnvironmentResponse> BaTestEnvironmentResponsePtr; 00392 typedef boost::shared_ptr< ::cob_object_detection_msgs::BaTestEnvironmentResponse const> BaTestEnvironmentResponseConstPtr; 00393 00394 struct BaTestEnvironment 00395 { 00396 00397 typedef BaTestEnvironmentRequest Request; 00398 typedef BaTestEnvironmentResponse Response; 00399 Request request; 00400 Response response; 00401 00402 typedef Request RequestType; 00403 typedef Response ResponseType; 00404 }; // struct BaTestEnvironment 00405 } // namespace cob_object_detection_msgs 00406 00407 namespace ros 00408 { 00409 namespace message_traits 00410 { 00411 template<class ContainerAllocator> struct IsMessage< ::cob_object_detection_msgs::BaTestEnvironmentRequest_<ContainerAllocator> > : public TrueType {}; 00412 template<class ContainerAllocator> struct IsMessage< ::cob_object_detection_msgs::BaTestEnvironmentRequest_<ContainerAllocator> const> : public TrueType {}; 00413 template<class ContainerAllocator> 00414 struct MD5Sum< ::cob_object_detection_msgs::BaTestEnvironmentRequest_<ContainerAllocator> > { 00415 static const char* value() 00416 { 00417 return "65aeb9eaa6cbc248861e82cf7f7464c0"; 00418 } 00419 00420 static const char* value(const ::cob_object_detection_msgs::BaTestEnvironmentRequest_<ContainerAllocator> &) { return value(); } 00421 static const uint64_t static_value1 = 0x65aeb9eaa6cbc248ULL; 00422 static const uint64_t static_value2 = 0x861e82cf7f7464c0ULL; 00423 }; 00424 00425 template<class ContainerAllocator> 00426 struct DataType< ::cob_object_detection_msgs::BaTestEnvironmentRequest_<ContainerAllocator> > { 00427 static const char* value() 00428 { 00429 return "cob_object_detection_msgs/BaTestEnvironmentRequest"; 00430 } 00431 00432 static const char* value(const ::cob_object_detection_msgs::BaTestEnvironmentRequest_<ContainerAllocator> &) { return value(); } 00433 }; 00434 00435 template<class ContainerAllocator> 00436 struct Definition< ::cob_object_detection_msgs::BaTestEnvironmentRequest_<ContainerAllocator> > { 00437 static const char* value() 00438 { 00439 return "\n\ 00440 \n\ 00441 int32 number_points\n\ 00442 float32 frame_view_number\n\ 00443 float32 cone_points_per_plane\n\ 00444 \n\ 00445 \n\ 00446 float32 limit_error_matching\n\ 00447 \n\ 00448 float32 ba_kernel_param\n\ 00449 int32 ba_num_iter\n\ 00450 float32 ba_initial_mu\n\ 00451 float32 ba_final_mu_factor\n\ 00452 float32 ba_tau\n\ 00453 \n\ 00454 float32 angle_sigma_degree\n\ 00455 float32 translate_sigma_m\n\ 00456 float32 obs_point_sigma_m\n\ 00457 float32 world_point_sigma_m\n\ 00458 \n\ 00459 \n\ 00460 "; 00461 } 00462 00463 static const char* value(const ::cob_object_detection_msgs::BaTestEnvironmentRequest_<ContainerAllocator> &) { return value(); } 00464 }; 00465 00466 template<class ContainerAllocator> struct IsFixedSize< ::cob_object_detection_msgs::BaTestEnvironmentRequest_<ContainerAllocator> > : public TrueType {}; 00467 } // namespace message_traits 00468 } // namespace ros 00469 00470 00471 namespace ros 00472 { 00473 namespace message_traits 00474 { 00475 template<class ContainerAllocator> struct IsMessage< ::cob_object_detection_msgs::BaTestEnvironmentResponse_<ContainerAllocator> > : public TrueType {}; 00476 template<class ContainerAllocator> struct IsMessage< ::cob_object_detection_msgs::BaTestEnvironmentResponse_<ContainerAllocator> const> : public TrueType {}; 00477 template<class ContainerAllocator> 00478 struct MD5Sum< ::cob_object_detection_msgs::BaTestEnvironmentResponse_<ContainerAllocator> > { 00479 static const char* value() 00480 { 00481 return "73db4f13e99b7e554aa13b596abbef41"; 00482 } 00483 00484 static const char* value(const ::cob_object_detection_msgs::BaTestEnvironmentResponse_<ContainerAllocator> &) { return value(); } 00485 static const uint64_t static_value1 = 0x73db4f13e99b7e55ULL; 00486 static const uint64_t static_value2 = 0x4aa13b596abbef41ULL; 00487 }; 00488 00489 template<class ContainerAllocator> 00490 struct DataType< ::cob_object_detection_msgs::BaTestEnvironmentResponse_<ContainerAllocator> > { 00491 static const char* value() 00492 { 00493 return "cob_object_detection_msgs/BaTestEnvironmentResponse"; 00494 } 00495 00496 static const char* value(const ::cob_object_detection_msgs::BaTestEnvironmentResponse_<ContainerAllocator> &) { return value(); } 00497 }; 00498 00499 template<class ContainerAllocator> 00500 struct Definition< ::cob_object_detection_msgs::BaTestEnvironmentResponse_<ContainerAllocator> > { 00501 static const char* value() 00502 { 00503 return "float32 mean_error\n\ 00504 float32 std_dev\n\ 00505 float32 min_error\n\ 00506 float32 max_error\n\ 00507 float32 runs_count\n\ 00508 float32 runs_sum\n\ 00509 float32 runs_sum2\n\ 00510 \n\ 00511 float32 time_duration\n\ 00512 int32 observations\n\ 00513 int32 false_matchings\n\ 00514 \n\ 00515 std_msgs/String result\n\ 00516 \n\ 00517 \n\ 00518 ================================================================================\n\ 00519 MSG: std_msgs/String\n\ 00520 string data\n\ 00521 \n\ 00522 "; 00523 } 00524 00525 static const char* value(const ::cob_object_detection_msgs::BaTestEnvironmentResponse_<ContainerAllocator> &) { return value(); } 00526 }; 00527 00528 } // namespace message_traits 00529 } // namespace ros 00530 00531 namespace ros 00532 { 00533 namespace serialization 00534 { 00535 00536 template<class ContainerAllocator> struct Serializer< ::cob_object_detection_msgs::BaTestEnvironmentRequest_<ContainerAllocator> > 00537 { 00538 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00539 { 00540 stream.next(m.number_points); 00541 stream.next(m.frame_view_number); 00542 stream.next(m.cone_points_per_plane); 00543 stream.next(m.limit_error_matching); 00544 stream.next(m.ba_kernel_param); 00545 stream.next(m.ba_num_iter); 00546 stream.next(m.ba_initial_mu); 00547 stream.next(m.ba_final_mu_factor); 00548 stream.next(m.ba_tau); 00549 stream.next(m.angle_sigma_degree); 00550 stream.next(m.translate_sigma_m); 00551 stream.next(m.obs_point_sigma_m); 00552 stream.next(m.world_point_sigma_m); 00553 } 00554 00555 ROS_DECLARE_ALLINONE_SERIALIZER; 00556 }; // struct BaTestEnvironmentRequest_ 00557 } // namespace serialization 00558 } // namespace ros 00559 00560 00561 namespace ros 00562 { 00563 namespace serialization 00564 { 00565 00566 template<class ContainerAllocator> struct Serializer< ::cob_object_detection_msgs::BaTestEnvironmentResponse_<ContainerAllocator> > 00567 { 00568 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00569 { 00570 stream.next(m.mean_error); 00571 stream.next(m.std_dev); 00572 stream.next(m.min_error); 00573 stream.next(m.max_error); 00574 stream.next(m.runs_count); 00575 stream.next(m.runs_sum); 00576 stream.next(m.runs_sum2); 00577 stream.next(m.time_duration); 00578 stream.next(m.observations); 00579 stream.next(m.false_matchings); 00580 stream.next(m.result); 00581 } 00582 00583 ROS_DECLARE_ALLINONE_SERIALIZER; 00584 }; // struct BaTestEnvironmentResponse_ 00585 } // namespace serialization 00586 } // namespace ros 00587 00588 namespace ros 00589 { 00590 namespace service_traits 00591 { 00592 template<> 00593 struct MD5Sum<cob_object_detection_msgs::BaTestEnvironment> { 00594 static const char* value() 00595 { 00596 return "e3abe6b136e84d507dcba74e019ba61e"; 00597 } 00598 00599 static const char* value(const cob_object_detection_msgs::BaTestEnvironment&) { return value(); } 00600 }; 00601 00602 template<> 00603 struct DataType<cob_object_detection_msgs::BaTestEnvironment> { 00604 static const char* value() 00605 { 00606 return "cob_object_detection_msgs/BaTestEnvironment"; 00607 } 00608 00609 static const char* value(const cob_object_detection_msgs::BaTestEnvironment&) { return value(); } 00610 }; 00611 00612 template<class ContainerAllocator> 00613 struct MD5Sum<cob_object_detection_msgs::BaTestEnvironmentRequest_<ContainerAllocator> > { 00614 static const char* value() 00615 { 00616 return "e3abe6b136e84d507dcba74e019ba61e"; 00617 } 00618 00619 static const char* value(const cob_object_detection_msgs::BaTestEnvironmentRequest_<ContainerAllocator> &) { return value(); } 00620 }; 00621 00622 template<class ContainerAllocator> 00623 struct DataType<cob_object_detection_msgs::BaTestEnvironmentRequest_<ContainerAllocator> > { 00624 static const char* value() 00625 { 00626 return "cob_object_detection_msgs/BaTestEnvironment"; 00627 } 00628 00629 static const char* value(const cob_object_detection_msgs::BaTestEnvironmentRequest_<ContainerAllocator> &) { return value(); } 00630 }; 00631 00632 template<class ContainerAllocator> 00633 struct MD5Sum<cob_object_detection_msgs::BaTestEnvironmentResponse_<ContainerAllocator> > { 00634 static const char* value() 00635 { 00636 return "e3abe6b136e84d507dcba74e019ba61e"; 00637 } 00638 00639 static const char* value(const cob_object_detection_msgs::BaTestEnvironmentResponse_<ContainerAllocator> &) { return value(); } 00640 }; 00641 00642 template<class ContainerAllocator> 00643 struct DataType<cob_object_detection_msgs::BaTestEnvironmentResponse_<ContainerAllocator> > { 00644 static const char* value() 00645 { 00646 return "cob_object_detection_msgs/BaTestEnvironment"; 00647 } 00648 00649 static const char* value(const cob_object_detection_msgs::BaTestEnvironmentResponse_<ContainerAllocator> &) { return value(); } 00650 }; 00651 00652 } // namespace service_traits 00653 } // namespace ros 00654 00655 #endif // COB_OBJECT_DETECTION_MSGS_SERVICE_BATESTENVIRONMENT_H 00656