#include <speed_scaling_interface/speed_scaling_interface.h>
#include <controller_interface/multi_interface_controller.h>
#include <hardware_interface/robot_hw.h>
#include <pass_through_controllers/trajectory_interface.h>
#include <control_msgs/FollowJointTrajectoryGoal.h>
#include <control_msgs/JointTolerance.h>
#include <trajectory_msgs/JointTrajectoryPoint.h>
#include <control_msgs/FollowJointTrajectoryAction.h>
#include <cartesian_control_msgs/CartesianTolerance.h>
#include <cartesian_control_msgs/CartesianTrajectoryPoint.h>
#include <cartesian_control_msgs/FollowCartesianTrajectoryGoal.h>
#include <cartesian_control_msgs/FollowCartesianTrajectoryAction.h>
#include <actionlib/server/simple_action_server.h>
#include <vector>
#include <memory>
#include <atomic>
#include <pass_through_controllers/pass_through_controllers.hpp>
Go to the source code of this file.
Classes | |
struct | trajectory_controllers::PassThroughController< TrajectoryInterface >::ActionDuration |
Container for easy time management. More... | |
struct | trajectory_controllers::CartesianBase |
struct | trajectory_controllers::JointBase |
class | trajectory_controllers::PassThroughController< TrajectoryInterface > |
A ROS controller for forwarding trajectories to a robot for interpolation. More... | |
Namespaces | |
trajectory_controllers | |
Definition in file pass_through_controllers.h.