00001 """autogenerated by genpy from applanix_msgs/GAMSParams.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
00009 class GAMSParams(genpy.Message):
00010 _md5sum = "8dc87272f9e4678c71c9588bfa987256"
00011 _type = "applanix_msgs/GAMSParams"
00012 _has_header = False
00013 _full_text = """# Msg 21
00014 uint16 transaction
00015
00016 float32 antenna_separation
00017
00018 geometry_msgs/Point32 baseline_vector
00019 float32 max_heading_error_rms
00020 float32 heading_correction
00021
00022 ================================================================================
00023 MSG: geometry_msgs/Point32
00024 # This contains the position of a point in free space(with 32 bits of precision).
00025 # It is recommeded to use Point wherever possible instead of Point32.
00026 #
00027 # This recommendation is to promote interoperability.
00028 #
00029 # This message is designed to take up less space when sending
00030 # lots of points at once, as in the case of a PointCloud.
00031
00032 float32 x
00033 float32 y
00034 float32 z
00035 """
00036 __slots__ = ['transaction','antenna_separation','baseline_vector','max_heading_error_rms','heading_correction']
00037 _slot_types = ['uint16','float32','geometry_msgs/Point32','float32','float32']
00038
00039 def __init__(self, *args, **kwds):
00040 """
00041 Constructor. Any message fields that are implicitly/explicitly
00042 set to None will be assigned a default value. The recommend
00043 use is keyword arguments as this is more robust to future message
00044 changes. You cannot mix in-order arguments and keyword arguments.
00045
00046 The available fields are:
00047 transaction,antenna_separation,baseline_vector,max_heading_error_rms,heading_correction
00048
00049 :param args: complete set of field values, in .msg order
00050 :param kwds: use keyword arguments corresponding to message field names
00051 to set specific fields.
00052 """
00053 if args or kwds:
00054 super(GAMSParams, self).__init__(*args, **kwds)
00055
00056 if self.transaction is None:
00057 self.transaction = 0
00058 if self.antenna_separation is None:
00059 self.antenna_separation = 0.
00060 if self.baseline_vector is None:
00061 self.baseline_vector = geometry_msgs.msg.Point32()
00062 if self.max_heading_error_rms is None:
00063 self.max_heading_error_rms = 0.
00064 if self.heading_correction is None:
00065 self.heading_correction = 0.
00066 else:
00067 self.transaction = 0
00068 self.antenna_separation = 0.
00069 self.baseline_vector = geometry_msgs.msg.Point32()
00070 self.max_heading_error_rms = 0.
00071 self.heading_correction = 0.
00072
00073 def _get_types(self):
00074 """
00075 internal API method
00076 """
00077 return self._slot_types
00078
00079 def serialize(self, buff):
00080 """
00081 serialize message into buffer
00082 :param buff: buffer, ``StringIO``
00083 """
00084 try:
00085 _x = self
00086 buff.write(_struct_H6f.pack(_x.transaction, _x.antenna_separation, _x.baseline_vector.x, _x.baseline_vector.y, _x.baseline_vector.z, _x.max_heading_error_rms, _x.heading_correction))
00087 except struct.error as se: self._check_types(se)
00088 except TypeError as te: self._check_types(te)
00089
00090 def deserialize(self, str):
00091 """
00092 unpack serialized message in str into this message instance
00093 :param str: byte array of serialized message, ``str``
00094 """
00095 try:
00096 if self.baseline_vector is None:
00097 self.baseline_vector = geometry_msgs.msg.Point32()
00098 end = 0
00099 _x = self
00100 start = end
00101 end += 26
00102 (_x.transaction, _x.antenna_separation, _x.baseline_vector.x, _x.baseline_vector.y, _x.baseline_vector.z, _x.max_heading_error_rms, _x.heading_correction,) = _struct_H6f.unpack(str[start:end])
00103 return self
00104 except struct.error as e:
00105 raise genpy.DeserializationError(e)
00106
00107
00108 def serialize_numpy(self, buff, numpy):
00109 """
00110 serialize message with numpy array types into buffer
00111 :param buff: buffer, ``StringIO``
00112 :param numpy: numpy python module
00113 """
00114 try:
00115 _x = self
00116 buff.write(_struct_H6f.pack(_x.transaction, _x.antenna_separation, _x.baseline_vector.x, _x.baseline_vector.y, _x.baseline_vector.z, _x.max_heading_error_rms, _x.heading_correction))
00117 except struct.error as se: self._check_types(se)
00118 except TypeError as te: self._check_types(te)
00119
00120 def deserialize_numpy(self, str, numpy):
00121 """
00122 unpack serialized message in str into this message instance using numpy for array types
00123 :param str: byte array of serialized message, ``str``
00124 :param numpy: numpy python module
00125 """
00126 try:
00127 if self.baseline_vector is None:
00128 self.baseline_vector = geometry_msgs.msg.Point32()
00129 end = 0
00130 _x = self
00131 start = end
00132 end += 26
00133 (_x.transaction, _x.antenna_separation, _x.baseline_vector.x, _x.baseline_vector.y, _x.baseline_vector.z, _x.max_heading_error_rms, _x.heading_correction,) = _struct_H6f.unpack(str[start:end])
00134 return self
00135 except struct.error as e:
00136 raise genpy.DeserializationError(e)
00137
00138 _struct_I = genpy.struct_I
00139 _struct_H6f = struct.Struct("<H6f")