SetLinkProperties.h
Go to the documentation of this file.
00001 /* Auto-generated by genmsg_cpp for file /home/rosbuild/hudson/workspace/doc-fuerte-simulator_gazebo/doc_stacks/2014-01-05_11-32-34.493080/simulator_gazebo/gazebo_msgs/srv/SetLinkProperties.srv */
00002 #ifndef GAZEBO_MSGS_SERVICE_SETLINKPROPERTIES_H
00003 #define GAZEBO_MSGS_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_msgs
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   typedef boost::shared_ptr< ::gazebo_msgs::SetLinkPropertiesRequest_<ContainerAllocator> > Ptr;
00089   typedef boost::shared_ptr< ::gazebo_msgs::SetLinkPropertiesRequest_<ContainerAllocator>  const> ConstPtr;
00090   boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00091 }; // struct SetLinkPropertiesRequest
00092 typedef  ::gazebo_msgs::SetLinkPropertiesRequest_<std::allocator<void> > SetLinkPropertiesRequest;
00093 
00094 typedef boost::shared_ptr< ::gazebo_msgs::SetLinkPropertiesRequest> SetLinkPropertiesRequestPtr;
00095 typedef boost::shared_ptr< ::gazebo_msgs::SetLinkPropertiesRequest const> SetLinkPropertiesRequestConstPtr;
00096 
00097 
00098 template <class ContainerAllocator>
00099 struct SetLinkPropertiesResponse_ {
00100   typedef SetLinkPropertiesResponse_<ContainerAllocator> Type;
00101 
00102   SetLinkPropertiesResponse_()
00103   : success(false)
00104   , status_message()
00105   {
00106   }
00107 
00108   SetLinkPropertiesResponse_(const ContainerAllocator& _alloc)
00109   : success(false)
00110   , status_message(_alloc)
00111   {
00112   }
00113 
00114   typedef uint8_t _success_type;
00115   uint8_t success;
00116 
00117   typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other >  _status_message_type;
00118   std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other >  status_message;
00119 
00120 
00121   typedef boost::shared_ptr< ::gazebo_msgs::SetLinkPropertiesResponse_<ContainerAllocator> > Ptr;
00122   typedef boost::shared_ptr< ::gazebo_msgs::SetLinkPropertiesResponse_<ContainerAllocator>  const> ConstPtr;
00123   boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00124 }; // struct SetLinkPropertiesResponse
00125 typedef  ::gazebo_msgs::SetLinkPropertiesResponse_<std::allocator<void> > SetLinkPropertiesResponse;
00126 
00127 typedef boost::shared_ptr< ::gazebo_msgs::SetLinkPropertiesResponse> SetLinkPropertiesResponsePtr;
00128 typedef boost::shared_ptr< ::gazebo_msgs::SetLinkPropertiesResponse const> SetLinkPropertiesResponseConstPtr;
00129 
00130 struct SetLinkProperties
00131 {
00132 
00133 typedef SetLinkPropertiesRequest Request;
00134 typedef SetLinkPropertiesResponse Response;
00135 Request request;
00136 Response response;
00137 
00138 typedef Request RequestType;
00139 typedef Response ResponseType;
00140 }; // struct SetLinkProperties
00141 } // namespace gazebo_msgs
00142 
00143 namespace ros
00144 {
00145 namespace message_traits
00146 {
00147 template<class ContainerAllocator> struct IsMessage< ::gazebo_msgs::SetLinkPropertiesRequest_<ContainerAllocator> > : public TrueType {};
00148 template<class ContainerAllocator> struct IsMessage< ::gazebo_msgs::SetLinkPropertiesRequest_<ContainerAllocator>  const> : public TrueType {};
00149 template<class ContainerAllocator>
00150 struct MD5Sum< ::gazebo_msgs::SetLinkPropertiesRequest_<ContainerAllocator> > {
00151   static const char* value() 
00152   {
00153     return "68ac74a4be01b165bc305b5ccdc45e91";
00154   }
00155 
00156   static const char* value(const  ::gazebo_msgs::SetLinkPropertiesRequest_<ContainerAllocator> &) { return value(); } 
00157   static const uint64_t static_value1 = 0x68ac74a4be01b165ULL;
00158   static const uint64_t static_value2 = 0xbc305b5ccdc45e91ULL;
00159 };
00160 
00161 template<class ContainerAllocator>
00162 struct DataType< ::gazebo_msgs::SetLinkPropertiesRequest_<ContainerAllocator> > {
00163   static const char* value() 
00164   {
00165     return "gazebo_msgs/SetLinkPropertiesRequest";
00166   }
00167 
00168   static const char* value(const  ::gazebo_msgs::SetLinkPropertiesRequest_<ContainerAllocator> &) { return value(); } 
00169 };
00170 
00171 template<class ContainerAllocator>
00172 struct Definition< ::gazebo_msgs::SetLinkPropertiesRequest_<ContainerAllocator> > {
00173   static const char* value() 
00174   {
00175     return "string link_name\n\
00176 \n\
00177 geometry_msgs/Pose com\n\
00178 \n\
00179 \n\
00180 bool gravity_mode\n\
00181 float64 mass\n\
00182 float64 ixx\n\
00183 float64 ixy\n\
00184 float64 ixz\n\
00185 float64 iyy\n\
00186 float64 iyz\n\
00187 float64 izz\n\
00188 \n\
00189 ================================================================================\n\
00190 MSG: geometry_msgs/Pose\n\
00191 # A representation of pose in free space, composed of postion and orientation. \n\
00192 Point position\n\
00193 Quaternion orientation\n\
00194 \n\
00195 ================================================================================\n\
00196 MSG: geometry_msgs/Point\n\
00197 # This contains the position of a point in free space\n\
00198 float64 x\n\
00199 float64 y\n\
00200 float64 z\n\
00201 \n\
00202 ================================================================================\n\
00203 MSG: geometry_msgs/Quaternion\n\
00204 # This represents an orientation in free space in quaternion form.\n\
00205 \n\
00206 float64 x\n\
00207 float64 y\n\
00208 float64 z\n\
00209 float64 w\n\
00210 \n\
00211 ";
00212   }
00213 
00214   static const char* value(const  ::gazebo_msgs::SetLinkPropertiesRequest_<ContainerAllocator> &) { return value(); } 
00215 };
00216 
00217 } // namespace message_traits
00218 } // namespace ros
00219 
00220 
00221 namespace ros
00222 {
00223 namespace message_traits
00224 {
00225 template<class ContainerAllocator> struct IsMessage< ::gazebo_msgs::SetLinkPropertiesResponse_<ContainerAllocator> > : public TrueType {};
00226 template<class ContainerAllocator> struct IsMessage< ::gazebo_msgs::SetLinkPropertiesResponse_<ContainerAllocator>  const> : public TrueType {};
00227 template<class ContainerAllocator>
00228 struct MD5Sum< ::gazebo_msgs::SetLinkPropertiesResponse_<ContainerAllocator> > {
00229   static const char* value() 
00230   {
00231     return "2ec6f3eff0161f4257b808b12bc830c2";
00232   }
00233 
00234   static const char* value(const  ::gazebo_msgs::SetLinkPropertiesResponse_<ContainerAllocator> &) { return value(); } 
00235   static const uint64_t static_value1 = 0x2ec6f3eff0161f42ULL;
00236   static const uint64_t static_value2 = 0x57b808b12bc830c2ULL;
00237 };
00238 
00239 template<class ContainerAllocator>
00240 struct DataType< ::gazebo_msgs::SetLinkPropertiesResponse_<ContainerAllocator> > {
00241   static const char* value() 
00242   {
00243     return "gazebo_msgs/SetLinkPropertiesResponse";
00244   }
00245 
00246   static const char* value(const  ::gazebo_msgs::SetLinkPropertiesResponse_<ContainerAllocator> &) { return value(); } 
00247 };
00248 
00249 template<class ContainerAllocator>
00250 struct Definition< ::gazebo_msgs::SetLinkPropertiesResponse_<ContainerAllocator> > {
00251   static const char* value() 
00252   {
00253     return "bool success\n\
00254 string status_message\n\
00255 \n\
00256 \n\
00257 ";
00258   }
00259 
00260   static const char* value(const  ::gazebo_msgs::SetLinkPropertiesResponse_<ContainerAllocator> &) { return value(); } 
00261 };
00262 
00263 } // namespace message_traits
00264 } // namespace ros
00265 
00266 namespace ros
00267 {
00268 namespace serialization
00269 {
00270 
00271 template<class ContainerAllocator> struct Serializer< ::gazebo_msgs::SetLinkPropertiesRequest_<ContainerAllocator> >
00272 {
00273   template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00274   {
00275     stream.next(m.link_name);
00276     stream.next(m.com);
00277     stream.next(m.gravity_mode);
00278     stream.next(m.mass);
00279     stream.next(m.ixx);
00280     stream.next(m.ixy);
00281     stream.next(m.ixz);
00282     stream.next(m.iyy);
00283     stream.next(m.iyz);
00284     stream.next(m.izz);
00285   }
00286 
00287   ROS_DECLARE_ALLINONE_SERIALIZER;
00288 }; // struct SetLinkPropertiesRequest_
00289 } // namespace serialization
00290 } // namespace ros
00291 
00292 
00293 namespace ros
00294 {
00295 namespace serialization
00296 {
00297 
00298 template<class ContainerAllocator> struct Serializer< ::gazebo_msgs::SetLinkPropertiesResponse_<ContainerAllocator> >
00299 {
00300   template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00301   {
00302     stream.next(m.success);
00303     stream.next(m.status_message);
00304   }
00305 
00306   ROS_DECLARE_ALLINONE_SERIALIZER;
00307 }; // struct SetLinkPropertiesResponse_
00308 } // namespace serialization
00309 } // namespace ros
00310 
00311 namespace ros
00312 {
00313 namespace service_traits
00314 {
00315 template<>
00316 struct MD5Sum<gazebo_msgs::SetLinkProperties> {
00317   static const char* value() 
00318   {
00319     return "d534ce1b36ee99de0ffa806c3a6348f0";
00320   }
00321 
00322   static const char* value(const gazebo_msgs::SetLinkProperties&) { return value(); } 
00323 };
00324 
00325 template<>
00326 struct DataType<gazebo_msgs::SetLinkProperties> {
00327   static const char* value() 
00328   {
00329     return "gazebo_msgs/SetLinkProperties";
00330   }
00331 
00332   static const char* value(const gazebo_msgs::SetLinkProperties&) { return value(); } 
00333 };
00334 
00335 template<class ContainerAllocator>
00336 struct MD5Sum<gazebo_msgs::SetLinkPropertiesRequest_<ContainerAllocator> > {
00337   static const char* value() 
00338   {
00339     return "d534ce1b36ee99de0ffa806c3a6348f0";
00340   }
00341 
00342   static const char* value(const gazebo_msgs::SetLinkPropertiesRequest_<ContainerAllocator> &) { return value(); } 
00343 };
00344 
00345 template<class ContainerAllocator>
00346 struct DataType<gazebo_msgs::SetLinkPropertiesRequest_<ContainerAllocator> > {
00347   static const char* value() 
00348   {
00349     return "gazebo_msgs/SetLinkProperties";
00350   }
00351 
00352   static const char* value(const gazebo_msgs::SetLinkPropertiesRequest_<ContainerAllocator> &) { return value(); } 
00353 };
00354 
00355 template<class ContainerAllocator>
00356 struct MD5Sum<gazebo_msgs::SetLinkPropertiesResponse_<ContainerAllocator> > {
00357   static const char* value() 
00358   {
00359     return "d534ce1b36ee99de0ffa806c3a6348f0";
00360   }
00361 
00362   static const char* value(const gazebo_msgs::SetLinkPropertiesResponse_<ContainerAllocator> &) { return value(); } 
00363 };
00364 
00365 template<class ContainerAllocator>
00366 struct DataType<gazebo_msgs::SetLinkPropertiesResponse_<ContainerAllocator> > {
00367   static const char* value() 
00368   {
00369     return "gazebo_msgs/SetLinkProperties";
00370   }
00371 
00372   static const char* value(const gazebo_msgs::SetLinkPropertiesResponse_<ContainerAllocator> &) { return value(); } 
00373 };
00374 
00375 } // namespace service_traits
00376 } // namespace ros
00377 
00378 #endif // GAZEBO_MSGS_SERVICE_SETLINKPROPERTIES_H
00379 


gazebo_msgs
Author(s): John Hsu
autogenerated on Sun Jan 5 2014 11:34:32