Class Ros2ControlSystem
Defined in File Ros2ControlSystem.hpp
Inheritance Relationships
Base Type
public webots_ros2_control::Ros2ControlSystemInterface
(Class Ros2ControlSystemInterface)
Class Documentation
-
class Ros2ControlSystem : public webots_ros2_control::Ros2ControlSystemInterface
Public Functions
-
Ros2ControlSystem()
-
virtual void init(webots_ros2_driver::WebotsNode *node, const hardware_interface::HardwareInfo &info) override
-
rclcpp_lifecycle::node_interfaces::LifecycleNodeInterface::CallbackReturn on_init(const hardware_interface::HardwareInfo &info) override
-
rclcpp_lifecycle::node_interfaces::LifecycleNodeInterface::CallbackReturn on_activate(const rclcpp_lifecycle::State&) override
-
rclcpp_lifecycle::node_interfaces::LifecycleNodeInterface::CallbackReturn on_deactivate(const rclcpp_lifecycle::State&) override
-
std::vector<hardware_interface::StateInterface> export_state_interfaces() override
-
std::vector<hardware_interface::CommandInterface> export_command_interfaces() override
-
hardware_interface::return_type read(const rclcpp::Time&, const rclcpp::Duration&) override
-
hardware_interface::return_type write(const rclcpp::Time&, const rclcpp::Duration&) override
-
Ros2ControlSystem()