Class CascadeLifecycleNode
Defined in File rclcpp_cascade_lifecycle.hpp
Inheritance Relationships
Base Type
public rclcpp_lifecycle::LifecycleNode
Class Documentation
-
class CascadeLifecycleNode : public rclcpp_lifecycle::LifecycleNode
Public Functions
-
explicit RCLCPP_LIFECYCLE_PUBLIC CascadeLifecycleNode(const std::string &node_name, const rclcpp::NodeOptions &options = rclcpp::NodeOptions())
Create a new lifecycle node with the specified name.
- Parameters
node_name – [in] Name of the node.
namespace_ – [in] Namespace of the node.
options – [in] Additional options to control creation of the node.
-
RCLCPP_LIFECYCLE_PUBLIC CascadeLifecycleNode(const std::string &node_name, const std::string &namespace_, const rclcpp::NodeOptions &options = rclcpp::NodeOptions())
Create a node based on the node name and a rclcpp::Context.
- Parameters
node_name – [in] Name of the node.
namespace_ – [in] Namespace of the node.
options – [in] Additional options to control creation of the node.
-
void add_activation(const std::string &node_name)
-
void remove_activation(const std::string &node_name)
-
void clear_activation()
-
inline const std::set<std::string> &get_activators() const
-
inline const std::set<std::string> &get_activations() const
-
inline const std::map<std::string, uint8_t> &get_activators_state() const
-
explicit RCLCPP_LIFECYCLE_PUBLIC CascadeLifecycleNode(const std::string &node_name, const rclcpp::NodeOptions &options = rclcpp::NodeOptions())