12 int main(
int argc,
char** argv) {
13 ros::init(argc, argv,
"franka_combined_control_node");
20 if (!franka_control.
init(private_node_handle, private_node_handle)) {
21 ROS_ERROR(
"franka_combined_control_node:: Initialization of FrankaCombinedHW failed!");
26 std::string error_message;
28 ROS_ERROR(
"franka_combined_control_node: Failed to set thread priority to real-time. Error: %s",
29 error_message.c_str());
40 franka_control.
read(now, period);
42 franka_control.
write(now, period);
bool controllerNeedsReset()
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
bool init(ros::NodeHandle &root_nh, ros::NodeHandle &robot_hw_nh) override
int main(int argc, char **argv)
bool setCurrentThreadToHighestSchedulerPriority(std::string *error_message)
virtual void write(const ros::Time &time, const ros::Duration &period)
void update(const ros::Time &time, const ros::Duration &period, bool reset_controllers=false)
void read(const ros::Time &time, const ros::Duration &period) override