|
moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
Setup step for generating launch files that are not otherwise associated with a specific step. More...
#include <launches.hpp>


Public Member Functions | |
| std::string | getName () const override |
| Returns the name of the setup step. | |
| void | onInit () override |
| Overridable initialization method. | |
| bool | isReady () const override |
| Return true if the data necessary to proceed with this step has been configured. | |
| const std::vector< LaunchBundle > & | getAvailableLaunchBundles () const |
| Get all available launch bundles. | |
| bool | getState (unsigned int id) const |
| void | setState (unsigned int id, bool state) |
| Sets whether the LaunchBundle with the given id is included (true) or not (false) | |
| const std::string & | getDescription (unsigned int id) const |
Public Member Functions inherited from moveit_setup::SetupStep | |
| SetupStep ()=default | |
| SetupStep (const SetupStep &)=default | |
| SetupStep (SetupStep &&)=default | |
| SetupStep & | operator= (const SetupStep &)=default |
| SetupStep & | operator= (SetupStep &&)=default |
| virtual | ~SetupStep ()=default |
| void | initialize (const rclcpp::Node::SharedPtr &parent_node, const DataWarehousePtr &config_data) |
| Called after construction to initialize the step. | |
| const rclcpp::Logger & | getLogger () const |
| Makes a namespaced logger for this step available to the widget. | |
Protected Attributes | |
| std::vector< LaunchBundle > | available_launch_bundles_ |
| std::shared_ptr< LaunchesConfig > | launches_config_ |
Protected Attributes inherited from moveit_setup::SetupStep | |
| DataWarehousePtr | config_data_ |
| rclcpp::Node::SharedPtr | parent_node_ |
| std::shared_ptr< rclcpp::Logger > | logger_ |
Setup step for generating launch files that are not otherwise associated with a specific step.
Definition at line 48 of file launches.hpp.
|
inline |
Get all available launch bundles.
Definition at line 65 of file launches.hpp.

|
inline |
Definition at line 83 of file launches.hpp.
|
inlineoverridevirtual |
Returns the name of the setup step.
Implements moveit_setup::SetupStep.
Definition at line 51 of file launches.hpp.
| bool moveit_setup::app::Launches::getState | ( | unsigned int | id | ) | const |
Definition at line 90 of file launches.cpp.

|
inlineoverridevirtual |
Return true if the data necessary to proceed with this step has been configured.
Reimplemented from moveit_setup::SetupStep.
Definition at line 57 of file launches.hpp.
|
overridevirtual |
Overridable initialization method.
Reimplemented from moveit_setup::SetupStep.
Definition at line 42 of file launches.cpp.

| void moveit_setup::app::Launches::setState | ( | unsigned int | id, |
| bool | state | ||
| ) |
Sets whether the LaunchBundle with the given id is included (true) or not (false)
Definition at line 95 of file launches.cpp.
|
protected |
Definition at line 89 of file launches.hpp.
|
protected |
Definition at line 90 of file launches.hpp.