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