_ArmNavMovePalmLink.py
Go to the documentation of this file.
00001 """autogenerated by genpy from srs_assisted_arm_navigation_msgs/ArmNavMovePalmLinkRequest.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 std_msgs.msg
00009 
00010 class ArmNavMovePalmLinkRequest(genpy.Message):
00011   _md5sum = "2a9b3a744872de70e87ced880bb13ac5"
00012   _type = "srs_assisted_arm_navigation_msgs/ArmNavMovePalmLinkRequest"
00013   _has_header = False #flag to mark the presence of a Header object
00014   _full_text = """geometry_msgs/PoseStamped sdh_palm_link_pose
00015 
00016 ================================================================================
00017 MSG: geometry_msgs/PoseStamped
00018 # A Pose with reference coordinate frame and timestamp
00019 Header header
00020 Pose pose
00021 
00022 ================================================================================
00023 MSG: std_msgs/Header
00024 # Standard metadata for higher-level stamped data types.
00025 # This is generally used to communicate timestamped data 
00026 # in a particular coordinate frame.
00027 # 
00028 # sequence ID: consecutively increasing ID 
00029 uint32 seq
00030 #Two-integer timestamp that is expressed as:
00031 # * stamp.secs: seconds (stamp_secs) since epoch
00032 # * stamp.nsecs: nanoseconds since stamp_secs
00033 # time-handling sugar is provided by the client library
00034 time stamp
00035 #Frame this data is associated with
00036 # 0: no frame
00037 # 1: global frame
00038 string frame_id
00039 
00040 ================================================================================
00041 MSG: geometry_msgs/Pose
00042 # A representation of pose in free space, composed of postion and orientation. 
00043 Point position
00044 Quaternion orientation
00045 
00046 ================================================================================
00047 MSG: geometry_msgs/Point
00048 # This contains the position of a point in free space
00049 float64 x
00050 float64 y
00051 float64 z
00052 
00053 ================================================================================
00054 MSG: geometry_msgs/Quaternion
00055 # This represents an orientation in free space in quaternion form.
00056 
00057 float64 x
00058 float64 y
00059 float64 z
00060 float64 w
00061 
00062 """
00063   __slots__ = ['sdh_palm_link_pose']
00064   _slot_types = ['geometry_msgs/PoseStamped']
00065 
00066   def __init__(self, *args, **kwds):
00067     """
00068     Constructor. Any message fields that are implicitly/explicitly
00069     set to None will be assigned a default value. The recommend
00070     use is keyword arguments as this is more robust to future message
00071     changes.  You cannot mix in-order arguments and keyword arguments.
00072 
00073     The available fields are:
00074        sdh_palm_link_pose
00075 
00076     :param args: complete set of field values, in .msg order
00077     :param kwds: use keyword arguments corresponding to message field names
00078     to set specific fields.
00079     """
00080     if args or kwds:
00081       super(ArmNavMovePalmLinkRequest, self).__init__(*args, **kwds)
00082       #message fields cannot be None, assign default values for those that are
00083       if self.sdh_palm_link_pose is None:
00084         self.sdh_palm_link_pose = geometry_msgs.msg.PoseStamped()
00085     else:
00086       self.sdh_palm_link_pose = geometry_msgs.msg.PoseStamped()
00087 
00088   def _get_types(self):
00089     """
00090     internal API method
00091     """
00092     return self._slot_types
00093 
00094   def serialize(self, buff):
00095     """
00096     serialize message into buffer
00097     :param buff: buffer, ``StringIO``
00098     """
00099     try:
00100       _x = self
00101       buff.write(_struct_3I.pack(_x.sdh_palm_link_pose.header.seq, _x.sdh_palm_link_pose.header.stamp.secs, _x.sdh_palm_link_pose.header.stamp.nsecs))
00102       _x = self.sdh_palm_link_pose.header.frame_id
00103       length = len(_x)
00104       if python3 or type(_x) == unicode:
00105         _x = _x.encode('utf-8')
00106         length = len(_x)
00107       buff.write(struct.pack('<I%ss'%length, length, _x))
00108       _x = self
00109       buff.write(_struct_7d.pack(_x.sdh_palm_link_pose.pose.position.x, _x.sdh_palm_link_pose.pose.position.y, _x.sdh_palm_link_pose.pose.position.z, _x.sdh_palm_link_pose.pose.orientation.x, _x.sdh_palm_link_pose.pose.orientation.y, _x.sdh_palm_link_pose.pose.orientation.z, _x.sdh_palm_link_pose.pose.orientation.w))
00110     except struct.error as se: self._check_types(struct.error("%s: '%s' when writing '%s'" % (type(se), str(se), str(_x))))
00111     except TypeError as te: self._check_types(ValueError("%s: '%s' when writing '%s'" % (type(te), str(te), str(_x))))
00112 
00113   def deserialize(self, str):
00114     """
00115     unpack serialized message in str into this message instance
00116     :param str: byte array of serialized message, ``str``
00117     """
00118     try:
00119       if self.sdh_palm_link_pose is None:
00120         self.sdh_palm_link_pose = geometry_msgs.msg.PoseStamped()
00121       end = 0
00122       _x = self
00123       start = end
00124       end += 12
00125       (_x.sdh_palm_link_pose.header.seq, _x.sdh_palm_link_pose.header.stamp.secs, _x.sdh_palm_link_pose.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00126       start = end
00127       end += 4
00128       (length,) = _struct_I.unpack(str[start:end])
00129       start = end
00130       end += length
00131       if python3:
00132         self.sdh_palm_link_pose.header.frame_id = str[start:end].decode('utf-8')
00133       else:
00134         self.sdh_palm_link_pose.header.frame_id = str[start:end]
00135       _x = self
00136       start = end
00137       end += 56
00138       (_x.sdh_palm_link_pose.pose.position.x, _x.sdh_palm_link_pose.pose.position.y, _x.sdh_palm_link_pose.pose.position.z, _x.sdh_palm_link_pose.pose.orientation.x, _x.sdh_palm_link_pose.pose.orientation.y, _x.sdh_palm_link_pose.pose.orientation.z, _x.sdh_palm_link_pose.pose.orientation.w,) = _struct_7d.unpack(str[start:end])
00139       return self
00140     except struct.error as e:
00141       raise genpy.DeserializationError(e) #most likely buffer underfill
00142 
00143 
00144   def serialize_numpy(self, buff, numpy):
00145     """
00146     serialize message with numpy array types into buffer
00147     :param buff: buffer, ``StringIO``
00148     :param numpy: numpy python module
00149     """
00150     try:
00151       _x = self
00152       buff.write(_struct_3I.pack(_x.sdh_palm_link_pose.header.seq, _x.sdh_palm_link_pose.header.stamp.secs, _x.sdh_palm_link_pose.header.stamp.nsecs))
00153       _x = self.sdh_palm_link_pose.header.frame_id
00154       length = len(_x)
00155       if python3 or type(_x) == unicode:
00156         _x = _x.encode('utf-8')
00157         length = len(_x)
00158       buff.write(struct.pack('<I%ss'%length, length, _x))
00159       _x = self
00160       buff.write(_struct_7d.pack(_x.sdh_palm_link_pose.pose.position.x, _x.sdh_palm_link_pose.pose.position.y, _x.sdh_palm_link_pose.pose.position.z, _x.sdh_palm_link_pose.pose.orientation.x, _x.sdh_palm_link_pose.pose.orientation.y, _x.sdh_palm_link_pose.pose.orientation.z, _x.sdh_palm_link_pose.pose.orientation.w))
00161     except struct.error as se: self._check_types(struct.error("%s: '%s' when writing '%s'" % (type(se), str(se), str(_x))))
00162     except TypeError as te: self._check_types(ValueError("%s: '%s' when writing '%s'" % (type(te), str(te), str(_x))))
00163 
00164   def deserialize_numpy(self, str, numpy):
00165     """
00166     unpack serialized message in str into this message instance using numpy for array types
00167     :param str: byte array of serialized message, ``str``
00168     :param numpy: numpy python module
00169     """
00170     try:
00171       if self.sdh_palm_link_pose is None:
00172         self.sdh_palm_link_pose = geometry_msgs.msg.PoseStamped()
00173       end = 0
00174       _x = self
00175       start = end
00176       end += 12
00177       (_x.sdh_palm_link_pose.header.seq, _x.sdh_palm_link_pose.header.stamp.secs, _x.sdh_palm_link_pose.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00178       start = end
00179       end += 4
00180       (length,) = _struct_I.unpack(str[start:end])
00181       start = end
00182       end += length
00183       if python3:
00184         self.sdh_palm_link_pose.header.frame_id = str[start:end].decode('utf-8')
00185       else:
00186         self.sdh_palm_link_pose.header.frame_id = str[start:end]
00187       _x = self
00188       start = end
00189       end += 56
00190       (_x.sdh_palm_link_pose.pose.position.x, _x.sdh_palm_link_pose.pose.position.y, _x.sdh_palm_link_pose.pose.position.z, _x.sdh_palm_link_pose.pose.orientation.x, _x.sdh_palm_link_pose.pose.orientation.y, _x.sdh_palm_link_pose.pose.orientation.z, _x.sdh_palm_link_pose.pose.orientation.w,) = _struct_7d.unpack(str[start:end])
00191       return self
00192     except struct.error as e:
00193       raise genpy.DeserializationError(e) #most likely buffer underfill
00194 
00195 _struct_I = genpy.struct_I
00196 _struct_3I = struct.Struct("<3I")
00197 _struct_7d = struct.Struct("<7d")
00198 """autogenerated by genpy from srs_assisted_arm_navigation_msgs/ArmNavMovePalmLinkResponse.msg. Do not edit."""
00199 import sys
00200 python3 = True if sys.hexversion > 0x03000000 else False
00201 import genpy
00202 import struct
00203 
00204 
00205 class ArmNavMovePalmLinkResponse(genpy.Message):
00206   _md5sum = "7de7f4695a268566c2ce9ae9e3a34e73"
00207   _type = "srs_assisted_arm_navigation_msgs/ArmNavMovePalmLinkResponse"
00208   _has_header = False #flag to mark the presence of a Header object
00209   _full_text = """bool completed
00210 string msg
00211 
00212 """
00213   __slots__ = ['completed','msg']
00214   _slot_types = ['bool','string']
00215 
00216   def __init__(self, *args, **kwds):
00217     """
00218     Constructor. Any message fields that are implicitly/explicitly
00219     set to None will be assigned a default value. The recommend
00220     use is keyword arguments as this is more robust to future message
00221     changes.  You cannot mix in-order arguments and keyword arguments.
00222 
00223     The available fields are:
00224        completed,msg
00225 
00226     :param args: complete set of field values, in .msg order
00227     :param kwds: use keyword arguments corresponding to message field names
00228     to set specific fields.
00229     """
00230     if args or kwds:
00231       super(ArmNavMovePalmLinkResponse, self).__init__(*args, **kwds)
00232       #message fields cannot be None, assign default values for those that are
00233       if self.completed is None:
00234         self.completed = False
00235       if self.msg is None:
00236         self.msg = ''
00237     else:
00238       self.completed = False
00239       self.msg = ''
00240 
00241   def _get_types(self):
00242     """
00243     internal API method
00244     """
00245     return self._slot_types
00246 
00247   def serialize(self, buff):
00248     """
00249     serialize message into buffer
00250     :param buff: buffer, ``StringIO``
00251     """
00252     try:
00253       buff.write(_struct_B.pack(self.completed))
00254       _x = self.msg
00255       length = len(_x)
00256       if python3 or type(_x) == unicode:
00257         _x = _x.encode('utf-8')
00258         length = len(_x)
00259       buff.write(struct.pack('<I%ss'%length, length, _x))
00260     except struct.error as se: self._check_types(struct.error("%s: '%s' when writing '%s'" % (type(se), str(se), str(_x))))
00261     except TypeError as te: self._check_types(ValueError("%s: '%s' when writing '%s'" % (type(te), str(te), str(_x))))
00262 
00263   def deserialize(self, str):
00264     """
00265     unpack serialized message in str into this message instance
00266     :param str: byte array of serialized message, ``str``
00267     """
00268     try:
00269       end = 0
00270       start = end
00271       end += 1
00272       (self.completed,) = _struct_B.unpack(str[start:end])
00273       self.completed = bool(self.completed)
00274       start = end
00275       end += 4
00276       (length,) = _struct_I.unpack(str[start:end])
00277       start = end
00278       end += length
00279       if python3:
00280         self.msg = str[start:end].decode('utf-8')
00281       else:
00282         self.msg = str[start:end]
00283       return self
00284     except struct.error as e:
00285       raise genpy.DeserializationError(e) #most likely buffer underfill
00286 
00287 
00288   def serialize_numpy(self, buff, numpy):
00289     """
00290     serialize message with numpy array types into buffer
00291     :param buff: buffer, ``StringIO``
00292     :param numpy: numpy python module
00293     """
00294     try:
00295       buff.write(_struct_B.pack(self.completed))
00296       _x = self.msg
00297       length = len(_x)
00298       if python3 or type(_x) == unicode:
00299         _x = _x.encode('utf-8')
00300         length = len(_x)
00301       buff.write(struct.pack('<I%ss'%length, length, _x))
00302     except struct.error as se: self._check_types(struct.error("%s: '%s' when writing '%s'" % (type(se), str(se), str(_x))))
00303     except TypeError as te: self._check_types(ValueError("%s: '%s' when writing '%s'" % (type(te), str(te), str(_x))))
00304 
00305   def deserialize_numpy(self, str, numpy):
00306     """
00307     unpack serialized message in str into this message instance using numpy for array types
00308     :param str: byte array of serialized message, ``str``
00309     :param numpy: numpy python module
00310     """
00311     try:
00312       end = 0
00313       start = end
00314       end += 1
00315       (self.completed,) = _struct_B.unpack(str[start:end])
00316       self.completed = bool(self.completed)
00317       start = end
00318       end += 4
00319       (length,) = _struct_I.unpack(str[start:end])
00320       start = end
00321       end += length
00322       if python3:
00323         self.msg = str[start:end].decode('utf-8')
00324       else:
00325         self.msg = str[start:end]
00326       return self
00327     except struct.error as e:
00328       raise genpy.DeserializationError(e) #most likely buffer underfill
00329 
00330 _struct_I = genpy.struct_I
00331 _struct_B = struct.Struct("<B")
00332 class ArmNavMovePalmLink(object):
00333   _type          = 'srs_assisted_arm_navigation_msgs/ArmNavMovePalmLink'
00334   _md5sum = '6a1d50effcfcd3d7e03d54f96528de75'
00335   _request_class  = ArmNavMovePalmLinkRequest
00336   _response_class = ArmNavMovePalmLinkResponse


srs_assisted_arm_navigation_msgs
Author(s): Zdenek Materna
autogenerated on Mon Oct 6 2014 08:09:35