#include <rtt/TaskContext.hpp>
#include <rtt/Port.hpp>
#include <rtt/Logger.hpp>
#include <kdl/frames.hpp>
#include <kdl/jntarray.hpp>
#include <kdl/jacobian.hpp>
#include <sensor_msgs/typekit/Types.h>
#include <geometry_msgs/typekit/Types.h>
Go to the source code of this file.
Classes | |
class | lwr::VelocityProjector |
Namespaces | |
namespace | lwr |
Typedefs | |
typedef Eigen::Matrix< double, 7, 6 > | Matrix76d |
typedef Eigen::Matrix< double, 7, 7 > | Matrix77d |
typedef Eigen::Matrix< double, 6, 1 > | Vector6d |
typedef Eigen::Matrix< double, 7, 1 > | Vector7d |
typedef Eigen::Matrix<double, 7, 6> Matrix76d |
Definition at line 22 of file VelocityProjection.h.
typedef Eigen::Matrix<double, 7, 7> Matrix77d |
Definition at line 23 of file VelocityProjection.h.
typedef Eigen::Matrix<double, 6, 1> Vector6d |
Definition at line 25 of file VelocityProjection.h.
typedef Eigen::Matrix<double, 7, 1> Vector7d |
Definition at line 24 of file VelocityProjection.h.