execute_step_plan_widget.py
Go to the documentation of this file.
1 #!/usr/bin/env python
2 
3 import rospy
4 
5 import std_msgs.msg
6 import vigir_footstep_planning_msgs.msg
7 
8 from rqt_gui_py.plugin import Plugin
9 from python_qt_binding.QtCore import Qt
10 from python_qt_binding.QtGui import QWidget, QHBoxLayout, QVBoxLayout, QPushButton, QComboBox
11 
12 from vigir_footstep_planning_msgs.msg import StepPlan, ExecuteStepPlanAction, ExecuteStepPlanGoal, ErrorStatus
17 
18 
20 
21  def __init__(self, context):
22  super(ExecuteStepPlanDialog, self).__init__(context)
23  self.setObjectName('ExecuteStepPlanDialog')
24 
25  self._parent = QWidget()
27 
28  context.add_widget(self._parent)
29 
30  def shutdown_plugin(self):
31  self._widget.shutdown_plugin()
32 
33 
34 class ExecuteStepPlanWidget(QObject):
35 
36  execute_step_plan_client = None
37  step_plan = None
38 
39  def __init__(self, context):
40  super(ExecuteStepPlanWidget, self).__init__()
41 
42  # start widget
43  widget = context
44  error_status_widget = QErrorStatusWidget()
45  self.logger = Logger(error_status_widget)
46 
47  # add upper part
48  vbox = QVBoxLayout()
49 
50  # add execute action server widget
51  add_widget_with_frame(vbox, QExecuteStepPlanWidget(logger=self.logger), "Step Plan Selection/Execution:")
52 
53  # add error status widget
54  add_widget_with_frame(vbox, error_status_widget, "Status:")
55 
56  # end widget
57  widget.setLayout(vbox)
58  #context.add_widget(widget)
59 
60  def shutdown_plugin(self):
61  print "Shutting down ..."
62  print "Done!"
63 


vigir_footstep_planning_widgets
Author(s): Alexander Stumpf
autogenerated on Mon Jun 10 2019 15:47:48