00001 """autogenerated by genmsg_py from ConfigAction.msg. Do not edit."""
00002 import roslib.message
00003 import struct
00004
00005 import roslib.rostime
00006 import actionlib_msgs.msg
00007 import laser_cb_detector.msg
00008 import std_msgs.msg
00009
00010 class ConfigAction(roslib.message.Message):
00011 _md5sum = "9ab17a2bdd4d1b9a55316f3c57556453"
00012 _type = "laser_cb_detector/ConfigAction"
00013 _has_header = False
00014 _full_text = """
00015 ConfigActionGoal action_goal
00016 ConfigActionResult action_result
00017 ConfigActionFeedback action_feedback
00018
00019 ================================================================================
00020 MSG: laser_cb_detector/ConfigActionGoal
00021
00022 Header header
00023 actionlib_msgs/GoalID goal_id
00024 ConfigGoal goal
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: actionlib_msgs/GoalID
00046 # The stamp should store the time at which this goal was requested.
00047 # It is used by an action server when it tries to preempt all
00048 # goals that were requested before a certain time
00049 time stamp
00050
00051 # The id provides a way to associate feedback and
00052 # result message with specific goal requests. The id
00053 # specified must be unique.
00054 string id
00055
00056
00057 ================================================================================
00058 MSG: laser_cb_detector/ConfigGoal
00059 uint32 num_x # Number of checkerboard corners in the X direction
00060 uint32 num_y # Number of corners in the Y direction
00061 float32 spacing_x # Spacing between corners in the X direction (meters)
00062 float32 spacing_y # Spacing between corners in the Y direction (meters)
00063
00064 # Specify how many times we want to upsample the image.
00065 # This is often useful for detecting small checkerboards far away
00066 float32 width_scaling
00067 float32 height_scaling
00068
00069 # Specifiy how intensity maps into a uint8. A specified window of
00070 # intensities is linearly scaled to 0-255
00071 float32 min_intensity
00072 float32 max_intensity
00073
00074 # Configure openCV's subpixel corner detector
00075 uint32 subpixel_window
00076 int32 subpixel_zero_zone
00077
00078 # Specify if we need to flip snapshot image model. This is usually necessary
00079 # when the laser scans from right to left, since this is the opposite of images,
00080 # which are normally indexed left to right
00081 uint8 flip_horizontal
00082
00083
00084 ================================================================================
00085 MSG: laser_cb_detector/ConfigActionResult
00086
00087 Header header
00088 actionlib_msgs/GoalStatus status
00089 ConfigResult result
00090
00091 ================================================================================
00092 MSG: actionlib_msgs/GoalStatus
00093 GoalID goal_id
00094 uint8 status
00095 uint8 PENDING = 0 # The goal has yet to be processed by the action server
00096 uint8 ACTIVE = 1 # The goal is currently being processed by the action server
00097 uint8 PREEMPTED = 2 # The goal received a cancel request after it started executing
00098 # and has since completed its execution (Terminal State)
00099 uint8 SUCCEEDED = 3 # The goal was achieved successfully by the action server (Terminal State)
00100 uint8 ABORTED = 4 # The goal was aborted during execution by the action server due
00101 # to some failure (Terminal State)
00102 uint8 REJECTED = 5 # The goal was rejected by the action server without being processed,
00103 # because the goal was unattainable or invalid (Terminal State)
00104 uint8 PREEMPTING = 6 # The goal received a cancel request after it started executing
00105 # and has not yet completed execution
00106 uint8 RECALLING = 7 # The goal received a cancel request before it started executing,
00107 # but the action server has not yet confirmed that the goal is canceled
00108 uint8 RECALLED = 8 # The goal received a cancel request before it started executing
00109 # and was successfully cancelled (Terminal State)
00110 uint8 LOST = 9 # An action client can determine that a goal is LOST. This should not be
00111 # sent over the wire by an action server
00112
00113 #Allow for the user to associate a string with GoalStatus for debugging
00114 string text
00115
00116
00117 ================================================================================
00118 MSG: laser_cb_detector/ConfigResult
00119
00120 ================================================================================
00121 MSG: laser_cb_detector/ConfigActionFeedback
00122
00123 Header header
00124 actionlib_msgs/GoalStatus status
00125 ConfigFeedback feedback
00126
00127 ================================================================================
00128 MSG: laser_cb_detector/ConfigFeedback
00129
00130
00131 """
00132 __slots__ = ['action_goal','action_result','action_feedback']
00133 _slot_types = ['laser_cb_detector/ConfigActionGoal','laser_cb_detector/ConfigActionResult','laser_cb_detector/ConfigActionFeedback']
00134
00135 def __init__(self, *args, **kwds):
00136 """
00137 Constructor. Any message fields that are implicitly/explicitly
00138 set to None will be assigned a default value. The recommend
00139 use is keyword arguments as this is more robust to future message
00140 changes. You cannot mix in-order arguments and keyword arguments.
00141
00142 The available fields are:
00143 action_goal,action_result,action_feedback
00144
00145 @param args: complete set of field values, in .msg order
00146 @param kwds: use keyword arguments corresponding to message field names
00147 to set specific fields.
00148 """
00149 if args or kwds:
00150 super(ConfigAction, self).__init__(*args, **kwds)
00151
00152 if self.action_goal is None:
00153 self.action_goal = laser_cb_detector.msg.ConfigActionGoal()
00154 if self.action_result is None:
00155 self.action_result = laser_cb_detector.msg.ConfigActionResult()
00156 if self.action_feedback is None:
00157 self.action_feedback = laser_cb_detector.msg.ConfigActionFeedback()
00158 else:
00159 self.action_goal = laser_cb_detector.msg.ConfigActionGoal()
00160 self.action_result = laser_cb_detector.msg.ConfigActionResult()
00161 self.action_feedback = laser_cb_detector.msg.ConfigActionFeedback()
00162
00163 def _get_types(self):
00164 """
00165 internal API method
00166 """
00167 return self._slot_types
00168
00169 def serialize(self, buff):
00170 """
00171 serialize message into buffer
00172 @param buff: buffer
00173 @type buff: StringIO
00174 """
00175 try:
00176 _x = self
00177 buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00178 _x = self.action_goal.header.frame_id
00179 length = len(_x)
00180 buff.write(struct.pack('<I%ss'%length, length, _x))
00181 _x = self
00182 buff.write(_struct_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00183 _x = self.action_goal.goal_id.id
00184 length = len(_x)
00185 buff.write(struct.pack('<I%ss'%length, length, _x))
00186 _x = self
00187 buff.write(_struct_2I6fIiB3I.pack(_x.action_goal.goal.num_x, _x.action_goal.goal.num_y, _x.action_goal.goal.spacing_x, _x.action_goal.goal.spacing_y, _x.action_goal.goal.width_scaling, _x.action_goal.goal.height_scaling, _x.action_goal.goal.min_intensity, _x.action_goal.goal.max_intensity, _x.action_goal.goal.subpixel_window, _x.action_goal.goal.subpixel_zero_zone, _x.action_goal.goal.flip_horizontal, _x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00188 _x = self.action_result.header.frame_id
00189 length = len(_x)
00190 buff.write(struct.pack('<I%ss'%length, length, _x))
00191 _x = self
00192 buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00193 _x = self.action_result.status.goal_id.id
00194 length = len(_x)
00195 buff.write(struct.pack('<I%ss'%length, length, _x))
00196 buff.write(_struct_B.pack(self.action_result.status.status))
00197 _x = self.action_result.status.text
00198 length = len(_x)
00199 buff.write(struct.pack('<I%ss'%length, length, _x))
00200 _x = self
00201 buff.write(_struct_3I.pack(_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00202 _x = self.action_feedback.header.frame_id
00203 length = len(_x)
00204 buff.write(struct.pack('<I%ss'%length, length, _x))
00205 _x = self
00206 buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00207 _x = self.action_feedback.status.goal_id.id
00208 length = len(_x)
00209 buff.write(struct.pack('<I%ss'%length, length, _x))
00210 buff.write(_struct_B.pack(self.action_feedback.status.status))
00211 _x = self.action_feedback.status.text
00212 length = len(_x)
00213 buff.write(struct.pack('<I%ss'%length, length, _x))
00214 except struct.error, se: self._check_types(se)
00215 except TypeError, te: self._check_types(te)
00216
00217 def deserialize(self, str):
00218 """
00219 unpack serialized message in str into this message instance
00220 @param str: byte array of serialized message
00221 @type str: str
00222 """
00223 try:
00224 if self.action_goal is None:
00225 self.action_goal = laser_cb_detector.msg.ConfigActionGoal()
00226 if self.action_result is None:
00227 self.action_result = laser_cb_detector.msg.ConfigActionResult()
00228 if self.action_feedback is None:
00229 self.action_feedback = laser_cb_detector.msg.ConfigActionFeedback()
00230 end = 0
00231 _x = self
00232 start = end
00233 end += 12
00234 (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00235 start = end
00236 end += 4
00237 (length,) = _struct_I.unpack(str[start:end])
00238 start = end
00239 end += length
00240 self.action_goal.header.frame_id = str[start:end]
00241 _x = self
00242 start = end
00243 end += 8
00244 (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00245 start = end
00246 end += 4
00247 (length,) = _struct_I.unpack(str[start:end])
00248 start = end
00249 end += length
00250 self.action_goal.goal_id.id = str[start:end]
00251 _x = self
00252 start = end
00253 end += 53
00254 (_x.action_goal.goal.num_x, _x.action_goal.goal.num_y, _x.action_goal.goal.spacing_x, _x.action_goal.goal.spacing_y, _x.action_goal.goal.width_scaling, _x.action_goal.goal.height_scaling, _x.action_goal.goal.min_intensity, _x.action_goal.goal.max_intensity, _x.action_goal.goal.subpixel_window, _x.action_goal.goal.subpixel_zero_zone, _x.action_goal.goal.flip_horizontal, _x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_2I6fIiB3I.unpack(str[start:end])
00255 start = end
00256 end += 4
00257 (length,) = _struct_I.unpack(str[start:end])
00258 start = end
00259 end += length
00260 self.action_result.header.frame_id = str[start:end]
00261 _x = self
00262 start = end
00263 end += 8
00264 (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00265 start = end
00266 end += 4
00267 (length,) = _struct_I.unpack(str[start:end])
00268 start = end
00269 end += length
00270 self.action_result.status.goal_id.id = str[start:end]
00271 start = end
00272 end += 1
00273 (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00274 start = end
00275 end += 4
00276 (length,) = _struct_I.unpack(str[start:end])
00277 start = end
00278 end += length
00279 self.action_result.status.text = str[start:end]
00280 _x = self
00281 start = end
00282 end += 12
00283 (_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00284 start = end
00285 end += 4
00286 (length,) = _struct_I.unpack(str[start:end])
00287 start = end
00288 end += length
00289 self.action_feedback.header.frame_id = str[start:end]
00290 _x = self
00291 start = end
00292 end += 8
00293 (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00294 start = end
00295 end += 4
00296 (length,) = _struct_I.unpack(str[start:end])
00297 start = end
00298 end += length
00299 self.action_feedback.status.goal_id.id = str[start:end]
00300 start = end
00301 end += 1
00302 (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00303 start = end
00304 end += 4
00305 (length,) = _struct_I.unpack(str[start:end])
00306 start = end
00307 end += length
00308 self.action_feedback.status.text = str[start:end]
00309 return self
00310 except struct.error, e:
00311 raise roslib.message.DeserializationError(e)
00312
00313
00314 def serialize_numpy(self, buff, numpy):
00315 """
00316 serialize message with numpy array types into buffer
00317 @param buff: buffer
00318 @type buff: StringIO
00319 @param numpy: numpy python module
00320 @type numpy module
00321 """
00322 try:
00323 _x = self
00324 buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00325 _x = self.action_goal.header.frame_id
00326 length = len(_x)
00327 buff.write(struct.pack('<I%ss'%length, length, _x))
00328 _x = self
00329 buff.write(_struct_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00330 _x = self.action_goal.goal_id.id
00331 length = len(_x)
00332 buff.write(struct.pack('<I%ss'%length, length, _x))
00333 _x = self
00334 buff.write(_struct_2I6fIiB3I.pack(_x.action_goal.goal.num_x, _x.action_goal.goal.num_y, _x.action_goal.goal.spacing_x, _x.action_goal.goal.spacing_y, _x.action_goal.goal.width_scaling, _x.action_goal.goal.height_scaling, _x.action_goal.goal.min_intensity, _x.action_goal.goal.max_intensity, _x.action_goal.goal.subpixel_window, _x.action_goal.goal.subpixel_zero_zone, _x.action_goal.goal.flip_horizontal, _x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00335 _x = self.action_result.header.frame_id
00336 length = len(_x)
00337 buff.write(struct.pack('<I%ss'%length, length, _x))
00338 _x = self
00339 buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00340 _x = self.action_result.status.goal_id.id
00341 length = len(_x)
00342 buff.write(struct.pack('<I%ss'%length, length, _x))
00343 buff.write(_struct_B.pack(self.action_result.status.status))
00344 _x = self.action_result.status.text
00345 length = len(_x)
00346 buff.write(struct.pack('<I%ss'%length, length, _x))
00347 _x = self
00348 buff.write(_struct_3I.pack(_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00349 _x = self.action_feedback.header.frame_id
00350 length = len(_x)
00351 buff.write(struct.pack('<I%ss'%length, length, _x))
00352 _x = self
00353 buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00354 _x = self.action_feedback.status.goal_id.id
00355 length = len(_x)
00356 buff.write(struct.pack('<I%ss'%length, length, _x))
00357 buff.write(_struct_B.pack(self.action_feedback.status.status))
00358 _x = self.action_feedback.status.text
00359 length = len(_x)
00360 buff.write(struct.pack('<I%ss'%length, length, _x))
00361 except struct.error, se: self._check_types(se)
00362 except TypeError, te: self._check_types(te)
00363
00364 def deserialize_numpy(self, str, numpy):
00365 """
00366 unpack serialized message in str into this message instance using numpy for array types
00367 @param str: byte array of serialized message
00368 @type str: str
00369 @param numpy: numpy python module
00370 @type numpy: module
00371 """
00372 try:
00373 if self.action_goal is None:
00374 self.action_goal = laser_cb_detector.msg.ConfigActionGoal()
00375 if self.action_result is None:
00376 self.action_result = laser_cb_detector.msg.ConfigActionResult()
00377 if self.action_feedback is None:
00378 self.action_feedback = laser_cb_detector.msg.ConfigActionFeedback()
00379 end = 0
00380 _x = self
00381 start = end
00382 end += 12
00383 (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00384 start = end
00385 end += 4
00386 (length,) = _struct_I.unpack(str[start:end])
00387 start = end
00388 end += length
00389 self.action_goal.header.frame_id = str[start:end]
00390 _x = self
00391 start = end
00392 end += 8
00393 (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00394 start = end
00395 end += 4
00396 (length,) = _struct_I.unpack(str[start:end])
00397 start = end
00398 end += length
00399 self.action_goal.goal_id.id = str[start:end]
00400 _x = self
00401 start = end
00402 end += 53
00403 (_x.action_goal.goal.num_x, _x.action_goal.goal.num_y, _x.action_goal.goal.spacing_x, _x.action_goal.goal.spacing_y, _x.action_goal.goal.width_scaling, _x.action_goal.goal.height_scaling, _x.action_goal.goal.min_intensity, _x.action_goal.goal.max_intensity, _x.action_goal.goal.subpixel_window, _x.action_goal.goal.subpixel_zero_zone, _x.action_goal.goal.flip_horizontal, _x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_2I6fIiB3I.unpack(str[start:end])
00404 start = end
00405 end += 4
00406 (length,) = _struct_I.unpack(str[start:end])
00407 start = end
00408 end += length
00409 self.action_result.header.frame_id = str[start:end]
00410 _x = self
00411 start = end
00412 end += 8
00413 (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00414 start = end
00415 end += 4
00416 (length,) = _struct_I.unpack(str[start:end])
00417 start = end
00418 end += length
00419 self.action_result.status.goal_id.id = str[start:end]
00420 start = end
00421 end += 1
00422 (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00423 start = end
00424 end += 4
00425 (length,) = _struct_I.unpack(str[start:end])
00426 start = end
00427 end += length
00428 self.action_result.status.text = str[start:end]
00429 _x = self
00430 start = end
00431 end += 12
00432 (_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00433 start = end
00434 end += 4
00435 (length,) = _struct_I.unpack(str[start:end])
00436 start = end
00437 end += length
00438 self.action_feedback.header.frame_id = str[start:end]
00439 _x = self
00440 start = end
00441 end += 8
00442 (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00443 start = end
00444 end += 4
00445 (length,) = _struct_I.unpack(str[start:end])
00446 start = end
00447 end += length
00448 self.action_feedback.status.goal_id.id = str[start:end]
00449 start = end
00450 end += 1
00451 (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00452 start = end
00453 end += 4
00454 (length,) = _struct_I.unpack(str[start:end])
00455 start = end
00456 end += length
00457 self.action_feedback.status.text = str[start:end]
00458 return self
00459 except struct.error, e:
00460 raise roslib.message.DeserializationError(e)
00461
00462 _struct_I = roslib.message.struct_I
00463 _struct_3I = struct.Struct("<3I")
00464 _struct_B = struct.Struct("<B")
00465 _struct_2I6fIiB3I = struct.Struct("<2I6fIiB3I")
00466 _struct_2I = struct.Struct("<2I")