Defines the TrajectoryManager class. More...
#include "robodyn_controllers/JointTrajectoryManager.h"#include "robodyn_utilities/GoalStatusSender.h"#include <sensor_msgs/JointState.h>#include <boost/ptr_container/ptr_map.hpp>#include "robodyn_controllers/JointTrajectoryFollower.h"#include "r2_msgs/PoseTrajectory.h"#include "r2_msgs/ControllerPoseSettings.h"#include "r2_msgs/PoseState.h"#include "r2_msgs/StringArray.h"#include "robodyn_controllers/MobileTreeIk.h"#include "robodyn_controllers/TrapezoidalVelocityTrajectoryFactory.h"#include "robodyn_controllers/RosMsgTrajectoryFactory.h"#include "robodyn_controllers/RosMsgTreeIkTrajectoryFactory.h"#include "robodyn_controllers/RosMsgForceTrajectoryFactory.h"#include "r2_msgs/JointCommand.h"#include "r2_msgs/JointControlDataArray.h"#include "r2_msgs/ReplanType.h"#include "robodyn_controllers/MotionLimiter.h"#include "r2_msgs/JointCapability.h"#include "r2_msgs/ForceControlAxis.h"#include "r2_msgs/WrenchState.h"#include "r2_msgs/ForceControlAxisArray.h"#include "r2_msgs/ToolFrame.h"#include "robodyn_controllers/RosMsgToolFrameManager.h"#include <iostream>#include <string>

Go to the source code of this file.
Classes | |
| struct | TrajectoryManager::ForceGains |
| struct | TrajectoryManager::GoalIdCompare |
| class | TrajectoryManager |
| The TrajectoryManager class handles trajectories. A pure virtual writeJointState function is used to actually send the next point. More... | |
Defines the TrajectoryManager class.
Definition in file TrajectoryManager.h.