_CartImpTrajectoryPoint.py
Go to the documentation of this file.
00001 """autogenerated by genpy from lwr_impedance_controller/CartImpTrajectoryPoint.msg. Do not edit."""
00002 import sys
00003 python3 = True if sys.hexversion > 0x03000000 else False
00004 import genpy
00005 import struct
00006 
00007 import lwr_impedance_controller.msg
00008 import geometry_msgs.msg
00009 import genpy
00010 
00011 class CartImpTrajectoryPoint(genpy.Message):
00012   _md5sum = "e50c14d9f0e04d3a544573bcc6e7bb7c"
00013   _type = "lwr_impedance_controller/CartImpTrajectoryPoint"
00014   _has_header = False #flag to mark the presence of a Header object
00015   _full_text = """geometry_msgs/Pose pose
00016 lwr_impedance_controller/CartesianImpedance impedance
00017 geometry_msgs/Wrench wrench
00018 geometry_msgs/Twist velocity
00019 duration time_from_start
00020 
00021 ================================================================================
00022 MSG: geometry_msgs/Pose
00023 # A representation of pose in free space, composed of postion and orientation. 
00024 Point position
00025 Quaternion orientation
00026 
00027 ================================================================================
00028 MSG: geometry_msgs/Point
00029 # This contains the position of a point in free space
00030 float64 x
00031 float64 y
00032 float64 z
00033 
00034 ================================================================================
00035 MSG: geometry_msgs/Quaternion
00036 # This represents an orientation in free space in quaternion form.
00037 
00038 float64 x
00039 float64 y
00040 float64 z
00041 float64 w
00042 
00043 ================================================================================
00044 MSG: lwr_impedance_controller/CartesianImpedance
00045 geometry_msgs/Wrench stiffness
00046 geometry_msgs/Wrench damping
00047 
00048 ================================================================================
00049 MSG: geometry_msgs/Wrench
00050 # This represents force in free space, seperated into 
00051 # it's linear and angular parts.  
00052 Vector3  force
00053 Vector3  torque
00054 
00055 ================================================================================
00056 MSG: geometry_msgs/Vector3
00057 # This represents a vector in free space. 
00058 
00059 float64 x
00060 float64 y
00061 float64 z
00062 ================================================================================
00063 MSG: geometry_msgs/Twist
00064 # This expresses velocity in free space broken into it's linear and angular parts. 
00065 Vector3  linear
00066 Vector3  angular
00067 
00068 """
00069   __slots__ = ['pose','impedance','wrench','velocity','time_from_start']
00070   _slot_types = ['geometry_msgs/Pose','lwr_impedance_controller/CartesianImpedance','geometry_msgs/Wrench','geometry_msgs/Twist','duration']
00071 
00072   def __init__(self, *args, **kwds):
00073     """
00074     Constructor. Any message fields that are implicitly/explicitly
00075     set to None will be assigned a default value. The recommend
00076     use is keyword arguments as this is more robust to future message
00077     changes.  You cannot mix in-order arguments and keyword arguments.
00078 
00079     The available fields are:
00080        pose,impedance,wrench,velocity,time_from_start
00081 
00082     :param args: complete set of field values, in .msg order
00083     :param kwds: use keyword arguments corresponding to message field names
00084     to set specific fields.
00085     """
00086     if args or kwds:
00087       super(CartImpTrajectoryPoint, self).__init__(*args, **kwds)
00088       #message fields cannot be None, assign default values for those that are
00089       if self.pose is None:
00090         self.pose = geometry_msgs.msg.Pose()
00091       if self.impedance is None:
00092         self.impedance = lwr_impedance_controller.msg.CartesianImpedance()
00093       if self.wrench is None:
00094         self.wrench = geometry_msgs.msg.Wrench()
00095       if self.velocity is None:
00096         self.velocity = geometry_msgs.msg.Twist()
00097       if self.time_from_start is None:
00098         self.time_from_start = genpy.Duration()
00099     else:
00100       self.pose = geometry_msgs.msg.Pose()
00101       self.impedance = lwr_impedance_controller.msg.CartesianImpedance()
00102       self.wrench = geometry_msgs.msg.Wrench()
00103       self.velocity = geometry_msgs.msg.Twist()
00104       self.time_from_start = genpy.Duration()
00105 
00106   def _get_types(self):
00107     """
00108     internal API method
00109     """
00110     return self._slot_types
00111 
00112   def serialize(self, buff):
00113     """
00114     serialize message into buffer
00115     :param buff: buffer, ``StringIO``
00116     """
00117     try:
00118       _x = self
00119       buff.write(_struct_31d2i.pack(_x.pose.position.x, _x.pose.position.y, _x.pose.position.z, _x.pose.orientation.x, _x.pose.orientation.y, _x.pose.orientation.z, _x.pose.orientation.w, _x.impedance.stiffness.force.x, _x.impedance.stiffness.force.y, _x.impedance.stiffness.force.z, _x.impedance.stiffness.torque.x, _x.impedance.stiffness.torque.y, _x.impedance.stiffness.torque.z, _x.impedance.damping.force.x, _x.impedance.damping.force.y, _x.impedance.damping.force.z, _x.impedance.damping.torque.x, _x.impedance.damping.torque.y, _x.impedance.damping.torque.z, _x.wrench.force.x, _x.wrench.force.y, _x.wrench.force.z, _x.wrench.torque.x, _x.wrench.torque.y, _x.wrench.torque.z, _x.velocity.linear.x, _x.velocity.linear.y, _x.velocity.linear.z, _x.velocity.angular.x, _x.velocity.angular.y, _x.velocity.angular.z, _x.time_from_start.secs, _x.time_from_start.nsecs))
00120     except struct.error as se: self._check_types(se)
00121     except TypeError as te: self._check_types(te)
00122 
00123   def deserialize(self, str):
00124     """
00125     unpack serialized message in str into this message instance
00126     :param str: byte array of serialized message, ``str``
00127     """
00128     try:
00129       if self.pose is None:
00130         self.pose = geometry_msgs.msg.Pose()
00131       if self.impedance is None:
00132         self.impedance = lwr_impedance_controller.msg.CartesianImpedance()
00133       if self.wrench is None:
00134         self.wrench = geometry_msgs.msg.Wrench()
00135       if self.velocity is None:
00136         self.velocity = geometry_msgs.msg.Twist()
00137       if self.time_from_start is None:
00138         self.time_from_start = genpy.Duration()
00139       end = 0
00140       _x = self
00141       start = end
00142       end += 256
00143       (_x.pose.position.x, _x.pose.position.y, _x.pose.position.z, _x.pose.orientation.x, _x.pose.orientation.y, _x.pose.orientation.z, _x.pose.orientation.w, _x.impedance.stiffness.force.x, _x.impedance.stiffness.force.y, _x.impedance.stiffness.force.z, _x.impedance.stiffness.torque.x, _x.impedance.stiffness.torque.y, _x.impedance.stiffness.torque.z, _x.impedance.damping.force.x, _x.impedance.damping.force.y, _x.impedance.damping.force.z, _x.impedance.damping.torque.x, _x.impedance.damping.torque.y, _x.impedance.damping.torque.z, _x.wrench.force.x, _x.wrench.force.y, _x.wrench.force.z, _x.wrench.torque.x, _x.wrench.torque.y, _x.wrench.torque.z, _x.velocity.linear.x, _x.velocity.linear.y, _x.velocity.linear.z, _x.velocity.angular.x, _x.velocity.angular.y, _x.velocity.angular.z, _x.time_from_start.secs, _x.time_from_start.nsecs,) = _struct_31d2i.unpack(str[start:end])
00144       self.time_from_start.canon()
00145       return self
00146     except struct.error as e:
00147       raise genpy.DeserializationError(e) #most likely buffer underfill
00148 
00149 
00150   def serialize_numpy(self, buff, numpy):
00151     """
00152     serialize message with numpy array types into buffer
00153     :param buff: buffer, ``StringIO``
00154     :param numpy: numpy python module
00155     """
00156     try:
00157       _x = self
00158       buff.write(_struct_31d2i.pack(_x.pose.position.x, _x.pose.position.y, _x.pose.position.z, _x.pose.orientation.x, _x.pose.orientation.y, _x.pose.orientation.z, _x.pose.orientation.w, _x.impedance.stiffness.force.x, _x.impedance.stiffness.force.y, _x.impedance.stiffness.force.z, _x.impedance.stiffness.torque.x, _x.impedance.stiffness.torque.y, _x.impedance.stiffness.torque.z, _x.impedance.damping.force.x, _x.impedance.damping.force.y, _x.impedance.damping.force.z, _x.impedance.damping.torque.x, _x.impedance.damping.torque.y, _x.impedance.damping.torque.z, _x.wrench.force.x, _x.wrench.force.y, _x.wrench.force.z, _x.wrench.torque.x, _x.wrench.torque.y, _x.wrench.torque.z, _x.velocity.linear.x, _x.velocity.linear.y, _x.velocity.linear.z, _x.velocity.angular.x, _x.velocity.angular.y, _x.velocity.angular.z, _x.time_from_start.secs, _x.time_from_start.nsecs))
00159     except struct.error as se: self._check_types(se)
00160     except TypeError as te: self._check_types(te)
00161 
00162   def deserialize_numpy(self, str, numpy):
00163     """
00164     unpack serialized message in str into this message instance using numpy for array types
00165     :param str: byte array of serialized message, ``str``
00166     :param numpy: numpy python module
00167     """
00168     try:
00169       if self.pose is None:
00170         self.pose = geometry_msgs.msg.Pose()
00171       if self.impedance is None:
00172         self.impedance = lwr_impedance_controller.msg.CartesianImpedance()
00173       if self.wrench is None:
00174         self.wrench = geometry_msgs.msg.Wrench()
00175       if self.velocity is None:
00176         self.velocity = geometry_msgs.msg.Twist()
00177       if self.time_from_start is None:
00178         self.time_from_start = genpy.Duration()
00179       end = 0
00180       _x = self
00181       start = end
00182       end += 256
00183       (_x.pose.position.x, _x.pose.position.y, _x.pose.position.z, _x.pose.orientation.x, _x.pose.orientation.y, _x.pose.orientation.z, _x.pose.orientation.w, _x.impedance.stiffness.force.x, _x.impedance.stiffness.force.y, _x.impedance.stiffness.force.z, _x.impedance.stiffness.torque.x, _x.impedance.stiffness.torque.y, _x.impedance.stiffness.torque.z, _x.impedance.damping.force.x, _x.impedance.damping.force.y, _x.impedance.damping.force.z, _x.impedance.damping.torque.x, _x.impedance.damping.torque.y, _x.impedance.damping.torque.z, _x.wrench.force.x, _x.wrench.force.y, _x.wrench.force.z, _x.wrench.torque.x, _x.wrench.torque.y, _x.wrench.torque.z, _x.velocity.linear.x, _x.velocity.linear.y, _x.velocity.linear.z, _x.velocity.angular.x, _x.velocity.angular.y, _x.velocity.angular.z, _x.time_from_start.secs, _x.time_from_start.nsecs,) = _struct_31d2i.unpack(str[start:end])
00184       self.time_from_start.canon()
00185       return self
00186     except struct.error as e:
00187       raise genpy.DeserializationError(e) #most likely buffer underfill
00188 
00189 _struct_I = genpy.struct_I
00190 _struct_31d2i = struct.Struct("<31d2i")
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends


lwr_impedance_controller
Author(s): Konrad Banachowicz
autogenerated on Thu Nov 14 2013 11:56:13