SetPhysicsProperties.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/SetPhysicsProperties.srv */
00002 #ifndef GAZEBO_MSGS_SERVICE_SETPHYSICSPROPERTIES_H
00003 #define GAZEBO_MSGS_SERVICE_SETPHYSICSPROPERTIES_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/Vector3.h"
00020 #include "gazebo_msgs/ODEPhysics.h"
00021 
00022 
00023 
00024 namespace gazebo_msgs
00025 {
00026 template <class ContainerAllocator>
00027 struct SetPhysicsPropertiesRequest_ {
00028   typedef SetPhysicsPropertiesRequest_<ContainerAllocator> Type;
00029 
00030   SetPhysicsPropertiesRequest_()
00031   : time_step(0.0)
00032   , max_update_rate(0.0)
00033   , gravity()
00034   , ode_config()
00035   {
00036   }
00037 
00038   SetPhysicsPropertiesRequest_(const ContainerAllocator& _alloc)
00039   : time_step(0.0)
00040   , max_update_rate(0.0)
00041   , gravity(_alloc)
00042   , ode_config(_alloc)
00043   {
00044   }
00045 
00046   typedef double _time_step_type;
00047   double time_step;
00048 
00049   typedef double _max_update_rate_type;
00050   double max_update_rate;
00051 
00052   typedef  ::geometry_msgs::Vector3_<ContainerAllocator>  _gravity_type;
00053    ::geometry_msgs::Vector3_<ContainerAllocator>  gravity;
00054 
00055   typedef  ::gazebo_msgs::ODEPhysics_<ContainerAllocator>  _ode_config_type;
00056    ::gazebo_msgs::ODEPhysics_<ContainerAllocator>  ode_config;
00057 
00058 
00059   typedef boost::shared_ptr< ::gazebo_msgs::SetPhysicsPropertiesRequest_<ContainerAllocator> > Ptr;
00060   typedef boost::shared_ptr< ::gazebo_msgs::SetPhysicsPropertiesRequest_<ContainerAllocator>  const> ConstPtr;
00061   boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00062 }; // struct SetPhysicsPropertiesRequest
00063 typedef  ::gazebo_msgs::SetPhysicsPropertiesRequest_<std::allocator<void> > SetPhysicsPropertiesRequest;
00064 
00065 typedef boost::shared_ptr< ::gazebo_msgs::SetPhysicsPropertiesRequest> SetPhysicsPropertiesRequestPtr;
00066 typedef boost::shared_ptr< ::gazebo_msgs::SetPhysicsPropertiesRequest const> SetPhysicsPropertiesRequestConstPtr;
00067 
00068 
00069 template <class ContainerAllocator>
00070 struct SetPhysicsPropertiesResponse_ {
00071   typedef SetPhysicsPropertiesResponse_<ContainerAllocator> Type;
00072 
00073   SetPhysicsPropertiesResponse_()
00074   : success(false)
00075   , status_message()
00076   {
00077   }
00078 
00079   SetPhysicsPropertiesResponse_(const ContainerAllocator& _alloc)
00080   : success(false)
00081   , status_message(_alloc)
00082   {
00083   }
00084 
00085   typedef uint8_t _success_type;
00086   uint8_t success;
00087 
00088   typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other >  _status_message_type;
00089   std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other >  status_message;
00090 
00091 
00092   typedef boost::shared_ptr< ::gazebo_msgs::SetPhysicsPropertiesResponse_<ContainerAllocator> > Ptr;
00093   typedef boost::shared_ptr< ::gazebo_msgs::SetPhysicsPropertiesResponse_<ContainerAllocator>  const> ConstPtr;
00094   boost::shared_ptr<std::map<std::string, std::string> > __connection_header;
00095 }; // struct SetPhysicsPropertiesResponse
00096 typedef  ::gazebo_msgs::SetPhysicsPropertiesResponse_<std::allocator<void> > SetPhysicsPropertiesResponse;
00097 
00098 typedef boost::shared_ptr< ::gazebo_msgs::SetPhysicsPropertiesResponse> SetPhysicsPropertiesResponsePtr;
00099 typedef boost::shared_ptr< ::gazebo_msgs::SetPhysicsPropertiesResponse const> SetPhysicsPropertiesResponseConstPtr;
00100 
00101 struct SetPhysicsProperties
00102 {
00103 
00104 typedef SetPhysicsPropertiesRequest Request;
00105 typedef SetPhysicsPropertiesResponse Response;
00106 Request request;
00107 Response response;
00108 
00109 typedef Request RequestType;
00110 typedef Response ResponseType;
00111 }; // struct SetPhysicsProperties
00112 } // namespace gazebo_msgs
00113 
00114 namespace ros
00115 {
00116 namespace message_traits
00117 {
00118 template<class ContainerAllocator> struct IsMessage< ::gazebo_msgs::SetPhysicsPropertiesRequest_<ContainerAllocator> > : public TrueType {};
00119 template<class ContainerAllocator> struct IsMessage< ::gazebo_msgs::SetPhysicsPropertiesRequest_<ContainerAllocator>  const> : public TrueType {};
00120 template<class ContainerAllocator>
00121 struct MD5Sum< ::gazebo_msgs::SetPhysicsPropertiesRequest_<ContainerAllocator> > {
00122   static const char* value() 
00123   {
00124     return "abd9f82732b52b92e9d6bb36e6a82452";
00125   }
00126 
00127   static const char* value(const  ::gazebo_msgs::SetPhysicsPropertiesRequest_<ContainerAllocator> &) { return value(); } 
00128   static const uint64_t static_value1 = 0xabd9f82732b52b92ULL;
00129   static const uint64_t static_value2 = 0xe9d6bb36e6a82452ULL;
00130 };
00131 
00132 template<class ContainerAllocator>
00133 struct DataType< ::gazebo_msgs::SetPhysicsPropertiesRequest_<ContainerAllocator> > {
00134   static const char* value() 
00135   {
00136     return "gazebo_msgs/SetPhysicsPropertiesRequest";
00137   }
00138 
00139   static const char* value(const  ::gazebo_msgs::SetPhysicsPropertiesRequest_<ContainerAllocator> &) { return value(); } 
00140 };
00141 
00142 template<class ContainerAllocator>
00143 struct Definition< ::gazebo_msgs::SetPhysicsPropertiesRequest_<ContainerAllocator> > {
00144   static const char* value() 
00145   {
00146     return "\n\
00147 float64 time_step\n\
00148 float64 max_update_rate\n\
00149 geometry_msgs/Vector3 gravity\n\
00150 gazebo_msgs/ODEPhysics ode_config\n\
00151 \n\
00152 ================================================================================\n\
00153 MSG: geometry_msgs/Vector3\n\
00154 # This represents a vector in free space. \n\
00155 \n\
00156 float64 x\n\
00157 float64 y\n\
00158 float64 z\n\
00159 ================================================================================\n\
00160 MSG: gazebo_msgs/ODEPhysics\n\
00161 bool auto_disable_bodies           # enable auto disabling of bodies, default false\n\
00162 uint32 sor_pgs_precon_iters        # preconditioning inner iterations when uisng projected Gauss Seidel\n\
00163 uint32 sor_pgs_iters               # inner iterations when uisng projected Gauss Seidel\n\
00164 float64 sor_pgs_w                  # relaxation parameter when using projected Gauss Seidel, 1 = no relaxation\n\
00165 float64 sor_pgs_rms_error_tol      # rms error tolerance before stopping inner iterations\n\
00166 float64 contact_surface_layer      # contact \"dead-band\" width\n\
00167 float64 contact_max_correcting_vel # contact maximum correction velocity\n\
00168 float64 cfm                        # global constraint force mixing\n\
00169 float64 erp                        # global error reduction parameter\n\
00170 uint32 max_contacts                # maximum contact joints between two geoms\n\
00171 \n\
00172 ";
00173   }
00174 
00175   static const char* value(const  ::gazebo_msgs::SetPhysicsPropertiesRequest_<ContainerAllocator> &) { return value(); } 
00176 };
00177 
00178 template<class ContainerAllocator> struct IsFixedSize< ::gazebo_msgs::SetPhysicsPropertiesRequest_<ContainerAllocator> > : public TrueType {};
00179 } // namespace message_traits
00180 } // namespace ros
00181 
00182 
00183 namespace ros
00184 {
00185 namespace message_traits
00186 {
00187 template<class ContainerAllocator> struct IsMessage< ::gazebo_msgs::SetPhysicsPropertiesResponse_<ContainerAllocator> > : public TrueType {};
00188 template<class ContainerAllocator> struct IsMessage< ::gazebo_msgs::SetPhysicsPropertiesResponse_<ContainerAllocator>  const> : public TrueType {};
00189 template<class ContainerAllocator>
00190 struct MD5Sum< ::gazebo_msgs::SetPhysicsPropertiesResponse_<ContainerAllocator> > {
00191   static const char* value() 
00192   {
00193     return "2ec6f3eff0161f4257b808b12bc830c2";
00194   }
00195 
00196   static const char* value(const  ::gazebo_msgs::SetPhysicsPropertiesResponse_<ContainerAllocator> &) { return value(); } 
00197   static const uint64_t static_value1 = 0x2ec6f3eff0161f42ULL;
00198   static const uint64_t static_value2 = 0x57b808b12bc830c2ULL;
00199 };
00200 
00201 template<class ContainerAllocator>
00202 struct DataType< ::gazebo_msgs::SetPhysicsPropertiesResponse_<ContainerAllocator> > {
00203   static const char* value() 
00204   {
00205     return "gazebo_msgs/SetPhysicsPropertiesResponse";
00206   }
00207 
00208   static const char* value(const  ::gazebo_msgs::SetPhysicsPropertiesResponse_<ContainerAllocator> &) { return value(); } 
00209 };
00210 
00211 template<class ContainerAllocator>
00212 struct Definition< ::gazebo_msgs::SetPhysicsPropertiesResponse_<ContainerAllocator> > {
00213   static const char* value() 
00214   {
00215     return "bool success\n\
00216 string status_message\n\
00217 \n\
00218 \n\
00219 ";
00220   }
00221 
00222   static const char* value(const  ::gazebo_msgs::SetPhysicsPropertiesResponse_<ContainerAllocator> &) { return value(); } 
00223 };
00224 
00225 } // namespace message_traits
00226 } // namespace ros
00227 
00228 namespace ros
00229 {
00230 namespace serialization
00231 {
00232 
00233 template<class ContainerAllocator> struct Serializer< ::gazebo_msgs::SetPhysicsPropertiesRequest_<ContainerAllocator> >
00234 {
00235   template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00236   {
00237     stream.next(m.time_step);
00238     stream.next(m.max_update_rate);
00239     stream.next(m.gravity);
00240     stream.next(m.ode_config);
00241   }
00242 
00243   ROS_DECLARE_ALLINONE_SERIALIZER;
00244 }; // struct SetPhysicsPropertiesRequest_
00245 } // namespace serialization
00246 } // namespace ros
00247 
00248 
00249 namespace ros
00250 {
00251 namespace serialization
00252 {
00253 
00254 template<class ContainerAllocator> struct Serializer< ::gazebo_msgs::SetPhysicsPropertiesResponse_<ContainerAllocator> >
00255 {
00256   template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
00257   {
00258     stream.next(m.success);
00259     stream.next(m.status_message);
00260   }
00261 
00262   ROS_DECLARE_ALLINONE_SERIALIZER;
00263 }; // struct SetPhysicsPropertiesResponse_
00264 } // namespace serialization
00265 } // namespace ros
00266 
00267 namespace ros
00268 {
00269 namespace service_traits
00270 {
00271 template<>
00272 struct MD5Sum<gazebo_msgs::SetPhysicsProperties> {
00273   static const char* value() 
00274   {
00275     return "97e2057080558ce4730434b5fae75c91";
00276   }
00277 
00278   static const char* value(const gazebo_msgs::SetPhysicsProperties&) { return value(); } 
00279 };
00280 
00281 template<>
00282 struct DataType<gazebo_msgs::SetPhysicsProperties> {
00283   static const char* value() 
00284   {
00285     return "gazebo_msgs/SetPhysicsProperties";
00286   }
00287 
00288   static const char* value(const gazebo_msgs::SetPhysicsProperties&) { return value(); } 
00289 };
00290 
00291 template<class ContainerAllocator>
00292 struct MD5Sum<gazebo_msgs::SetPhysicsPropertiesRequest_<ContainerAllocator> > {
00293   static const char* value() 
00294   {
00295     return "97e2057080558ce4730434b5fae75c91";
00296   }
00297 
00298   static const char* value(const gazebo_msgs::SetPhysicsPropertiesRequest_<ContainerAllocator> &) { return value(); } 
00299 };
00300 
00301 template<class ContainerAllocator>
00302 struct DataType<gazebo_msgs::SetPhysicsPropertiesRequest_<ContainerAllocator> > {
00303   static const char* value() 
00304   {
00305     return "gazebo_msgs/SetPhysicsProperties";
00306   }
00307 
00308   static const char* value(const gazebo_msgs::SetPhysicsPropertiesRequest_<ContainerAllocator> &) { return value(); } 
00309 };
00310 
00311 template<class ContainerAllocator>
00312 struct MD5Sum<gazebo_msgs::SetPhysicsPropertiesResponse_<ContainerAllocator> > {
00313   static const char* value() 
00314   {
00315     return "97e2057080558ce4730434b5fae75c91";
00316   }
00317 
00318   static const char* value(const gazebo_msgs::SetPhysicsPropertiesResponse_<ContainerAllocator> &) { return value(); } 
00319 };
00320 
00321 template<class ContainerAllocator>
00322 struct DataType<gazebo_msgs::SetPhysicsPropertiesResponse_<ContainerAllocator> > {
00323   static const char* value() 
00324   {
00325     return "gazebo_msgs/SetPhysicsProperties";
00326   }
00327 
00328   static const char* value(const gazebo_msgs::SetPhysicsPropertiesResponse_<ContainerAllocator> &) { return value(); } 
00329 };
00330 
00331 } // namespace service_traits
00332 } // namespace ros
00333 
00334 #endif // GAZEBO_MSGS_SERVICE_SETPHYSICSPROPERTIES_H
00335 


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