_ClipFootstep.py
Go to the documentation of this file.
00001 """autogenerated by genpy from humanoid_nav_msgs/ClipFootstepRequest.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 geometry_msgs.msg
00008 import humanoid_nav_msgs.msg
00009 
00010 class ClipFootstepRequest(genpy.Message):
00011   _md5sum = "f22cfce442b381849d82602383b052c7"
00012   _type = "humanoid_nav_msgs/ClipFootstepRequest"
00013   _has_header = False #flag to mark the presence of a Header object
00014   _full_text = """StepTarget step
00015 
00016 ================================================================================
00017 MSG: humanoid_nav_msgs/StepTarget
00018 # Target for a single stepping motion of a humanoid's leg
00019 
00020 geometry_msgs/Pose2D pose   # step pose as relative offset to last leg
00021 uint8 leg                   # which leg to use (left/right, see below)
00022 
00023 uint8 right=0               # right leg constant
00024 uint8 left=1                # left leg constant
00025 
00026 ================================================================================
00027 MSG: geometry_msgs/Pose2D
00028 # This expresses a position and orientation on a 2D manifold.
00029 
00030 float64 x
00031 float64 y
00032 float64 theta
00033 """
00034   __slots__ = ['step']
00035   _slot_types = ['humanoid_nav_msgs/StepTarget']
00036 
00037   def __init__(self, *args, **kwds):
00038     """
00039     Constructor. Any message fields that are implicitly/explicitly
00040     set to None will be assigned a default value. The recommend
00041     use is keyword arguments as this is more robust to future message
00042     changes.  You cannot mix in-order arguments and keyword arguments.
00043 
00044     The available fields are:
00045        step
00046 
00047     :param args: complete set of field values, in .msg order
00048     :param kwds: use keyword arguments corresponding to message field names
00049     to set specific fields.
00050     """
00051     if args or kwds:
00052       super(ClipFootstepRequest, self).__init__(*args, **kwds)
00053       #message fields cannot be None, assign default values for those that are
00054       if self.step is None:
00055         self.step = humanoid_nav_msgs.msg.StepTarget()
00056     else:
00057       self.step = humanoid_nav_msgs.msg.StepTarget()
00058 
00059   def _get_types(self):
00060     """
00061     internal API method
00062     """
00063     return self._slot_types
00064 
00065   def serialize(self, buff):
00066     """
00067     serialize message into buffer
00068     :param buff: buffer, ``StringIO``
00069     """
00070     try:
00071       _x = self
00072       buff.write(_struct_3dB.pack(_x.step.pose.x, _x.step.pose.y, _x.step.pose.theta, _x.step.leg))
00073     except struct.error as se: self._check_types(se)
00074     except TypeError as te: self._check_types(te)
00075 
00076   def deserialize(self, str):
00077     """
00078     unpack serialized message in str into this message instance
00079     :param str: byte array of serialized message, ``str``
00080     """
00081     try:
00082       if self.step is None:
00083         self.step = humanoid_nav_msgs.msg.StepTarget()
00084       end = 0
00085       _x = self
00086       start = end
00087       end += 25
00088       (_x.step.pose.x, _x.step.pose.y, _x.step.pose.theta, _x.step.leg,) = _struct_3dB.unpack(str[start:end])
00089       return self
00090     except struct.error as e:
00091       raise genpy.DeserializationError(e) #most likely buffer underfill
00092 
00093 
00094   def serialize_numpy(self, buff, numpy):
00095     """
00096     serialize message with numpy array types into buffer
00097     :param buff: buffer, ``StringIO``
00098     :param numpy: numpy python module
00099     """
00100     try:
00101       _x = self
00102       buff.write(_struct_3dB.pack(_x.step.pose.x, _x.step.pose.y, _x.step.pose.theta, _x.step.leg))
00103     except struct.error as se: self._check_types(se)
00104     except TypeError as te: self._check_types(te)
00105 
00106   def deserialize_numpy(self, str, numpy):
00107     """
00108     unpack serialized message in str into this message instance using numpy for array types
00109     :param str: byte array of serialized message, ``str``
00110     :param numpy: numpy python module
00111     """
00112     try:
00113       if self.step is None:
00114         self.step = humanoid_nav_msgs.msg.StepTarget()
00115       end = 0
00116       _x = self
00117       start = end
00118       end += 25
00119       (_x.step.pose.x, _x.step.pose.y, _x.step.pose.theta, _x.step.leg,) = _struct_3dB.unpack(str[start:end])
00120       return self
00121     except struct.error as e:
00122       raise genpy.DeserializationError(e) #most likely buffer underfill
00123 
00124 _struct_I = genpy.struct_I
00125 _struct_3dB = struct.Struct("<3dB")
00126 """autogenerated by genpy from humanoid_nav_msgs/ClipFootstepResponse.msg. Do not edit."""
00127 import sys
00128 python3 = True if sys.hexversion > 0x03000000 else False
00129 import genpy
00130 import struct
00131 
00132 import geometry_msgs.msg
00133 import humanoid_nav_msgs.msg
00134 
00135 class ClipFootstepResponse(genpy.Message):
00136   _md5sum = "f22cfce442b381849d82602383b052c7"
00137   _type = "humanoid_nav_msgs/ClipFootstepResponse"
00138   _has_header = False #flag to mark the presence of a Header object
00139   _full_text = """StepTarget step
00140 
00141 
00142 ================================================================================
00143 MSG: humanoid_nav_msgs/StepTarget
00144 # Target for a single stepping motion of a humanoid's leg
00145 
00146 geometry_msgs/Pose2D pose   # step pose as relative offset to last leg
00147 uint8 leg                   # which leg to use (left/right, see below)
00148 
00149 uint8 right=0               # right leg constant
00150 uint8 left=1                # left leg constant
00151 
00152 ================================================================================
00153 MSG: geometry_msgs/Pose2D
00154 # This expresses a position and orientation on a 2D manifold.
00155 
00156 float64 x
00157 float64 y
00158 float64 theta
00159 """
00160   __slots__ = ['step']
00161   _slot_types = ['humanoid_nav_msgs/StepTarget']
00162 
00163   def __init__(self, *args, **kwds):
00164     """
00165     Constructor. Any message fields that are implicitly/explicitly
00166     set to None will be assigned a default value. The recommend
00167     use is keyword arguments as this is more robust to future message
00168     changes.  You cannot mix in-order arguments and keyword arguments.
00169 
00170     The available fields are:
00171        step
00172 
00173     :param args: complete set of field values, in .msg order
00174     :param kwds: use keyword arguments corresponding to message field names
00175     to set specific fields.
00176     """
00177     if args or kwds:
00178       super(ClipFootstepResponse, self).__init__(*args, **kwds)
00179       #message fields cannot be None, assign default values for those that are
00180       if self.step is None:
00181         self.step = humanoid_nav_msgs.msg.StepTarget()
00182     else:
00183       self.step = humanoid_nav_msgs.msg.StepTarget()
00184 
00185   def _get_types(self):
00186     """
00187     internal API method
00188     """
00189     return self._slot_types
00190 
00191   def serialize(self, buff):
00192     """
00193     serialize message into buffer
00194     :param buff: buffer, ``StringIO``
00195     """
00196     try:
00197       _x = self
00198       buff.write(_struct_3dB.pack(_x.step.pose.x, _x.step.pose.y, _x.step.pose.theta, _x.step.leg))
00199     except struct.error as se: self._check_types(se)
00200     except TypeError as te: self._check_types(te)
00201 
00202   def deserialize(self, str):
00203     """
00204     unpack serialized message in str into this message instance
00205     :param str: byte array of serialized message, ``str``
00206     """
00207     try:
00208       if self.step is None:
00209         self.step = humanoid_nav_msgs.msg.StepTarget()
00210       end = 0
00211       _x = self
00212       start = end
00213       end += 25
00214       (_x.step.pose.x, _x.step.pose.y, _x.step.pose.theta, _x.step.leg,) = _struct_3dB.unpack(str[start:end])
00215       return self
00216     except struct.error as e:
00217       raise genpy.DeserializationError(e) #most likely buffer underfill
00218 
00219 
00220   def serialize_numpy(self, buff, numpy):
00221     """
00222     serialize message with numpy array types into buffer
00223     :param buff: buffer, ``StringIO``
00224     :param numpy: numpy python module
00225     """
00226     try:
00227       _x = self
00228       buff.write(_struct_3dB.pack(_x.step.pose.x, _x.step.pose.y, _x.step.pose.theta, _x.step.leg))
00229     except struct.error as se: self._check_types(se)
00230     except TypeError as te: self._check_types(te)
00231 
00232   def deserialize_numpy(self, str, numpy):
00233     """
00234     unpack serialized message in str into this message instance using numpy for array types
00235     :param str: byte array of serialized message, ``str``
00236     :param numpy: numpy python module
00237     """
00238     try:
00239       if self.step is None:
00240         self.step = humanoid_nav_msgs.msg.StepTarget()
00241       end = 0
00242       _x = self
00243       start = end
00244       end += 25
00245       (_x.step.pose.x, _x.step.pose.y, _x.step.pose.theta, _x.step.leg,) = _struct_3dB.unpack(str[start:end])
00246       return self
00247     except struct.error as e:
00248       raise genpy.DeserializationError(e) #most likely buffer underfill
00249 
00250 _struct_I = genpy.struct_I
00251 _struct_3dB = struct.Struct("<3dB")
00252 class ClipFootstep(object):
00253   _type          = 'humanoid_nav_msgs/ClipFootstep'
00254   _md5sum = '394ac576028f40af6569704f845b86a1'
00255   _request_class  = ClipFootstepRequest
00256   _response_class = ClipFootstepResponse
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Properties Friends


humanoid_nav_msgs
Author(s): Armin Hornung
autogenerated on Tue Oct 15 2013 10:05:54