$search
00001 /* Auto-generated by genmsg_cpp for file /home/rosbuild/hudson/workspace/doc-electric-simulator_gazebo/doc_stacks/2013-03-02_13-33-37.038309/simulator_gazebo/gazebo/srv/SetLinkProperties.srv */ 00002 #ifndef GAZEBO_SERVICE_SETLINKPROPERTIES_H 00003 #define GAZEBO_SERVICE_SETLINKPROPERTIES_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/Pose.h" 00020 00021 00022 00023 namespace gazebo 00024 { 00025 template <class ContainerAllocator> 00026 struct SetLinkPropertiesRequest_ { 00027 typedef SetLinkPropertiesRequest_<ContainerAllocator> Type; 00028 00029 SetLinkPropertiesRequest_() 00030 : link_name() 00031 , com() 00032 , gravity_mode(false) 00033 , mass(0.0) 00034 , ixx(0.0) 00035 , ixy(0.0) 00036 , ixz(0.0) 00037 , iyy(0.0) 00038 , iyz(0.0) 00039 , izz(0.0) 00040 { 00041 } 00042 00043 SetLinkPropertiesRequest_(const ContainerAllocator& _alloc) 00044 : link_name(_alloc) 00045 , com(_alloc) 00046 , gravity_mode(false) 00047 , mass(0.0) 00048 , ixx(0.0) 00049 , ixy(0.0) 00050 , ixz(0.0) 00051 , iyy(0.0) 00052 , iyz(0.0) 00053 , izz(0.0) 00054 { 00055 } 00056 00057 typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > _link_name_type; 00058 std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > link_name; 00059 00060 typedef ::geometry_msgs::Pose_<ContainerAllocator> _com_type; 00061 ::geometry_msgs::Pose_<ContainerAllocator> com; 00062 00063 typedef uint8_t _gravity_mode_type; 00064 uint8_t gravity_mode; 00065 00066 typedef double _mass_type; 00067 double mass; 00068 00069 typedef double _ixx_type; 00070 double ixx; 00071 00072 typedef double _ixy_type; 00073 double ixy; 00074 00075 typedef double _ixz_type; 00076 double ixz; 00077 00078 typedef double _iyy_type; 00079 double iyy; 00080 00081 typedef double _iyz_type; 00082 double iyz; 00083 00084 typedef double _izz_type; 00085 double izz; 00086 00087 00088 private: 00089 static const char* __s_getDataType_() { return "gazebo/SetLinkPropertiesRequest"; } 00090 public: 00091 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); } 00092 00093 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); } 00094 00095 private: 00096 static const char* __s_getMD5Sum_() { return "68ac74a4be01b165bc305b5ccdc45e91"; } 00097 public: 00098 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); } 00099 00100 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); } 00101 00102 private: 00103 static const char* __s_getServerMD5Sum_() { return "d534ce1b36ee99de0ffa806c3a6348f0"; } 00104 public: 00105 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); } 00106 00107 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); } 00108 00109 private: 00110 static const char* __s_getMessageDefinition_() { return "\n\ 00111 \n\ 00112 string link_name\n\ 00113 geometry_msgs/Pose com\n\ 00114 \n\ 00115 \n\ 00116 bool gravity_mode\n\ 00117 float64 mass\n\ 00118 float64 ixx\n\ 00119 float64 ixy\n\ 00120 float64 ixz\n\ 00121 float64 iyy\n\ 00122 float64 iyz\n\ 00123 float64 izz\n\ 00124 \n\ 00125 ================================================================================\n\ 00126 MSG: geometry_msgs/Pose\n\ 00127 # A representation of pose in free space, composed of postion and orientation. \n\ 00128 Point position\n\ 00129 Quaternion orientation\n\ 00130 \n\ 00131 ================================================================================\n\ 00132 MSG: geometry_msgs/Point\n\ 00133 # This contains the position of a point in free space\n\ 00134 float64 x\n\ 00135 float64 y\n\ 00136 float64 z\n\ 00137 \n\ 00138 ================================================================================\n\ 00139 MSG: geometry_msgs/Quaternion\n\ 00140 # This represents an orientation in free space in quaternion form.\n\ 00141 \n\ 00142 float64 x\n\ 00143 float64 y\n\ 00144 float64 z\n\ 00145 float64 w\n\ 00146 \n\ 00147 "; } 00148 public: 00149 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); } 00150 00151 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); } 00152 00153 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const 00154 { 00155 ros::serialization::OStream stream(write_ptr, 1000000000); 00156 ros::serialization::serialize(stream, link_name); 00157 ros::serialization::serialize(stream, com); 00158 ros::serialization::serialize(stream, gravity_mode); 00159 ros::serialization::serialize(stream, mass); 00160 ros::serialization::serialize(stream, ixx); 00161 ros::serialization::serialize(stream, ixy); 00162 ros::serialization::serialize(stream, ixz); 00163 ros::serialization::serialize(stream, iyy); 00164 ros::serialization::serialize(stream, iyz); 00165 ros::serialization::serialize(stream, izz); 00166 return stream.getData(); 00167 } 00168 00169 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr) 00170 { 00171 ros::serialization::IStream stream(read_ptr, 1000000000); 00172 ros::serialization::deserialize(stream, link_name); 00173 ros::serialization::deserialize(stream, com); 00174 ros::serialization::deserialize(stream, gravity_mode); 00175 ros::serialization::deserialize(stream, mass); 00176 ros::serialization::deserialize(stream, ixx); 00177 ros::serialization::deserialize(stream, ixy); 00178 ros::serialization::deserialize(stream, ixz); 00179 ros::serialization::deserialize(stream, iyy); 00180 ros::serialization::deserialize(stream, iyz); 00181 ros::serialization::deserialize(stream, izz); 00182 return stream.getData(); 00183 } 00184 00185 ROS_DEPRECATED virtual uint32_t serializationLength() const 00186 { 00187 uint32_t size = 0; 00188 size += ros::serialization::serializationLength(link_name); 00189 size += ros::serialization::serializationLength(com); 00190 size += ros::serialization::serializationLength(gravity_mode); 00191 size += ros::serialization::serializationLength(mass); 00192 size += ros::serialization::serializationLength(ixx); 00193 size += ros::serialization::serializationLength(ixy); 00194 size += ros::serialization::serializationLength(ixz); 00195 size += ros::serialization::serializationLength(iyy); 00196 size += ros::serialization::serializationLength(iyz); 00197 size += ros::serialization::serializationLength(izz); 00198 return size; 00199 } 00200 00201 typedef boost::shared_ptr< ::gazebo::SetLinkPropertiesRequest_<ContainerAllocator> > Ptr; 00202 typedef boost::shared_ptr< ::gazebo::SetLinkPropertiesRequest_<ContainerAllocator> const> ConstPtr; 00203 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00204 }; // struct SetLinkPropertiesRequest 00205 typedef ::gazebo::SetLinkPropertiesRequest_<std::allocator<void> > SetLinkPropertiesRequest; 00206 00207 typedef boost::shared_ptr< ::gazebo::SetLinkPropertiesRequest> SetLinkPropertiesRequestPtr; 00208 typedef boost::shared_ptr< ::gazebo::SetLinkPropertiesRequest const> SetLinkPropertiesRequestConstPtr; 00209 00210 00211 template <class ContainerAllocator> 00212 struct SetLinkPropertiesResponse_ { 00213 typedef SetLinkPropertiesResponse_<ContainerAllocator> Type; 00214 00215 SetLinkPropertiesResponse_() 00216 : success(false) 00217 , status_message() 00218 { 00219 } 00220 00221 SetLinkPropertiesResponse_(const ContainerAllocator& _alloc) 00222 : success(false) 00223 , status_message(_alloc) 00224 { 00225 } 00226 00227 typedef uint8_t _success_type; 00228 uint8_t success; 00229 00230 typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > _status_message_type; 00231 std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > status_message; 00232 00233 00234 private: 00235 static const char* __s_getDataType_() { return "gazebo/SetLinkPropertiesResponse"; } 00236 public: 00237 ROS_DEPRECATED static const std::string __s_getDataType() { return __s_getDataType_(); } 00238 00239 ROS_DEPRECATED const std::string __getDataType() const { return __s_getDataType_(); } 00240 00241 private: 00242 static const char* __s_getMD5Sum_() { return "2ec6f3eff0161f4257b808b12bc830c2"; } 00243 public: 00244 ROS_DEPRECATED static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); } 00245 00246 ROS_DEPRECATED const std::string __getMD5Sum() const { return __s_getMD5Sum_(); } 00247 00248 private: 00249 static const char* __s_getServerMD5Sum_() { return "d534ce1b36ee99de0ffa806c3a6348f0"; } 00250 public: 00251 ROS_DEPRECATED static const std::string __s_getServerMD5Sum() { return __s_getServerMD5Sum_(); } 00252 00253 ROS_DEPRECATED const std::string __getServerMD5Sum() const { return __s_getServerMD5Sum_(); } 00254 00255 private: 00256 static const char* __s_getMessageDefinition_() { return "bool success\n\ 00257 string status_message\n\ 00258 \n\ 00259 \n\ 00260 "; } 00261 public: 00262 ROS_DEPRECATED static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); } 00263 00264 ROS_DEPRECATED const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); } 00265 00266 ROS_DEPRECATED virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const 00267 { 00268 ros::serialization::OStream stream(write_ptr, 1000000000); 00269 ros::serialization::serialize(stream, success); 00270 ros::serialization::serialize(stream, status_message); 00271 return stream.getData(); 00272 } 00273 00274 ROS_DEPRECATED virtual uint8_t *deserialize(uint8_t *read_ptr) 00275 { 00276 ros::serialization::IStream stream(read_ptr, 1000000000); 00277 ros::serialization::deserialize(stream, success); 00278 ros::serialization::deserialize(stream, status_message); 00279 return stream.getData(); 00280 } 00281 00282 ROS_DEPRECATED virtual uint32_t serializationLength() const 00283 { 00284 uint32_t size = 0; 00285 size += ros::serialization::serializationLength(success); 00286 size += ros::serialization::serializationLength(status_message); 00287 return size; 00288 } 00289 00290 typedef boost::shared_ptr< ::gazebo::SetLinkPropertiesResponse_<ContainerAllocator> > Ptr; 00291 typedef boost::shared_ptr< ::gazebo::SetLinkPropertiesResponse_<ContainerAllocator> const> ConstPtr; 00292 boost::shared_ptr<std::map<std::string, std::string> > __connection_header; 00293 }; // struct SetLinkPropertiesResponse 00294 typedef ::gazebo::SetLinkPropertiesResponse_<std::allocator<void> > SetLinkPropertiesResponse; 00295 00296 typedef boost::shared_ptr< ::gazebo::SetLinkPropertiesResponse> SetLinkPropertiesResponsePtr; 00297 typedef boost::shared_ptr< ::gazebo::SetLinkPropertiesResponse const> SetLinkPropertiesResponseConstPtr; 00298 00299 struct SetLinkProperties 00300 { 00301 00302 typedef SetLinkPropertiesRequest Request; 00303 typedef SetLinkPropertiesResponse Response; 00304 Request request; 00305 Response response; 00306 00307 typedef Request RequestType; 00308 typedef Response ResponseType; 00309 }; // struct SetLinkProperties 00310 } // namespace gazebo 00311 00312 namespace ros 00313 { 00314 namespace message_traits 00315 { 00316 template<class ContainerAllocator> struct IsMessage< ::gazebo::SetLinkPropertiesRequest_<ContainerAllocator> > : public TrueType {}; 00317 template<class ContainerAllocator> struct IsMessage< ::gazebo::SetLinkPropertiesRequest_<ContainerAllocator> const> : public TrueType {}; 00318 template<class ContainerAllocator> 00319 struct MD5Sum< ::gazebo::SetLinkPropertiesRequest_<ContainerAllocator> > { 00320 static const char* value() 00321 { 00322 return "68ac74a4be01b165bc305b5ccdc45e91"; 00323 } 00324 00325 static const char* value(const ::gazebo::SetLinkPropertiesRequest_<ContainerAllocator> &) { return value(); } 00326 static const uint64_t static_value1 = 0x68ac74a4be01b165ULL; 00327 static const uint64_t static_value2 = 0xbc305b5ccdc45e91ULL; 00328 }; 00329 00330 template<class ContainerAllocator> 00331 struct DataType< ::gazebo::SetLinkPropertiesRequest_<ContainerAllocator> > { 00332 static const char* value() 00333 { 00334 return "gazebo/SetLinkPropertiesRequest"; 00335 } 00336 00337 static const char* value(const ::gazebo::SetLinkPropertiesRequest_<ContainerAllocator> &) { return value(); } 00338 }; 00339 00340 template<class ContainerAllocator> 00341 struct Definition< ::gazebo::SetLinkPropertiesRequest_<ContainerAllocator> > { 00342 static const char* value() 00343 { 00344 return "\n\ 00345 \n\ 00346 string link_name\n\ 00347 geometry_msgs/Pose com\n\ 00348 \n\ 00349 \n\ 00350 bool gravity_mode\n\ 00351 float64 mass\n\ 00352 float64 ixx\n\ 00353 float64 ixy\n\ 00354 float64 ixz\n\ 00355 float64 iyy\n\ 00356 float64 iyz\n\ 00357 float64 izz\n\ 00358 \n\ 00359 ================================================================================\n\ 00360 MSG: geometry_msgs/Pose\n\ 00361 # A representation of pose in free space, composed of postion and orientation. \n\ 00362 Point position\n\ 00363 Quaternion orientation\n\ 00364 \n\ 00365 ================================================================================\n\ 00366 MSG: geometry_msgs/Point\n\ 00367 # This contains the position of a point in free space\n\ 00368 float64 x\n\ 00369 float64 y\n\ 00370 float64 z\n\ 00371 \n\ 00372 ================================================================================\n\ 00373 MSG: geometry_msgs/Quaternion\n\ 00374 # This represents an orientation in free space in quaternion form.\n\ 00375 \n\ 00376 float64 x\n\ 00377 float64 y\n\ 00378 float64 z\n\ 00379 float64 w\n\ 00380 \n\ 00381 "; 00382 } 00383 00384 static const char* value(const ::gazebo::SetLinkPropertiesRequest_<ContainerAllocator> &) { return value(); } 00385 }; 00386 00387 } // namespace message_traits 00388 } // namespace ros 00389 00390 00391 namespace ros 00392 { 00393 namespace message_traits 00394 { 00395 template<class ContainerAllocator> struct IsMessage< ::gazebo::SetLinkPropertiesResponse_<ContainerAllocator> > : public TrueType {}; 00396 template<class ContainerAllocator> struct IsMessage< ::gazebo::SetLinkPropertiesResponse_<ContainerAllocator> const> : public TrueType {}; 00397 template<class ContainerAllocator> 00398 struct MD5Sum< ::gazebo::SetLinkPropertiesResponse_<ContainerAllocator> > { 00399 static const char* value() 00400 { 00401 return "2ec6f3eff0161f4257b808b12bc830c2"; 00402 } 00403 00404 static const char* value(const ::gazebo::SetLinkPropertiesResponse_<ContainerAllocator> &) { return value(); } 00405 static const uint64_t static_value1 = 0x2ec6f3eff0161f42ULL; 00406 static const uint64_t static_value2 = 0x57b808b12bc830c2ULL; 00407 }; 00408 00409 template<class ContainerAllocator> 00410 struct DataType< ::gazebo::SetLinkPropertiesResponse_<ContainerAllocator> > { 00411 static const char* value() 00412 { 00413 return "gazebo/SetLinkPropertiesResponse"; 00414 } 00415 00416 static const char* value(const ::gazebo::SetLinkPropertiesResponse_<ContainerAllocator> &) { return value(); } 00417 }; 00418 00419 template<class ContainerAllocator> 00420 struct Definition< ::gazebo::SetLinkPropertiesResponse_<ContainerAllocator> > { 00421 static const char* value() 00422 { 00423 return "bool success\n\ 00424 string status_message\n\ 00425 \n\ 00426 \n\ 00427 "; 00428 } 00429 00430 static const char* value(const ::gazebo::SetLinkPropertiesResponse_<ContainerAllocator> &) { return value(); } 00431 }; 00432 00433 } // namespace message_traits 00434 } // namespace ros 00435 00436 namespace ros 00437 { 00438 namespace serialization 00439 { 00440 00441 template<class ContainerAllocator> struct Serializer< ::gazebo::SetLinkPropertiesRequest_<ContainerAllocator> > 00442 { 00443 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00444 { 00445 stream.next(m.link_name); 00446 stream.next(m.com); 00447 stream.next(m.gravity_mode); 00448 stream.next(m.mass); 00449 stream.next(m.ixx); 00450 stream.next(m.ixy); 00451 stream.next(m.ixz); 00452 stream.next(m.iyy); 00453 stream.next(m.iyz); 00454 stream.next(m.izz); 00455 } 00456 00457 ROS_DECLARE_ALLINONE_SERIALIZER; 00458 }; // struct SetLinkPropertiesRequest_ 00459 } // namespace serialization 00460 } // namespace ros 00461 00462 00463 namespace ros 00464 { 00465 namespace serialization 00466 { 00467 00468 template<class ContainerAllocator> struct Serializer< ::gazebo::SetLinkPropertiesResponse_<ContainerAllocator> > 00469 { 00470 template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m) 00471 { 00472 stream.next(m.success); 00473 stream.next(m.status_message); 00474 } 00475 00476 ROS_DECLARE_ALLINONE_SERIALIZER; 00477 }; // struct SetLinkPropertiesResponse_ 00478 } // namespace serialization 00479 } // namespace ros 00480 00481 namespace ros 00482 { 00483 namespace service_traits 00484 { 00485 template<> 00486 struct MD5Sum<gazebo::SetLinkProperties> { 00487 static const char* value() 00488 { 00489 return "d534ce1b36ee99de0ffa806c3a6348f0"; 00490 } 00491 00492 static const char* value(const gazebo::SetLinkProperties&) { return value(); } 00493 }; 00494 00495 template<> 00496 struct DataType<gazebo::SetLinkProperties> { 00497 static const char* value() 00498 { 00499 return "gazebo/SetLinkProperties"; 00500 } 00501 00502 static const char* value(const gazebo::SetLinkProperties&) { return value(); } 00503 }; 00504 00505 template<class ContainerAllocator> 00506 struct MD5Sum<gazebo::SetLinkPropertiesRequest_<ContainerAllocator> > { 00507 static const char* value() 00508 { 00509 return "d534ce1b36ee99de0ffa806c3a6348f0"; 00510 } 00511 00512 static const char* value(const gazebo::SetLinkPropertiesRequest_<ContainerAllocator> &) { return value(); } 00513 }; 00514 00515 template<class ContainerAllocator> 00516 struct DataType<gazebo::SetLinkPropertiesRequest_<ContainerAllocator> > { 00517 static const char* value() 00518 { 00519 return "gazebo/SetLinkProperties"; 00520 } 00521 00522 static const char* value(const gazebo::SetLinkPropertiesRequest_<ContainerAllocator> &) { return value(); } 00523 }; 00524 00525 template<class ContainerAllocator> 00526 struct MD5Sum<gazebo::SetLinkPropertiesResponse_<ContainerAllocator> > { 00527 static const char* value() 00528 { 00529 return "d534ce1b36ee99de0ffa806c3a6348f0"; 00530 } 00531 00532 static const char* value(const gazebo::SetLinkPropertiesResponse_<ContainerAllocator> &) { return value(); } 00533 }; 00534 00535 template<class ContainerAllocator> 00536 struct DataType<gazebo::SetLinkPropertiesResponse_<ContainerAllocator> > { 00537 static const char* value() 00538 { 00539 return "gazebo/SetLinkProperties"; 00540 } 00541 00542 static const char* value(const gazebo::SetLinkPropertiesResponse_<ContainerAllocator> &) { return value(); } 00543 }; 00544 00545 } // namespace service_traits 00546 } // namespace ros 00547 00548 #endif // GAZEBO_SERVICE_SETLINKPROPERTIES_H 00549