#include <ros/ros.h>
#include <tf/transform_broadcaster.h>
#include <tf/transform_datatypes.h>
#include <tf/transform_listener.h>
#include <tf/LinearMath/Vector3.h>
#include <tf/LinearMath/Matrix3x3.h>
#include <geometry_msgs/PoseStamped.h>
Go to the source code of this file.
Classes | |
class | MotionAdaption |
Adapts the tracked end points of the operator to the robot's body proportions. More... |