ros2_canopen
master
C++ ROS CANopen Library
|
#include <master_node.hpp>
Public Member Functions | |
LifecycleCanopenMaster (const rclcpp::NodeOptions &node_options=rclcpp::NodeOptions()) | |
virtual void | init () override |
Initialises the driver. More... | |
virtual void | shutdown () override |
Shuts the master down. More... | |
virtual std::shared_ptr< lely::canopen::AsyncMaster > | get_master () override |
Get the master object. More... | |
virtual std::shared_ptr< lely::ev::Executor > | get_executor () override |
Get the executor object. More... | |
rclcpp_lifecycle::node_interfaces::LifecycleNodeInterface::CallbackReturn | on_configure (const rclcpp_lifecycle::State &state) |
Configure Transition Callback. More... | |
rclcpp_lifecycle::node_interfaces::LifecycleNodeInterface::CallbackReturn | on_activate (const rclcpp_lifecycle::State &state) |
Activate Transition Callback. More... | |
rclcpp_lifecycle::node_interfaces::LifecycleNodeInterface::CallbackReturn | on_deactivate (const rclcpp_lifecycle::State &state) |
Deactivet Transition Callback. More... | |
rclcpp_lifecycle::node_interfaces::LifecycleNodeInterface::CallbackReturn | on_cleanup (const rclcpp_lifecycle::State &state) |
Cleanup Transition Callback. More... | |
rclcpp_lifecycle::node_interfaces::LifecycleNodeInterface::CallbackReturn | on_shutdown (const rclcpp_lifecycle::State &state) |
Shutdown Transition Callback. More... | |
virtual rclcpp::node_interfaces::NodeBaseInterface::SharedPtr | get_node_base_interface () override |
Get the node base interface object. More... | |
virtual bool | is_lifecycle () |
Check whether the node is a lifecycle node. More... | |
Protected Attributes | |
std::shared_ptr< node_interfaces::NodeCanopenMasterInterface > | node_canopen_master_ |
|
inline |
|
overridevirtual |
Initialises the driver.
This function initialises the driver. It is called by the device container after adding the node to the ros executor. This function uses the NodeCanopenMasterInterface. It will call init(). If this function does not throw, the driver is successfully initialised and ready to switch through the lifecycle.
Implements ros2_canopen::CanopenMasterInterface.
|
overridevirtual |
Shuts the master down.
This function is called by the device container before exiting, it should enable a clean exit of the master and especially join all threads. It will call the shutdown() function of the NodeCanopenMasterInterface object associated with this class.
Implements ros2_canopen::CanopenMasterInterface.
|
overridevirtual |
Get the master object.
This function should return the lely master object. It should throw a ros2_canopen::MasterException if the master object was not yet set.
Implements ros2_canopen::CanopenMasterInterface.
|
overridevirtual |
Get the executor object.
This function gets the lely executor object. It should throw a ros2_canopen::MasterException if the executor object is not yet instantiated.
Implements ros2_canopen::CanopenMasterInterface.
rclcpp_lifecycle::node_interfaces::LifecycleNodeInterface::CallbackReturn ros2_canopen::LifecycleCanopenMaster::on_configure | ( | const rclcpp_lifecycle::State & | state | ) |
Configure Transition Callback.
This function will call the configure() function of the NodeCanopenMasterInterface object associated with this class.
state |
rclcpp_lifecycle::node_interfaces::LifecycleNodeInterface::CallbackReturn ros2_canopen::LifecycleCanopenMaster::on_activate | ( | const rclcpp_lifecycle::State & | state | ) |
Activate Transition Callback.
This function will call the active() function of the NodeCanopenMasterInterface object associated with this class.
state |
rclcpp_lifecycle::node_interfaces::LifecycleNodeInterface::CallbackReturn ros2_canopen::LifecycleCanopenMaster::on_deactivate | ( | const rclcpp_lifecycle::State & | state | ) |
Deactivet Transition Callback.
This function will call the deactivate() function of the NodeCanopenMasterInterface object associated with this class.
state |
rclcpp_lifecycle::node_interfaces::LifecycleNodeInterface::CallbackReturn ros2_canopen::LifecycleCanopenMaster::on_cleanup | ( | const rclcpp_lifecycle::State & | state | ) |
Cleanup Transition Callback.
This function will call the cleanup() function of the NodeCanopenMasterInterface object associated with this class.
state |
rclcpp_lifecycle::node_interfaces::LifecycleNodeInterface::CallbackReturn ros2_canopen::LifecycleCanopenMaster::on_shutdown | ( | const rclcpp_lifecycle::State & | state | ) |
Shutdown Transition Callback.
This function will call the shutdown() function of the NodeCanopenMasterInterface object associated with this class.
state |
|
inlineoverridevirtual |
Get the node base interface object.
This function should return the NodeBaseInterface of the associated ROS node. This is used by device container to add the master to the ros executor.
Implements ros2_canopen::CanopenMasterInterface.
|
inlinevirtual |
Check whether the node is a lifecycle node.
Implements ros2_canopen::CanopenMasterInterface.
|
protected |