#include <iri_base_driver/iri_base_driver_node.h>
#include "wam_controller_driver.h"
#include <Eigen/Dense>
#include <geometry_msgs/PoseStamped.h>
#include <sensor_msgs/JointState.h>
#include <iri_wam_common_msgs/wamholdon.h>
#include <iri_wam_common_msgs/joints_move.h>
#include <iri_action_server/iri_action_server.h>
#include <control_msgs/FollowJointTrajectoryAction.h>
Go to the source code of this file.
Classes | |
class | WamControllerDriverNode |
IRI ROS Specific Driver Class. More... |