_GetApproachPose.py
Go to the documentation of this file.
00001 """autogenerated by genpy from approach_table_tools/GetApproachPoseRequest.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 GetApproachPoseRequest(genpy.Message):
00011   _md5sum = "8c55f844039b710dbbf43d20e4fdbf71"
00012   _type = "approach_table_tools/GetApproachPoseRequest"
00013   _has_header = False #flag to mark the presence of a Header object
00014   _full_text = """geometry_msgs/PoseStamped board_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__ = ['board_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        board_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(GetApproachPoseRequest, self).__init__(*args, **kwds)
00082       #message fields cannot be None, assign default values for those that are
00083       if self.board_pose is None:
00084         self.board_pose = geometry_msgs.msg.PoseStamped()
00085     else:
00086       self.board_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.board_pose.header.seq, _x.board_pose.header.stamp.secs, _x.board_pose.header.stamp.nsecs))
00102       _x = self.board_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.board_pose.pose.position.x, _x.board_pose.pose.position.y, _x.board_pose.pose.position.z, _x.board_pose.pose.orientation.x, _x.board_pose.pose.orientation.y, _x.board_pose.pose.orientation.z, _x.board_pose.pose.orientation.w))
00110     except struct.error as se: self._check_types(se)
00111     except TypeError as te: self._check_types(te)
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.board_pose is None:
00120         self.board_pose = geometry_msgs.msg.PoseStamped()
00121       end = 0
00122       _x = self
00123       start = end
00124       end += 12
00125       (_x.board_pose.header.seq, _x.board_pose.header.stamp.secs, _x.board_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.board_pose.header.frame_id = str[start:end].decode('utf-8')
00133       else:
00134         self.board_pose.header.frame_id = str[start:end]
00135       _x = self
00136       start = end
00137       end += 56
00138       (_x.board_pose.pose.position.x, _x.board_pose.pose.position.y, _x.board_pose.pose.position.z, _x.board_pose.pose.orientation.x, _x.board_pose.pose.orientation.y, _x.board_pose.pose.orientation.z, _x.board_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.board_pose.header.seq, _x.board_pose.header.stamp.secs, _x.board_pose.header.stamp.nsecs))
00153       _x = self.board_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.board_pose.pose.position.x, _x.board_pose.pose.position.y, _x.board_pose.pose.position.z, _x.board_pose.pose.orientation.x, _x.board_pose.pose.orientation.y, _x.board_pose.pose.orientation.z, _x.board_pose.pose.orientation.w))
00161     except struct.error as se: self._check_types(se)
00162     except TypeError as te: self._check_types(te)
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.board_pose is None:
00172         self.board_pose = geometry_msgs.msg.PoseStamped()
00173       end = 0
00174       _x = self
00175       start = end
00176       end += 12
00177       (_x.board_pose.header.seq, _x.board_pose.header.stamp.secs, _x.board_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.board_pose.header.frame_id = str[start:end].decode('utf-8')
00185       else:
00186         self.board_pose.header.frame_id = str[start:end]
00187       _x = self
00188       start = end
00189       end += 56
00190       (_x.board_pose.pose.position.x, _x.board_pose.pose.position.y, _x.board_pose.pose.position.z, _x.board_pose.pose.orientation.x, _x.board_pose.pose.orientation.y, _x.board_pose.pose.orientation.z, _x.board_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 approach_table_tools/GetApproachPoseResponse.msg. Do not edit."""
00199 import sys
00200 python3 = True if sys.hexversion > 0x03000000 else False
00201 import genpy
00202 import struct
00203 
00204 import geometry_msgs.msg
00205 import std_msgs.msg
00206 
00207 class GetApproachPoseResponse(genpy.Message):
00208   _md5sum = "2b90a979b709f64c7d26909fb535c05a"
00209   _type = "approach_table_tools/GetApproachPoseResponse"
00210   _has_header = False #flag to mark the presence of a Header object
00211   _full_text = """geometry_msgs/PoseStamped nav_pose
00212 
00213 
00214 ================================================================================
00215 MSG: geometry_msgs/PoseStamped
00216 # A Pose with reference coordinate frame and timestamp
00217 Header header
00218 Pose pose
00219 
00220 ================================================================================
00221 MSG: std_msgs/Header
00222 # Standard metadata for higher-level stamped data types.
00223 # This is generally used to communicate timestamped data 
00224 # in a particular coordinate frame.
00225 # 
00226 # sequence ID: consecutively increasing ID 
00227 uint32 seq
00228 #Two-integer timestamp that is expressed as:
00229 # * stamp.secs: seconds (stamp_secs) since epoch
00230 # * stamp.nsecs: nanoseconds since stamp_secs
00231 # time-handling sugar is provided by the client library
00232 time stamp
00233 #Frame this data is associated with
00234 # 0: no frame
00235 # 1: global frame
00236 string frame_id
00237 
00238 ================================================================================
00239 MSG: geometry_msgs/Pose
00240 # A representation of pose in free space, composed of postion and orientation. 
00241 Point position
00242 Quaternion orientation
00243 
00244 ================================================================================
00245 MSG: geometry_msgs/Point
00246 # This contains the position of a point in free space
00247 float64 x
00248 float64 y
00249 float64 z
00250 
00251 ================================================================================
00252 MSG: geometry_msgs/Quaternion
00253 # This represents an orientation in free space in quaternion form.
00254 
00255 float64 x
00256 float64 y
00257 float64 z
00258 float64 w
00259 
00260 """
00261   __slots__ = ['nav_pose']
00262   _slot_types = ['geometry_msgs/PoseStamped']
00263 
00264   def __init__(self, *args, **kwds):
00265     """
00266     Constructor. Any message fields that are implicitly/explicitly
00267     set to None will be assigned a default value. The recommend
00268     use is keyword arguments as this is more robust to future message
00269     changes.  You cannot mix in-order arguments and keyword arguments.
00270 
00271     The available fields are:
00272        nav_pose
00273 
00274     :param args: complete set of field values, in .msg order
00275     :param kwds: use keyword arguments corresponding to message field names
00276     to set specific fields.
00277     """
00278     if args or kwds:
00279       super(GetApproachPoseResponse, self).__init__(*args, **kwds)
00280       #message fields cannot be None, assign default values for those that are
00281       if self.nav_pose is None:
00282         self.nav_pose = geometry_msgs.msg.PoseStamped()
00283     else:
00284       self.nav_pose = geometry_msgs.msg.PoseStamped()
00285 
00286   def _get_types(self):
00287     """
00288     internal API method
00289     """
00290     return self._slot_types
00291 
00292   def serialize(self, buff):
00293     """
00294     serialize message into buffer
00295     :param buff: buffer, ``StringIO``
00296     """
00297     try:
00298       _x = self
00299       buff.write(_struct_3I.pack(_x.nav_pose.header.seq, _x.nav_pose.header.stamp.secs, _x.nav_pose.header.stamp.nsecs))
00300       _x = self.nav_pose.header.frame_id
00301       length = len(_x)
00302       if python3 or type(_x) == unicode:
00303         _x = _x.encode('utf-8')
00304         length = len(_x)
00305       buff.write(struct.pack('<I%ss'%length, length, _x))
00306       _x = self
00307       buff.write(_struct_7d.pack(_x.nav_pose.pose.position.x, _x.nav_pose.pose.position.y, _x.nav_pose.pose.position.z, _x.nav_pose.pose.orientation.x, _x.nav_pose.pose.orientation.y, _x.nav_pose.pose.orientation.z, _x.nav_pose.pose.orientation.w))
00308     except struct.error as se: self._check_types(se)
00309     except TypeError as te: self._check_types(te)
00310 
00311   def deserialize(self, str):
00312     """
00313     unpack serialized message in str into this message instance
00314     :param str: byte array of serialized message, ``str``
00315     """
00316     try:
00317       if self.nav_pose is None:
00318         self.nav_pose = geometry_msgs.msg.PoseStamped()
00319       end = 0
00320       _x = self
00321       start = end
00322       end += 12
00323       (_x.nav_pose.header.seq, _x.nav_pose.header.stamp.secs, _x.nav_pose.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00324       start = end
00325       end += 4
00326       (length,) = _struct_I.unpack(str[start:end])
00327       start = end
00328       end += length
00329       if python3:
00330         self.nav_pose.header.frame_id = str[start:end].decode('utf-8')
00331       else:
00332         self.nav_pose.header.frame_id = str[start:end]
00333       _x = self
00334       start = end
00335       end += 56
00336       (_x.nav_pose.pose.position.x, _x.nav_pose.pose.position.y, _x.nav_pose.pose.position.z, _x.nav_pose.pose.orientation.x, _x.nav_pose.pose.orientation.y, _x.nav_pose.pose.orientation.z, _x.nav_pose.pose.orientation.w,) = _struct_7d.unpack(str[start:end])
00337       return self
00338     except struct.error as e:
00339       raise genpy.DeserializationError(e) #most likely buffer underfill
00340 
00341 
00342   def serialize_numpy(self, buff, numpy):
00343     """
00344     serialize message with numpy array types into buffer
00345     :param buff: buffer, ``StringIO``
00346     :param numpy: numpy python module
00347     """
00348     try:
00349       _x = self
00350       buff.write(_struct_3I.pack(_x.nav_pose.header.seq, _x.nav_pose.header.stamp.secs, _x.nav_pose.header.stamp.nsecs))
00351       _x = self.nav_pose.header.frame_id
00352       length = len(_x)
00353       if python3 or type(_x) == unicode:
00354         _x = _x.encode('utf-8')
00355         length = len(_x)
00356       buff.write(struct.pack('<I%ss'%length, length, _x))
00357       _x = self
00358       buff.write(_struct_7d.pack(_x.nav_pose.pose.position.x, _x.nav_pose.pose.position.y, _x.nav_pose.pose.position.z, _x.nav_pose.pose.orientation.x, _x.nav_pose.pose.orientation.y, _x.nav_pose.pose.orientation.z, _x.nav_pose.pose.orientation.w))
00359     except struct.error as se: self._check_types(se)
00360     except TypeError as te: self._check_types(te)
00361 
00362   def deserialize_numpy(self, str, numpy):
00363     """
00364     unpack serialized message in str into this message instance using numpy for array types
00365     :param str: byte array of serialized message, ``str``
00366     :param numpy: numpy python module
00367     """
00368     try:
00369       if self.nav_pose is None:
00370         self.nav_pose = geometry_msgs.msg.PoseStamped()
00371       end = 0
00372       _x = self
00373       start = end
00374       end += 12
00375       (_x.nav_pose.header.seq, _x.nav_pose.header.stamp.secs, _x.nav_pose.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00376       start = end
00377       end += 4
00378       (length,) = _struct_I.unpack(str[start:end])
00379       start = end
00380       end += length
00381       if python3:
00382         self.nav_pose.header.frame_id = str[start:end].decode('utf-8')
00383       else:
00384         self.nav_pose.header.frame_id = str[start:end]
00385       _x = self
00386       start = end
00387       end += 56
00388       (_x.nav_pose.pose.position.x, _x.nav_pose.pose.position.y, _x.nav_pose.pose.position.z, _x.nav_pose.pose.orientation.x, _x.nav_pose.pose.orientation.y, _x.nav_pose.pose.orientation.z, _x.nav_pose.pose.orientation.w,) = _struct_7d.unpack(str[start:end])
00389       return self
00390     except struct.error as e:
00391       raise genpy.DeserializationError(e) #most likely buffer underfill
00392 
00393 _struct_I = genpy.struct_I
00394 _struct_3I = struct.Struct("<3I")
00395 _struct_7d = struct.Struct("<7d")
00396 class GetApproachPose(object):
00397   _type          = 'approach_table_tools/GetApproachPose'
00398   _md5sum = 'f9ce8e3046f70d39d88df8fd59d3b51b'
00399   _request_class  = GetApproachPoseRequest
00400   _response_class = GetApproachPoseResponse
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends


approach_table_tools
Author(s):
autogenerated on Thu May 23 2013 14:05:20