00001 """autogenerated by genpy from cob_srvs/GetPoseStampedTransformedRequest.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 GetPoseStampedTransformedRequest(genpy.Message):
00011 _md5sum = "7f6050054c7441aa5c8e1b131c78c448"
00012 _type = "cob_srvs/GetPoseStampedTransformedRequest"
00013 _has_header = False
00014 _full_text = """geometry_msgs/PoseStamped target
00015 geometry_msgs/PoseStamped origin
00016 geometry_msgs/Quaternion orientation_override
00017 string root_name
00018 string tip_name
00019
00020 ================================================================================
00021 MSG: geometry_msgs/PoseStamped
00022 # A Pose with reference coordinate frame and timestamp
00023 Header header
00024 Pose pose
00025
00026 ================================================================================
00027 MSG: std_msgs/Header
00028 # Standard metadata for higher-level stamped data types.
00029 # This is generally used to communicate timestamped data
00030 # in a particular coordinate frame.
00031 #
00032 # sequence ID: consecutively increasing ID
00033 uint32 seq
00034 #Two-integer timestamp that is expressed as:
00035 # * stamp.secs: seconds (stamp_secs) since epoch
00036 # * stamp.nsecs: nanoseconds since stamp_secs
00037 # time-handling sugar is provided by the client library
00038 time stamp
00039 #Frame this data is associated with
00040 # 0: no frame
00041 # 1: global frame
00042 string frame_id
00043
00044 ================================================================================
00045 MSG: geometry_msgs/Pose
00046 # A representation of pose in free space, composed of postion and orientation.
00047 Point position
00048 Quaternion orientation
00049
00050 ================================================================================
00051 MSG: geometry_msgs/Point
00052 # This contains the position of a point in free space
00053 float64 x
00054 float64 y
00055 float64 z
00056
00057 ================================================================================
00058 MSG: geometry_msgs/Quaternion
00059 # This represents an orientation in free space in quaternion form.
00060
00061 float64 x
00062 float64 y
00063 float64 z
00064 float64 w
00065
00066 """
00067 __slots__ = ['target','origin','orientation_override','root_name','tip_name']
00068 _slot_types = ['geometry_msgs/PoseStamped','geometry_msgs/PoseStamped','geometry_msgs/Quaternion','string','string']
00069
00070 def __init__(self, *args, **kwds):
00071 """
00072 Constructor. Any message fields that are implicitly/explicitly
00073 set to None will be assigned a default value. The recommend
00074 use is keyword arguments as this is more robust to future message
00075 changes. You cannot mix in-order arguments and keyword arguments.
00076
00077 The available fields are:
00078 target,origin,orientation_override,root_name,tip_name
00079
00080 :param args: complete set of field values, in .msg order
00081 :param kwds: use keyword arguments corresponding to message field names
00082 to set specific fields.
00083 """
00084 if args or kwds:
00085 super(GetPoseStampedTransformedRequest, self).__init__(*args, **kwds)
00086
00087 if self.target is None:
00088 self.target = geometry_msgs.msg.PoseStamped()
00089 if self.origin is None:
00090 self.origin = geometry_msgs.msg.PoseStamped()
00091 if self.orientation_override is None:
00092 self.orientation_override = geometry_msgs.msg.Quaternion()
00093 if self.root_name is None:
00094 self.root_name = ''
00095 if self.tip_name is None:
00096 self.tip_name = ''
00097 else:
00098 self.target = geometry_msgs.msg.PoseStamped()
00099 self.origin = geometry_msgs.msg.PoseStamped()
00100 self.orientation_override = geometry_msgs.msg.Quaternion()
00101 self.root_name = ''
00102 self.tip_name = ''
00103
00104 def _get_types(self):
00105 """
00106 internal API method
00107 """
00108 return self._slot_types
00109
00110 def serialize(self, buff):
00111 """
00112 serialize message into buffer
00113 :param buff: buffer, ``StringIO``
00114 """
00115 try:
00116 _x = self
00117 buff.write(_struct_3I.pack(_x.target.header.seq, _x.target.header.stamp.secs, _x.target.header.stamp.nsecs))
00118 _x = self.target.header.frame_id
00119 length = len(_x)
00120 if python3 or type(_x) == unicode:
00121 _x = _x.encode('utf-8')
00122 length = len(_x)
00123 buff.write(struct.pack('<I%ss'%length, length, _x))
00124 _x = self
00125 buff.write(_struct_7d3I.pack(_x.target.pose.position.x, _x.target.pose.position.y, _x.target.pose.position.z, _x.target.pose.orientation.x, _x.target.pose.orientation.y, _x.target.pose.orientation.z, _x.target.pose.orientation.w, _x.origin.header.seq, _x.origin.header.stamp.secs, _x.origin.header.stamp.nsecs))
00126 _x = self.origin.header.frame_id
00127 length = len(_x)
00128 if python3 or type(_x) == unicode:
00129 _x = _x.encode('utf-8')
00130 length = len(_x)
00131 buff.write(struct.pack('<I%ss'%length, length, _x))
00132 _x = self
00133 buff.write(_struct_11d.pack(_x.origin.pose.position.x, _x.origin.pose.position.y, _x.origin.pose.position.z, _x.origin.pose.orientation.x, _x.origin.pose.orientation.y, _x.origin.pose.orientation.z, _x.origin.pose.orientation.w, _x.orientation_override.x, _x.orientation_override.y, _x.orientation_override.z, _x.orientation_override.w))
00134 _x = self.root_name
00135 length = len(_x)
00136 if python3 or type(_x) == unicode:
00137 _x = _x.encode('utf-8')
00138 length = len(_x)
00139 buff.write(struct.pack('<I%ss'%length, length, _x))
00140 _x = self.tip_name
00141 length = len(_x)
00142 if python3 or type(_x) == unicode:
00143 _x = _x.encode('utf-8')
00144 length = len(_x)
00145 buff.write(struct.pack('<I%ss'%length, length, _x))
00146 except struct.error as se: self._check_types(se)
00147 except TypeError as te: self._check_types(te)
00148
00149 def deserialize(self, str):
00150 """
00151 unpack serialized message in str into this message instance
00152 :param str: byte array of serialized message, ``str``
00153 """
00154 try:
00155 if self.target is None:
00156 self.target = geometry_msgs.msg.PoseStamped()
00157 if self.origin is None:
00158 self.origin = geometry_msgs.msg.PoseStamped()
00159 if self.orientation_override is None:
00160 self.orientation_override = geometry_msgs.msg.Quaternion()
00161 end = 0
00162 _x = self
00163 start = end
00164 end += 12
00165 (_x.target.header.seq, _x.target.header.stamp.secs, _x.target.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00166 start = end
00167 end += 4
00168 (length,) = _struct_I.unpack(str[start:end])
00169 start = end
00170 end += length
00171 if python3:
00172 self.target.header.frame_id = str[start:end].decode('utf-8')
00173 else:
00174 self.target.header.frame_id = str[start:end]
00175 _x = self
00176 start = end
00177 end += 68
00178 (_x.target.pose.position.x, _x.target.pose.position.y, _x.target.pose.position.z, _x.target.pose.orientation.x, _x.target.pose.orientation.y, _x.target.pose.orientation.z, _x.target.pose.orientation.w, _x.origin.header.seq, _x.origin.header.stamp.secs, _x.origin.header.stamp.nsecs,) = _struct_7d3I.unpack(str[start:end])
00179 start = end
00180 end += 4
00181 (length,) = _struct_I.unpack(str[start:end])
00182 start = end
00183 end += length
00184 if python3:
00185 self.origin.header.frame_id = str[start:end].decode('utf-8')
00186 else:
00187 self.origin.header.frame_id = str[start:end]
00188 _x = self
00189 start = end
00190 end += 88
00191 (_x.origin.pose.position.x, _x.origin.pose.position.y, _x.origin.pose.position.z, _x.origin.pose.orientation.x, _x.origin.pose.orientation.y, _x.origin.pose.orientation.z, _x.origin.pose.orientation.w, _x.orientation_override.x, _x.orientation_override.y, _x.orientation_override.z, _x.orientation_override.w,) = _struct_11d.unpack(str[start:end])
00192 start = end
00193 end += 4
00194 (length,) = _struct_I.unpack(str[start:end])
00195 start = end
00196 end += length
00197 if python3:
00198 self.root_name = str[start:end].decode('utf-8')
00199 else:
00200 self.root_name = str[start:end]
00201 start = end
00202 end += 4
00203 (length,) = _struct_I.unpack(str[start:end])
00204 start = end
00205 end += length
00206 if python3:
00207 self.tip_name = str[start:end].decode('utf-8')
00208 else:
00209 self.tip_name = str[start:end]
00210 return self
00211 except struct.error as e:
00212 raise genpy.DeserializationError(e)
00213
00214
00215 def serialize_numpy(self, buff, numpy):
00216 """
00217 serialize message with numpy array types into buffer
00218 :param buff: buffer, ``StringIO``
00219 :param numpy: numpy python module
00220 """
00221 try:
00222 _x = self
00223 buff.write(_struct_3I.pack(_x.target.header.seq, _x.target.header.stamp.secs, _x.target.header.stamp.nsecs))
00224 _x = self.target.header.frame_id
00225 length = len(_x)
00226 if python3 or type(_x) == unicode:
00227 _x = _x.encode('utf-8')
00228 length = len(_x)
00229 buff.write(struct.pack('<I%ss'%length, length, _x))
00230 _x = self
00231 buff.write(_struct_7d3I.pack(_x.target.pose.position.x, _x.target.pose.position.y, _x.target.pose.position.z, _x.target.pose.orientation.x, _x.target.pose.orientation.y, _x.target.pose.orientation.z, _x.target.pose.orientation.w, _x.origin.header.seq, _x.origin.header.stamp.secs, _x.origin.header.stamp.nsecs))
00232 _x = self.origin.header.frame_id
00233 length = len(_x)
00234 if python3 or type(_x) == unicode:
00235 _x = _x.encode('utf-8')
00236 length = len(_x)
00237 buff.write(struct.pack('<I%ss'%length, length, _x))
00238 _x = self
00239 buff.write(_struct_11d.pack(_x.origin.pose.position.x, _x.origin.pose.position.y, _x.origin.pose.position.z, _x.origin.pose.orientation.x, _x.origin.pose.orientation.y, _x.origin.pose.orientation.z, _x.origin.pose.orientation.w, _x.orientation_override.x, _x.orientation_override.y, _x.orientation_override.z, _x.orientation_override.w))
00240 _x = self.root_name
00241 length = len(_x)
00242 if python3 or type(_x) == unicode:
00243 _x = _x.encode('utf-8')
00244 length = len(_x)
00245 buff.write(struct.pack('<I%ss'%length, length, _x))
00246 _x = self.tip_name
00247 length = len(_x)
00248 if python3 or type(_x) == unicode:
00249 _x = _x.encode('utf-8')
00250 length = len(_x)
00251 buff.write(struct.pack('<I%ss'%length, length, _x))
00252 except struct.error as se: self._check_types(se)
00253 except TypeError as te: self._check_types(te)
00254
00255 def deserialize_numpy(self, str, numpy):
00256 """
00257 unpack serialized message in str into this message instance using numpy for array types
00258 :param str: byte array of serialized message, ``str``
00259 :param numpy: numpy python module
00260 """
00261 try:
00262 if self.target is None:
00263 self.target = geometry_msgs.msg.PoseStamped()
00264 if self.origin is None:
00265 self.origin = geometry_msgs.msg.PoseStamped()
00266 if self.orientation_override is None:
00267 self.orientation_override = geometry_msgs.msg.Quaternion()
00268 end = 0
00269 _x = self
00270 start = end
00271 end += 12
00272 (_x.target.header.seq, _x.target.header.stamp.secs, _x.target.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00273 start = end
00274 end += 4
00275 (length,) = _struct_I.unpack(str[start:end])
00276 start = end
00277 end += length
00278 if python3:
00279 self.target.header.frame_id = str[start:end].decode('utf-8')
00280 else:
00281 self.target.header.frame_id = str[start:end]
00282 _x = self
00283 start = end
00284 end += 68
00285 (_x.target.pose.position.x, _x.target.pose.position.y, _x.target.pose.position.z, _x.target.pose.orientation.x, _x.target.pose.orientation.y, _x.target.pose.orientation.z, _x.target.pose.orientation.w, _x.origin.header.seq, _x.origin.header.stamp.secs, _x.origin.header.stamp.nsecs,) = _struct_7d3I.unpack(str[start:end])
00286 start = end
00287 end += 4
00288 (length,) = _struct_I.unpack(str[start:end])
00289 start = end
00290 end += length
00291 if python3:
00292 self.origin.header.frame_id = str[start:end].decode('utf-8')
00293 else:
00294 self.origin.header.frame_id = str[start:end]
00295 _x = self
00296 start = end
00297 end += 88
00298 (_x.origin.pose.position.x, _x.origin.pose.position.y, _x.origin.pose.position.z, _x.origin.pose.orientation.x, _x.origin.pose.orientation.y, _x.origin.pose.orientation.z, _x.origin.pose.orientation.w, _x.orientation_override.x, _x.orientation_override.y, _x.orientation_override.z, _x.orientation_override.w,) = _struct_11d.unpack(str[start:end])
00299 start = end
00300 end += 4
00301 (length,) = _struct_I.unpack(str[start:end])
00302 start = end
00303 end += length
00304 if python3:
00305 self.root_name = str[start:end].decode('utf-8')
00306 else:
00307 self.root_name = str[start:end]
00308 start = end
00309 end += 4
00310 (length,) = _struct_I.unpack(str[start:end])
00311 start = end
00312 end += length
00313 if python3:
00314 self.tip_name = str[start:end].decode('utf-8')
00315 else:
00316 self.tip_name = str[start:end]
00317 return self
00318 except struct.error as e:
00319 raise genpy.DeserializationError(e)
00320
00321 _struct_I = genpy.struct_I
00322 _struct_11d = struct.Struct("<11d")
00323 _struct_3I = struct.Struct("<3I")
00324 _struct_7d3I = struct.Struct("<7d3I")
00325 """autogenerated by genpy from cob_srvs/GetPoseStampedTransformedResponse.msg. Do not edit."""
00326 import sys
00327 python3 = True if sys.hexversion > 0x03000000 else False
00328 import genpy
00329 import struct
00330
00331 import geometry_msgs.msg
00332 import std_msgs.msg
00333
00334 class GetPoseStampedTransformedResponse(genpy.Message):
00335 _md5sum = "aa1ecfaaa2557395e49e336255c7a317"
00336 _type = "cob_srvs/GetPoseStampedTransformedResponse"
00337 _has_header = False
00338 _full_text = """bool success
00339 geometry_msgs/PoseStamped result
00340
00341
00342 ================================================================================
00343 MSG: geometry_msgs/PoseStamped
00344 # A Pose with reference coordinate frame and timestamp
00345 Header header
00346 Pose pose
00347
00348 ================================================================================
00349 MSG: std_msgs/Header
00350 # Standard metadata for higher-level stamped data types.
00351 # This is generally used to communicate timestamped data
00352 # in a particular coordinate frame.
00353 #
00354 # sequence ID: consecutively increasing ID
00355 uint32 seq
00356 #Two-integer timestamp that is expressed as:
00357 # * stamp.secs: seconds (stamp_secs) since epoch
00358 # * stamp.nsecs: nanoseconds since stamp_secs
00359 # time-handling sugar is provided by the client library
00360 time stamp
00361 #Frame this data is associated with
00362 # 0: no frame
00363 # 1: global frame
00364 string frame_id
00365
00366 ================================================================================
00367 MSG: geometry_msgs/Pose
00368 # A representation of pose in free space, composed of postion and orientation.
00369 Point position
00370 Quaternion orientation
00371
00372 ================================================================================
00373 MSG: geometry_msgs/Point
00374 # This contains the position of a point in free space
00375 float64 x
00376 float64 y
00377 float64 z
00378
00379 ================================================================================
00380 MSG: geometry_msgs/Quaternion
00381 # This represents an orientation in free space in quaternion form.
00382
00383 float64 x
00384 float64 y
00385 float64 z
00386 float64 w
00387
00388 """
00389 __slots__ = ['success','result']
00390 _slot_types = ['bool','geometry_msgs/PoseStamped']
00391
00392 def __init__(self, *args, **kwds):
00393 """
00394 Constructor. Any message fields that are implicitly/explicitly
00395 set to None will be assigned a default value. The recommend
00396 use is keyword arguments as this is more robust to future message
00397 changes. You cannot mix in-order arguments and keyword arguments.
00398
00399 The available fields are:
00400 success,result
00401
00402 :param args: complete set of field values, in .msg order
00403 :param kwds: use keyword arguments corresponding to message field names
00404 to set specific fields.
00405 """
00406 if args or kwds:
00407 super(GetPoseStampedTransformedResponse, self).__init__(*args, **kwds)
00408
00409 if self.success is None:
00410 self.success = False
00411 if self.result is None:
00412 self.result = geometry_msgs.msg.PoseStamped()
00413 else:
00414 self.success = False
00415 self.result = geometry_msgs.msg.PoseStamped()
00416
00417 def _get_types(self):
00418 """
00419 internal API method
00420 """
00421 return self._slot_types
00422
00423 def serialize(self, buff):
00424 """
00425 serialize message into buffer
00426 :param buff: buffer, ``StringIO``
00427 """
00428 try:
00429 _x = self
00430 buff.write(_struct_B3I.pack(_x.success, _x.result.header.seq, _x.result.header.stamp.secs, _x.result.header.stamp.nsecs))
00431 _x = self.result.header.frame_id
00432 length = len(_x)
00433 if python3 or type(_x) == unicode:
00434 _x = _x.encode('utf-8')
00435 length = len(_x)
00436 buff.write(struct.pack('<I%ss'%length, length, _x))
00437 _x = self
00438 buff.write(_struct_7d.pack(_x.result.pose.position.x, _x.result.pose.position.y, _x.result.pose.position.z, _x.result.pose.orientation.x, _x.result.pose.orientation.y, _x.result.pose.orientation.z, _x.result.pose.orientation.w))
00439 except struct.error as se: self._check_types(se)
00440 except TypeError as te: self._check_types(te)
00441
00442 def deserialize(self, str):
00443 """
00444 unpack serialized message in str into this message instance
00445 :param str: byte array of serialized message, ``str``
00446 """
00447 try:
00448 if self.result is None:
00449 self.result = geometry_msgs.msg.PoseStamped()
00450 end = 0
00451 _x = self
00452 start = end
00453 end += 13
00454 (_x.success, _x.result.header.seq, _x.result.header.stamp.secs, _x.result.header.stamp.nsecs,) = _struct_B3I.unpack(str[start:end])
00455 self.success = bool(self.success)
00456 start = end
00457 end += 4
00458 (length,) = _struct_I.unpack(str[start:end])
00459 start = end
00460 end += length
00461 if python3:
00462 self.result.header.frame_id = str[start:end].decode('utf-8')
00463 else:
00464 self.result.header.frame_id = str[start:end]
00465 _x = self
00466 start = end
00467 end += 56
00468 (_x.result.pose.position.x, _x.result.pose.position.y, _x.result.pose.position.z, _x.result.pose.orientation.x, _x.result.pose.orientation.y, _x.result.pose.orientation.z, _x.result.pose.orientation.w,) = _struct_7d.unpack(str[start:end])
00469 return self
00470 except struct.error as e:
00471 raise genpy.DeserializationError(e)
00472
00473
00474 def serialize_numpy(self, buff, numpy):
00475 """
00476 serialize message with numpy array types into buffer
00477 :param buff: buffer, ``StringIO``
00478 :param numpy: numpy python module
00479 """
00480 try:
00481 _x = self
00482 buff.write(_struct_B3I.pack(_x.success, _x.result.header.seq, _x.result.header.stamp.secs, _x.result.header.stamp.nsecs))
00483 _x = self.result.header.frame_id
00484 length = len(_x)
00485 if python3 or type(_x) == unicode:
00486 _x = _x.encode('utf-8')
00487 length = len(_x)
00488 buff.write(struct.pack('<I%ss'%length, length, _x))
00489 _x = self
00490 buff.write(_struct_7d.pack(_x.result.pose.position.x, _x.result.pose.position.y, _x.result.pose.position.z, _x.result.pose.orientation.x, _x.result.pose.orientation.y, _x.result.pose.orientation.z, _x.result.pose.orientation.w))
00491 except struct.error as se: self._check_types(se)
00492 except TypeError as te: self._check_types(te)
00493
00494 def deserialize_numpy(self, str, numpy):
00495 """
00496 unpack serialized message in str into this message instance using numpy for array types
00497 :param str: byte array of serialized message, ``str``
00498 :param numpy: numpy python module
00499 """
00500 try:
00501 if self.result is None:
00502 self.result = geometry_msgs.msg.PoseStamped()
00503 end = 0
00504 _x = self
00505 start = end
00506 end += 13
00507 (_x.success, _x.result.header.seq, _x.result.header.stamp.secs, _x.result.header.stamp.nsecs,) = _struct_B3I.unpack(str[start:end])
00508 self.success = bool(self.success)
00509 start = end
00510 end += 4
00511 (length,) = _struct_I.unpack(str[start:end])
00512 start = end
00513 end += length
00514 if python3:
00515 self.result.header.frame_id = str[start:end].decode('utf-8')
00516 else:
00517 self.result.header.frame_id = str[start:end]
00518 _x = self
00519 start = end
00520 end += 56
00521 (_x.result.pose.position.x, _x.result.pose.position.y, _x.result.pose.position.z, _x.result.pose.orientation.x, _x.result.pose.orientation.y, _x.result.pose.orientation.z, _x.result.pose.orientation.w,) = _struct_7d.unpack(str[start:end])
00522 return self
00523 except struct.error as e:
00524 raise genpy.DeserializationError(e)
00525
00526 _struct_I = genpy.struct_I
00527 _struct_7d = struct.Struct("<7d")
00528 _struct_B3I = struct.Struct("<B3I")
00529 class GetPoseStampedTransformed(object):
00530 _type = 'cob_srvs/GetPoseStampedTransformed'
00531 _md5sum = 'ed0069a0a6ce5102fc39c3328eef052f'
00532 _request_class = GetPoseStampedTransformedRequest
00533 _response_class = GetPoseStampedTransformedResponse