00001 """autogenerated by genmsg_py from ScanAction.msg. Do not edit."""
00002 import roslib.message
00003 import struct
00004
00005 import wpa_supplicant_node.msg
00006 import roslib.rostime
00007 import actionlib_msgs.msg
00008 import std_msgs.msg
00009
00010 class ScanAction(roslib.message.Message):
00011 _md5sum = "4b585fa9a57df9454c69f9d310ae950a"
00012 _type = "wpa_supplicant_node/ScanAction"
00013 _has_header = False
00014 _full_text = """# ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00015
00016 ScanActionGoal action_goal
00017 ScanActionResult action_result
00018 ScanActionFeedback action_feedback
00019
00020 ================================================================================
00021 MSG: wpa_supplicant_node/ScanActionGoal
00022 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00023
00024 Header header
00025 actionlib_msgs/GoalID goal_id
00026 ScanGoal goal
00027
00028 ================================================================================
00029 MSG: std_msgs/Header
00030 # Standard metadata for higher-level stamped data types.
00031 # This is generally used to communicate timestamped data
00032 # in a particular coordinate frame.
00033 #
00034 # sequence ID: consecutively increasing ID
00035 uint32 seq
00036 #Two-integer timestamp that is expressed as:
00037 # * stamp.secs: seconds (stamp_secs) since epoch
00038 # * stamp.nsecs: nanoseconds since stamp_secs
00039 # time-handling sugar is provided by the client library
00040 time stamp
00041 #Frame this data is associated with
00042 # 0: no frame
00043 # 1: global frame
00044 string frame_id
00045
00046 ================================================================================
00047 MSG: actionlib_msgs/GoalID
00048 # The stamp should store the time at which this goal was requested.
00049 # It is used by an action server when it tries to preempt all
00050 # goals that were requested before a certain time
00051 time stamp
00052
00053 # The id provides a way to associate feedback and
00054 # result message with specific goal requests. The id
00055 # specified must be unique.
00056 string id
00057
00058
00059 ================================================================================
00060 MSG: wpa_supplicant_node/ScanGoal
00061 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00062 string[] ssids # Ssids to scan
00063 int32[] frequencies # Channels to scan in MHz
00064
00065 ================================================================================
00066 MSG: wpa_supplicant_node/ScanActionResult
00067 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00068
00069 Header header
00070 actionlib_msgs/GoalStatus status
00071 ScanResult result
00072
00073 ================================================================================
00074 MSG: actionlib_msgs/GoalStatus
00075 GoalID goal_id
00076 uint8 status
00077 uint8 PENDING = 0 # The goal has yet to be processed by the action server
00078 uint8 ACTIVE = 1 # The goal is currently being processed by the action server
00079 uint8 PREEMPTED = 2 # The goal received a cancel request after it started executing
00080 # and has since completed its execution (Terminal State)
00081 uint8 SUCCEEDED = 3 # The goal was achieved successfully by the action server (Terminal State)
00082 uint8 ABORTED = 4 # The goal was aborted during execution by the action server due
00083 # to some failure (Terminal State)
00084 uint8 REJECTED = 5 # The goal was rejected by the action server without being processed,
00085 # because the goal was unattainable or invalid (Terminal State)
00086 uint8 PREEMPTING = 6 # The goal received a cancel request after it started executing
00087 # and has not yet completed execution
00088 uint8 RECALLING = 7 # The goal received a cancel request before it started executing,
00089 # but the action server has not yet confirmed that the goal is canceled
00090 uint8 RECALLED = 8 # The goal received a cancel request before it started executing
00091 # and was successfully cancelled (Terminal State)
00092 uint8 LOST = 9 # An action client can determine that a goal is LOST. This should not be
00093 # sent over the wire by an action server
00094
00095 #Allow for the user to associate a string with GoalStatus for debugging
00096 string text
00097
00098
00099 ================================================================================
00100 MSG: wpa_supplicant_node/ScanResult
00101 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00102 #int32 SUCCESS = 0
00103 #int32 TOO_MANY_SSIDS = 1
00104 #int32 TOO_MANY_CHANNELS = 2
00105 #int32 SCAN_REQUEST_FAILED = 3
00106 #int32 SCAN_REQUEST_TIMED_OUT = 4
00107 #
00108 bool success
00109 Bss[] bss
00110
00111 ================================================================================
00112 MSG: wpa_supplicant_node/Bss
00113 time stamp
00114 string ssid
00115 uint8[6] bssid
00116 int32 frequency # In MHz
00117 int16 beacon_interval
00118 int16 capabilities
00119 int32 quality
00120 int32 noise
00121 int32 level
00122
00123 #InformationElement []ies
00124 #InformationElement []beacon_ies
00125 # flags
00126 # tsf
00127 # age
00128
00129 ================================================================================
00130 MSG: wpa_supplicant_node/ScanActionFeedback
00131 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00132
00133 Header header
00134 actionlib_msgs/GoalStatus status
00135 ScanFeedback feedback
00136
00137 ================================================================================
00138 MSG: wpa_supplicant_node/ScanFeedback
00139 # ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00140
00141
00142 """
00143 __slots__ = ['action_goal','action_result','action_feedback']
00144 _slot_types = ['wpa_supplicant_node/ScanActionGoal','wpa_supplicant_node/ScanActionResult','wpa_supplicant_node/ScanActionFeedback']
00145
00146 def __init__(self, *args, **kwds):
00147 """
00148 Constructor. Any message fields that are implicitly/explicitly
00149 set to None will be assigned a default value. The recommend
00150 use is keyword arguments as this is more robust to future message
00151 changes. You cannot mix in-order arguments and keyword arguments.
00152
00153 The available fields are:
00154 action_goal,action_result,action_feedback
00155
00156 @param args: complete set of field values, in .msg order
00157 @param kwds: use keyword arguments corresponding to message field names
00158 to set specific fields.
00159 """
00160 if args or kwds:
00161 super(ScanAction, self).__init__(*args, **kwds)
00162
00163 if self.action_goal is None:
00164 self.action_goal = wpa_supplicant_node.msg.ScanActionGoal()
00165 if self.action_result is None:
00166 self.action_result = wpa_supplicant_node.msg.ScanActionResult()
00167 if self.action_feedback is None:
00168 self.action_feedback = wpa_supplicant_node.msg.ScanActionFeedback()
00169 else:
00170 self.action_goal = wpa_supplicant_node.msg.ScanActionGoal()
00171 self.action_result = wpa_supplicant_node.msg.ScanActionResult()
00172 self.action_feedback = wpa_supplicant_node.msg.ScanActionFeedback()
00173
00174 def _get_types(self):
00175 """
00176 internal API method
00177 """
00178 return self._slot_types
00179
00180 def serialize(self, buff):
00181 """
00182 serialize message into buffer
00183 @param buff: buffer
00184 @type buff: StringIO
00185 """
00186 try:
00187 _x = self
00188 buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00189 _x = self.action_goal.header.frame_id
00190 length = len(_x)
00191 buff.write(struct.pack('<I%ss'%length, length, _x))
00192 _x = self
00193 buff.write(_struct_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00194 _x = self.action_goal.goal_id.id
00195 length = len(_x)
00196 buff.write(struct.pack('<I%ss'%length, length, _x))
00197 length = len(self.action_goal.goal.ssids)
00198 buff.write(_struct_I.pack(length))
00199 for val1 in self.action_goal.goal.ssids:
00200 length = len(val1)
00201 buff.write(struct.pack('<I%ss'%length, length, val1))
00202 length = len(self.action_goal.goal.frequencies)
00203 buff.write(_struct_I.pack(length))
00204 pattern = '<%si'%length
00205 buff.write(struct.pack(pattern, *self.action_goal.goal.frequencies))
00206 _x = self
00207 buff.write(_struct_3I.pack(_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00208 _x = self.action_result.header.frame_id
00209 length = len(_x)
00210 buff.write(struct.pack('<I%ss'%length, length, _x))
00211 _x = self
00212 buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00213 _x = self.action_result.status.goal_id.id
00214 length = len(_x)
00215 buff.write(struct.pack('<I%ss'%length, length, _x))
00216 buff.write(_struct_B.pack(self.action_result.status.status))
00217 _x = self.action_result.status.text
00218 length = len(_x)
00219 buff.write(struct.pack('<I%ss'%length, length, _x))
00220 buff.write(_struct_B.pack(self.action_result.result.success))
00221 length = len(self.action_result.result.bss)
00222 buff.write(_struct_I.pack(length))
00223 for val1 in self.action_result.result.bss:
00224 _v1 = val1.stamp
00225 _x = _v1
00226 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
00227 _x = val1.ssid
00228 length = len(_x)
00229 buff.write(struct.pack('<I%ss'%length, length, _x))
00230 _x = val1.bssid
00231
00232 if type(_x) in [list, tuple]:
00233 buff.write(_struct_6B.pack(*_x))
00234 else:
00235 buff.write(_struct_6s.pack(_x))
00236 _x = val1
00237 buff.write(_struct_i2h3i.pack(_x.frequency, _x.beacon_interval, _x.capabilities, _x.quality, _x.noise, _x.level))
00238 _x = self
00239 buff.write(_struct_3I.pack(_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00240 _x = self.action_feedback.header.frame_id
00241 length = len(_x)
00242 buff.write(struct.pack('<I%ss'%length, length, _x))
00243 _x = self
00244 buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00245 _x = self.action_feedback.status.goal_id.id
00246 length = len(_x)
00247 buff.write(struct.pack('<I%ss'%length, length, _x))
00248 buff.write(_struct_B.pack(self.action_feedback.status.status))
00249 _x = self.action_feedback.status.text
00250 length = len(_x)
00251 buff.write(struct.pack('<I%ss'%length, length, _x))
00252 except struct.error, se: self._check_types(se)
00253 except TypeError, te: self._check_types(te)
00254
00255 def deserialize(self, str):
00256 """
00257 unpack serialized message in str into this message instance
00258 @param str: byte array of serialized message
00259 @type str: str
00260 """
00261 try:
00262 if self.action_goal is None:
00263 self.action_goal = wpa_supplicant_node.msg.ScanActionGoal()
00264 if self.action_result is None:
00265 self.action_result = wpa_supplicant_node.msg.ScanActionResult()
00266 if self.action_feedback is None:
00267 self.action_feedback = wpa_supplicant_node.msg.ScanActionFeedback()
00268 end = 0
00269 _x = self
00270 start = end
00271 end += 12
00272 (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.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 self.action_goal.header.frame_id = str[start:end]
00279 _x = self
00280 start = end
00281 end += 8
00282 (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00283 start = end
00284 end += 4
00285 (length,) = _struct_I.unpack(str[start:end])
00286 start = end
00287 end += length
00288 self.action_goal.goal_id.id = str[start:end]
00289 start = end
00290 end += 4
00291 (length,) = _struct_I.unpack(str[start:end])
00292 self.action_goal.goal.ssids = []
00293 for i in xrange(0, length):
00294 start = end
00295 end += 4
00296 (length,) = _struct_I.unpack(str[start:end])
00297 start = end
00298 end += length
00299 val1 = str[start:end]
00300 self.action_goal.goal.ssids.append(val1)
00301 start = end
00302 end += 4
00303 (length,) = _struct_I.unpack(str[start:end])
00304 pattern = '<%si'%length
00305 start = end
00306 end += struct.calcsize(pattern)
00307 self.action_goal.goal.frequencies = struct.unpack(pattern, str[start:end])
00308 _x = self
00309 start = end
00310 end += 12
00311 (_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00312 start = end
00313 end += 4
00314 (length,) = _struct_I.unpack(str[start:end])
00315 start = end
00316 end += length
00317 self.action_result.header.frame_id = str[start:end]
00318 _x = self
00319 start = end
00320 end += 8
00321 (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00322 start = end
00323 end += 4
00324 (length,) = _struct_I.unpack(str[start:end])
00325 start = end
00326 end += length
00327 self.action_result.status.goal_id.id = str[start:end]
00328 start = end
00329 end += 1
00330 (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00331 start = end
00332 end += 4
00333 (length,) = _struct_I.unpack(str[start:end])
00334 start = end
00335 end += length
00336 self.action_result.status.text = str[start:end]
00337 start = end
00338 end += 1
00339 (self.action_result.result.success,) = _struct_B.unpack(str[start:end])
00340 self.action_result.result.success = bool(self.action_result.result.success)
00341 start = end
00342 end += 4
00343 (length,) = _struct_I.unpack(str[start:end])
00344 self.action_result.result.bss = []
00345 for i in xrange(0, length):
00346 val1 = wpa_supplicant_node.msg.Bss()
00347 _v2 = val1.stamp
00348 _x = _v2
00349 start = end
00350 end += 8
00351 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
00352 start = end
00353 end += 4
00354 (length,) = _struct_I.unpack(str[start:end])
00355 start = end
00356 end += length
00357 val1.ssid = str[start:end]
00358 start = end
00359 end += 6
00360 val1.bssid = str[start:end]
00361 _x = val1
00362 start = end
00363 end += 20
00364 (_x.frequency, _x.beacon_interval, _x.capabilities, _x.quality, _x.noise, _x.level,) = _struct_i2h3i.unpack(str[start:end])
00365 self.action_result.result.bss.append(val1)
00366 _x = self
00367 start = end
00368 end += 12
00369 (_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00370 start = end
00371 end += 4
00372 (length,) = _struct_I.unpack(str[start:end])
00373 start = end
00374 end += length
00375 self.action_feedback.header.frame_id = str[start:end]
00376 _x = self
00377 start = end
00378 end += 8
00379 (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00380 start = end
00381 end += 4
00382 (length,) = _struct_I.unpack(str[start:end])
00383 start = end
00384 end += length
00385 self.action_feedback.status.goal_id.id = str[start:end]
00386 start = end
00387 end += 1
00388 (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00389 start = end
00390 end += 4
00391 (length,) = _struct_I.unpack(str[start:end])
00392 start = end
00393 end += length
00394 self.action_feedback.status.text = str[start:end]
00395 return self
00396 except struct.error, e:
00397 raise roslib.message.DeserializationError(e)
00398
00399
00400 def serialize_numpy(self, buff, numpy):
00401 """
00402 serialize message with numpy array types into buffer
00403 @param buff: buffer
00404 @type buff: StringIO
00405 @param numpy: numpy python module
00406 @type numpy module
00407 """
00408 try:
00409 _x = self
00410 buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00411 _x = self.action_goal.header.frame_id
00412 length = len(_x)
00413 buff.write(struct.pack('<I%ss'%length, length, _x))
00414 _x = self
00415 buff.write(_struct_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00416 _x = self.action_goal.goal_id.id
00417 length = len(_x)
00418 buff.write(struct.pack('<I%ss'%length, length, _x))
00419 length = len(self.action_goal.goal.ssids)
00420 buff.write(_struct_I.pack(length))
00421 for val1 in self.action_goal.goal.ssids:
00422 length = len(val1)
00423 buff.write(struct.pack('<I%ss'%length, length, val1))
00424 length = len(self.action_goal.goal.frequencies)
00425 buff.write(_struct_I.pack(length))
00426 pattern = '<%si'%length
00427 buff.write(self.action_goal.goal.frequencies.tostring())
00428 _x = self
00429 buff.write(_struct_3I.pack(_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00430 _x = self.action_result.header.frame_id
00431 length = len(_x)
00432 buff.write(struct.pack('<I%ss'%length, length, _x))
00433 _x = self
00434 buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00435 _x = self.action_result.status.goal_id.id
00436 length = len(_x)
00437 buff.write(struct.pack('<I%ss'%length, length, _x))
00438 buff.write(_struct_B.pack(self.action_result.status.status))
00439 _x = self.action_result.status.text
00440 length = len(_x)
00441 buff.write(struct.pack('<I%ss'%length, length, _x))
00442 buff.write(_struct_B.pack(self.action_result.result.success))
00443 length = len(self.action_result.result.bss)
00444 buff.write(_struct_I.pack(length))
00445 for val1 in self.action_result.result.bss:
00446 _v3 = val1.stamp
00447 _x = _v3
00448 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
00449 _x = val1.ssid
00450 length = len(_x)
00451 buff.write(struct.pack('<I%ss'%length, length, _x))
00452 _x = val1.bssid
00453
00454 if type(_x) in [list, tuple]:
00455 buff.write(_struct_6B.pack(*_x))
00456 else:
00457 buff.write(_struct_6s.pack(_x))
00458 _x = val1
00459 buff.write(_struct_i2h3i.pack(_x.frequency, _x.beacon_interval, _x.capabilities, _x.quality, _x.noise, _x.level))
00460 _x = self
00461 buff.write(_struct_3I.pack(_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00462 _x = self.action_feedback.header.frame_id
00463 length = len(_x)
00464 buff.write(struct.pack('<I%ss'%length, length, _x))
00465 _x = self
00466 buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00467 _x = self.action_feedback.status.goal_id.id
00468 length = len(_x)
00469 buff.write(struct.pack('<I%ss'%length, length, _x))
00470 buff.write(_struct_B.pack(self.action_feedback.status.status))
00471 _x = self.action_feedback.status.text
00472 length = len(_x)
00473 buff.write(struct.pack('<I%ss'%length, length, _x))
00474 except struct.error, se: self._check_types(se)
00475 except TypeError, te: self._check_types(te)
00476
00477 def deserialize_numpy(self, str, numpy):
00478 """
00479 unpack serialized message in str into this message instance using numpy for array types
00480 @param str: byte array of serialized message
00481 @type str: str
00482 @param numpy: numpy python module
00483 @type numpy: module
00484 """
00485 try:
00486 if self.action_goal is None:
00487 self.action_goal = wpa_supplicant_node.msg.ScanActionGoal()
00488 if self.action_result is None:
00489 self.action_result = wpa_supplicant_node.msg.ScanActionResult()
00490 if self.action_feedback is None:
00491 self.action_feedback = wpa_supplicant_node.msg.ScanActionFeedback()
00492 end = 0
00493 _x = self
00494 start = end
00495 end += 12
00496 (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00497 start = end
00498 end += 4
00499 (length,) = _struct_I.unpack(str[start:end])
00500 start = end
00501 end += length
00502 self.action_goal.header.frame_id = str[start:end]
00503 _x = self
00504 start = end
00505 end += 8
00506 (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00507 start = end
00508 end += 4
00509 (length,) = _struct_I.unpack(str[start:end])
00510 start = end
00511 end += length
00512 self.action_goal.goal_id.id = str[start:end]
00513 start = end
00514 end += 4
00515 (length,) = _struct_I.unpack(str[start:end])
00516 self.action_goal.goal.ssids = []
00517 for i in xrange(0, length):
00518 start = end
00519 end += 4
00520 (length,) = _struct_I.unpack(str[start:end])
00521 start = end
00522 end += length
00523 val1 = str[start:end]
00524 self.action_goal.goal.ssids.append(val1)
00525 start = end
00526 end += 4
00527 (length,) = _struct_I.unpack(str[start:end])
00528 pattern = '<%si'%length
00529 start = end
00530 end += struct.calcsize(pattern)
00531 self.action_goal.goal.frequencies = numpy.frombuffer(str[start:end], dtype=numpy.int32, count=length)
00532 _x = self
00533 start = end
00534 end += 12
00535 (_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00536 start = end
00537 end += 4
00538 (length,) = _struct_I.unpack(str[start:end])
00539 start = end
00540 end += length
00541 self.action_result.header.frame_id = str[start:end]
00542 _x = self
00543 start = end
00544 end += 8
00545 (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00546 start = end
00547 end += 4
00548 (length,) = _struct_I.unpack(str[start:end])
00549 start = end
00550 end += length
00551 self.action_result.status.goal_id.id = str[start:end]
00552 start = end
00553 end += 1
00554 (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00555 start = end
00556 end += 4
00557 (length,) = _struct_I.unpack(str[start:end])
00558 start = end
00559 end += length
00560 self.action_result.status.text = str[start:end]
00561 start = end
00562 end += 1
00563 (self.action_result.result.success,) = _struct_B.unpack(str[start:end])
00564 self.action_result.result.success = bool(self.action_result.result.success)
00565 start = end
00566 end += 4
00567 (length,) = _struct_I.unpack(str[start:end])
00568 self.action_result.result.bss = []
00569 for i in xrange(0, length):
00570 val1 = wpa_supplicant_node.msg.Bss()
00571 _v4 = val1.stamp
00572 _x = _v4
00573 start = end
00574 end += 8
00575 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
00576 start = end
00577 end += 4
00578 (length,) = _struct_I.unpack(str[start:end])
00579 start = end
00580 end += length
00581 val1.ssid = str[start:end]
00582 start = end
00583 end += 6
00584 val1.bssid = str[start:end]
00585 _x = val1
00586 start = end
00587 end += 20
00588 (_x.frequency, _x.beacon_interval, _x.capabilities, _x.quality, _x.noise, _x.level,) = _struct_i2h3i.unpack(str[start:end])
00589 self.action_result.result.bss.append(val1)
00590 _x = self
00591 start = end
00592 end += 12
00593 (_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00594 start = end
00595 end += 4
00596 (length,) = _struct_I.unpack(str[start:end])
00597 start = end
00598 end += length
00599 self.action_feedback.header.frame_id = str[start:end]
00600 _x = self
00601 start = end
00602 end += 8
00603 (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00604 start = end
00605 end += 4
00606 (length,) = _struct_I.unpack(str[start:end])
00607 start = end
00608 end += length
00609 self.action_feedback.status.goal_id.id = str[start:end]
00610 start = end
00611 end += 1
00612 (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00613 start = end
00614 end += 4
00615 (length,) = _struct_I.unpack(str[start:end])
00616 start = end
00617 end += length
00618 self.action_feedback.status.text = str[start:end]
00619 return self
00620 except struct.error, e:
00621 raise roslib.message.DeserializationError(e)
00622
00623 _struct_I = roslib.message.struct_I
00624 _struct_6B = struct.Struct("<6B")
00625 _struct_B = struct.Struct("<B")
00626 _struct_i2h3i = struct.Struct("<i2h3i")
00627 _struct_3I = struct.Struct("<3I")
00628 _struct_6s = struct.Struct("<6s")
00629 _struct_2I = struct.Struct("<2I")