moveit2
The MoveIt Motion Planning Framework for ROS 2.
Public Member Functions | Public Attributes | List of all members
moveit_setup::app::PerceptionWidget Class Reference

#include <perception_widget.hpp>

Inheritance diagram for moveit_setup::app::PerceptionWidget:
Inheritance graph
[legend]
Collaboration diagram for moveit_setup::app::PerceptionWidget:
Collaboration graph
[legend]

Public Member Functions

void onInit () override
 
void focusGiven () override
 Received when this widget is chosen from the navigation menu. More...
 
bool focusLost () override
 Received when another widget is chosen from the navigation menu. More...
 
void loadSensorPluginsComboBox ()
 Populate the combo dropdown box with sensor plugins. More...
 
SetupStepgetSetupStep () 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...
 
bool isReady ()
 

Public Attributes

QComboBox * sensor_plugin_field_
 
QGroupBox * point_cloud_group_
 
QGroupBox * depth_map_group_
 
QLineEdit * point_cloud_topic_field_
 
QLineEdit * max_range_field_
 
QLineEdit * point_subsample_field_
 
QLineEdit * padding_offset_field_
 
QLineEdit * padding_scale_field_
 
QLineEdit * max_update_rate_field_
 
QLineEdit * filtered_cloud_topic_field_
 
QLineEdit * image_topic_field_
 
QLineEdit * queue_size_field_
 
QLineEdit * near_clipping_field_
 
QLineEdit * far_clipping_field_
 
QLineEdit * shadow_threshold_field_
 
QLineEdit * depth_padding_scale_field_
 
QLineEdit * depth_padding_offset_field_
 
QLineEdit * depth_filtered_cloud_topic_field_
 
QLineEdit * depth_max_update_rate_field_
 

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
RVizPanelrviz_panel_
 
bool debug_
 

Detailed Description

Definition at line 54 of file perception_widget.hpp.

Member Function Documentation

◆ focusGiven()

void moveit_setup::app::PerceptionWidget::focusGiven ( )
overridevirtual

Received when this widget is chosen from the navigation menu.

Reimplemented from moveit_setup::SetupStepWidget.

Definition at line 205 of file perception_widget.cpp.

Here is the call graph for this function:

◆ focusLost()

bool moveit_setup::app::PerceptionWidget::focusLost ( )
overridevirtual

Received when another widget is chosen from the navigation menu.

Reimplemented from moveit_setup::SetupStepWidget.

Definition at line 213 of file perception_widget.cpp.

Here is the call graph for this function:

◆ getSetupStep()

SetupStep& moveit_setup::app::PerceptionWidget::getSetupStep ( )
inlineoverridevirtual

Return a reference to the SetupStep object.

Implements moveit_setup::SetupStepWidget.

Definition at line 74 of file perception_widget.hpp.

◆ loadSensorPluginsComboBox()

void moveit_setup::app::PerceptionWidget::loadSensorPluginsComboBox ( )

Populate the combo dropdown box with sensor plugins.

Definition at line 278 of file perception_widget.cpp.

Here is the call graph for this function:
Here is the caller graph for this function:

◆ onInit()

void moveit_setup::app::PerceptionWidget::onInit ( )
overridevirtual

Reimplemented from moveit_setup::SetupStepWidget.

Definition at line 53 of file perception_widget.cpp.

Member Data Documentation

◆ depth_filtered_cloud_topic_field_

QLineEdit* moveit_setup::app::PerceptionWidget::depth_filtered_cloud_topic_field_

Definition at line 106 of file perception_widget.hpp.

◆ depth_map_group_

QGroupBox* moveit_setup::app::PerceptionWidget::depth_map_group_

Definition at line 87 of file perception_widget.hpp.

◆ depth_max_update_rate_field_

QLineEdit* moveit_setup::app::PerceptionWidget::depth_max_update_rate_field_

Definition at line 107 of file perception_widget.hpp.

◆ depth_padding_offset_field_

QLineEdit* moveit_setup::app::PerceptionWidget::depth_padding_offset_field_

Definition at line 105 of file perception_widget.hpp.

◆ depth_padding_scale_field_

QLineEdit* moveit_setup::app::PerceptionWidget::depth_padding_scale_field_

Definition at line 104 of file perception_widget.hpp.

◆ far_clipping_field_

QLineEdit* moveit_setup::app::PerceptionWidget::far_clipping_field_

Definition at line 102 of file perception_widget.hpp.

◆ filtered_cloud_topic_field_

QLineEdit* moveit_setup::app::PerceptionWidget::filtered_cloud_topic_field_

Definition at line 96 of file perception_widget.hpp.

◆ image_topic_field_

QLineEdit* moveit_setup::app::PerceptionWidget::image_topic_field_

Definition at line 99 of file perception_widget.hpp.

◆ max_range_field_

QLineEdit* moveit_setup::app::PerceptionWidget::max_range_field_

Definition at line 91 of file perception_widget.hpp.

◆ max_update_rate_field_

QLineEdit* moveit_setup::app::PerceptionWidget::max_update_rate_field_

Definition at line 95 of file perception_widget.hpp.

◆ near_clipping_field_

QLineEdit* moveit_setup::app::PerceptionWidget::near_clipping_field_

Definition at line 101 of file perception_widget.hpp.

◆ padding_offset_field_

QLineEdit* moveit_setup::app::PerceptionWidget::padding_offset_field_

Definition at line 93 of file perception_widget.hpp.

◆ padding_scale_field_

QLineEdit* moveit_setup::app::PerceptionWidget::padding_scale_field_

Definition at line 94 of file perception_widget.hpp.

◆ point_cloud_group_

QGroupBox* moveit_setup::app::PerceptionWidget::point_cloud_group_

Definition at line 86 of file perception_widget.hpp.

◆ point_cloud_topic_field_

QLineEdit* moveit_setup::app::PerceptionWidget::point_cloud_topic_field_

Definition at line 90 of file perception_widget.hpp.

◆ point_subsample_field_

QLineEdit* moveit_setup::app::PerceptionWidget::point_subsample_field_

Definition at line 92 of file perception_widget.hpp.

◆ queue_size_field_

QLineEdit* moveit_setup::app::PerceptionWidget::queue_size_field_

Definition at line 100 of file perception_widget.hpp.

◆ sensor_plugin_field_

QComboBox* moveit_setup::app::PerceptionWidget::sensor_plugin_field_

Definition at line 83 of file perception_widget.hpp.

◆ shadow_threshold_field_

QLineEdit* moveit_setup::app::PerceptionWidget::shadow_threshold_field_

Definition at line 103 of file perception_widget.hpp.


The documentation for this class was generated from the following files: