moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
Start screen user interface for MoveIt Configuration Assistant. More...
#include <start_screen_widget.hpp>
Public Member Functions | |
void | onInit () override |
~StartScreenWidget () override | |
void | focusGiven () override |
function called when widget is activated, allows to update/initialize GUI More... | |
SetupStep & | getSetupStep () override |
Return a reference to the SetupStep object. More... | |
Public Member Functions inherited from moveit_setup::SetupStepWidget | |
void | initialize (const rclcpp::Node::SharedPtr &parent_node, QWidget *parent_widget, RVizPanel *rviz_panel, const DataWarehousePtr &config_data) |
Called after construction to initialize the step. More... | |
virtual bool | focusLost () |
function called when widget loses focus, although switching away can be rejected More... | |
bool | isReady () |
Public Attributes | |
SelectModeWidget * | select_mode_ |
LoadPathArgsWidget * | stack_path_ |
LoadPathArgsWidget * | urdf_file_ |
QPushButton * | btn_load_ |
QLabel * | next_label_ |
QProgressBar * | progress_bar_ |
QImage * | right_image_ |
QLabel * | right_image_label_ |
Additional Inherited Members | |
Signals inherited from moveit_setup::SetupStepWidget | |
void | dataUpdated () |
When the underlying data has been updated (which can cause other steps to become "Ready") More... | |
void | advanceRequest () |
When this signal is received, the GUI should attempt to advance to the next step. More... | |
void | setModalMode (bool isModal) |
Event for when the current screen is in modal view. Disables the left navigation. More... | |
Protected Attributes inherited from moveit_setup::SetupStepWidget | |
RVizPanel * | rviz_panel_ |
bool | debug_ |
Start screen user interface for MoveIt Configuration Assistant.
Definition at line 62 of file start_screen_widget.hpp.
|
override |
Definition at line 198 of file start_screen_widget.cpp.
|
overridevirtual |
function called when widget is activated, allows to update/initialize GUI
Reimplemented from moveit_setup::SetupStepWidget.
Definition at line 203 of file start_screen_widget.cpp.
|
inlineoverridevirtual |
Return a reference to the SetupStep object.
Implements moveit_setup::SetupStepWidget.
Definition at line 89 of file start_screen_widget.hpp.
|
overridevirtual |
Reimplemented from moveit_setup::SetupStepWidget.
Definition at line 65 of file start_screen_widget.cpp.
QPushButton* moveit_setup::core::StartScreenWidget::btn_load_ |
Definition at line 83 of file start_screen_widget.hpp.
QLabel* moveit_setup::core::StartScreenWidget::next_label_ |
Definition at line 84 of file start_screen_widget.hpp.
QProgressBar* moveit_setup::core::StartScreenWidget::progress_bar_ |
Definition at line 85 of file start_screen_widget.hpp.
QImage* moveit_setup::core::StartScreenWidget::right_image_ |
Definition at line 86 of file start_screen_widget.hpp.
QLabel* moveit_setup::core::StartScreenWidget::right_image_label_ |
Definition at line 87 of file start_screen_widget.hpp.
SelectModeWidget* moveit_setup::core::StartScreenWidget::select_mode_ |
Definition at line 80 of file start_screen_widget.hpp.
LoadPathArgsWidget* moveit_setup::core::StartScreenWidget::stack_path_ |
Definition at line 81 of file start_screen_widget.hpp.
LoadPathArgsWidget* moveit_setup::core::StartScreenWidget::urdf_file_ |
Definition at line 82 of file start_screen_widget.hpp.