#include <iri_base_driver/iri_base_driver_node.h>
#include "wam_driver.h"
#include <Eigen/Dense>
#include <wam_msgs/RTJointPos.h>
#include <trajectory_msgs/JointTrajectoryPoint.h>
#include "sensor_msgs/JointState.h"
#include "geometry_msgs/PoseStamped.h"
#include "iri_wam_common_msgs/wamdriver.h"
#include "iri_wam_common_msgs/joints_move.h"
#include "iri_wam_common_msgs/pose_move.h"
#include <iri_wam_common_msgs/DMPTrackerAction.h>
#include <iri_wam_common_msgs/LWPRTrajectoryReturningForceEstimationAction.h>
#include <iri_action_server/iri_action_server.h>
#include <control_msgs/FollowJointTrajectoryAction.h>
#include <actionlib/server/action_server.h>
Go to the source code of this file.
Classes | |
class | WamDriverNode |
IRI ROS Specific Driver Class. More... | |
Defines | |
#define | HOLDOFF 1 |
#define | HOLDON 0 |
#define HOLDOFF 1 |
Definition at line 53 of file wam_driver_node.h.
#define HOLDON 0 |
Definition at line 52 of file wam_driver_node.h.