Class RobotManagerBase

Inheritance Relationships

Base Type

  • public kuka_drivers_core::ROS2BaseLCNode

Derived Types

Class Documentation

class RobotManagerBase : public kuka_drivers_core::ROS2BaseLCNode

Subclassed by kuka_rsi_driver::RobotManagerNodeEkiRsi, kuka_rsi_driver::RobotManagerNodeRsi

Public Functions

RobotManagerBase()
virtual ~RobotManagerBase() = default
CallbackReturn configure_driver(const std::vector<std::string> &controllers_to_activate)
CallbackReturn cleanup_driver(const std::vector<std::string> &controllers_to_deactivate)
CallbackReturn on_activate(const rclcpp_lifecycle::State&) override
CallbackReturn on_deactivate(const rclcpp_lifecycle::State&) override

Protected Functions

bool onRobotModelChangeRequest(const std::string &robot_model)
virtual void EventSubscriptionCallback(const std_msgs::msg::UInt8::SharedPtr message)
virtual bool OnControlModeChangeRequest(const int control_mode)

Protected Attributes

rclcpp::Client<controller_manager_msgs::srv::SetHardwareComponentState>::SharedPtr change_hardware_state_client_
rclcpp::Client<controller_manager_msgs::srv::SwitchController>::SharedPtr change_controller_state_client_
rclcpp::CallbackGroup::SharedPtr cbg_
std::string robot_model_
bool use_gpio_ = false
std::string position_controller_name_
kuka_drivers_core::ControllerHandler controller_handler_
kuka_drivers_core::ControlMode control_mode_ = kuka_drivers_core::ControlMode::CONTROL_MODE_UNSPECIFIED
std::atomic<bool> terminate_ = {false}
std::shared_ptr<rclcpp_lifecycle::LifecyclePublisher<std_msgs::msg::Bool>> is_configured_pub_
std_msgs::msg::Bool is_configured_msg_
rclcpp::CallbackGroup::SharedPtr event_callback_group_
rclcpp::Subscription<std_msgs::msg::UInt8>::SharedPtr event_subscriber_

Protected Static Attributes

static constexpr int HARDWARE_ACTIVATION_TIMEOUT_MS = 15'000
static constexpr int HARDWARE_DEACTIVATION_TIMEOUT_MS = 15'000