7 #include <franka_msgs/ErrorRecoveryAction.h> 70 std::unique_ptr<actionlib::SimpleActionServer<franka_msgs::ErrorRecoveryAction>>
~FrankaCombinedHW() override=default
ros::ServiceServer disconnect_server_
bool hasError()
Checks whether the robots are in error or reflex mode.
bool controllerNeedsReset()
Checks whether the controller needs to be reset.
ros::ServiceServer connect_server_
bool init(ros::NodeHandle &root_nh, ros::NodeHandle &robot_hw_nh) override
The init function is called to initialize the CombinedFrankaHW from a non-realtime thread...
void connect()
Calls connect on all hardware classes that are of type FrankaCombinableHW.
FrankaCombinedHW()
Creates an instance of CombinedFrankaHW.
std::unique_ptr< actionlib::SimpleActionServer< franka_msgs::ErrorRecoveryAction > > combined_recovery_action_server_
bool disconnect()
Tries to disconnect on all hardware classes that are of type FrankaCombinableHW.
void read(const ros::Time &time, const ros::Duration &period) override
Reads data from the robot HW.