12 #include <franka_msgs/FrankaState.h> 13 #include <geometry_msgs/WrenchStamped.h> 15 #include <sensor_msgs/JointState.h> 16 #include <tf2_msgs/TFMessage.h> std::unique_ptr< franka_hw::FrankaStateHandle > franka_state_handle_
realtime_tools::RealtimePublisher< sensor_msgs::JointState > publisher_joint_states_desired_
uint64_t sequence_number_
void publishJointStates(const ros::Time &time)
Controller to publish the robot state as ROS topics.
franka_hw::TriggerRate trigger_publish_
void update(const ros::Time &time, const ros::Duration &period) override
Reads the current robot state from the franka_hw::FrankaStateInterface and publishes it...
franka::RobotState robot_state_
void publishFrankaStates(const ros::Time &time)
void publishTransforms(const ros::Time &time)
std::vector< std::string > joint_names_
FrankaStateController()=default
Creates an instance of a FrankaStateController.
void publishExternalWrench(const ros::Time &time)
bool init(hardware_interface::RobotHW *robot_hardware, ros::NodeHandle &root_node_handle, ros::NodeHandle &controller_node_handle) override
Initializes the controller with interfaces and publishers.
realtime_tools::RealtimePublisher< sensor_msgs::JointState > publisher_joint_states_
realtime_tools::RealtimePublisher< tf2_msgs::TFMessage > publisher_transforms_
franka_hw::FrankaStateInterface * franka_state_interface_
realtime_tools::RealtimePublisher< franka_msgs::FrankaState > publisher_franka_states_
realtime_tools::RealtimePublisher< geometry_msgs::WrenchStamped > publisher_external_wrench_