18 #ifndef __invdyn_trajectory_base_hpp__ 19 #define __invdyn_trajectory_base_hpp__ 21 #include "tsid/deprecated.hh" 31 typedef Eigen::Map<const Eigen::Matrix<double, 3, 3>>
MapMatrix3;
35 EIGEN_MAKE_ALIGNED_OPERATOR_NEW
49 acc = second_derivative;
55 resize(size_value, size_derivative);
60 void resize(
unsigned int size_value,
unsigned int size_derivative) {
61 pos.setZero(size_value);
62 vel.setZero(size_derivative);
63 acc.setZero(size_derivative);
76 EIGEN_MAKE_ALIGNED_OPERATOR_NEW
82 virtual unsigned int size()
const = 0;
92 virtual bool has_trajectory_ended()
const = 0;
101 #endif // ifndef __invdyn_trajectory_base_hpp__ virtual ~TrajectoryBase()
EIGEN_MAKE_ALIGNED_OPERATOR_NEW TrajectoryBase(const std::string &name)
#define TSID_DISABLE_WARNING_POP
void resize(unsigned int size)
TrajectorySample m_sample
#define TSID_DISABLE_WARNING_PUSH
Eigen::Matrix< Scalar, Eigen::Dynamic, 1 > Vector
const math::Vector & getDerivative() const
#define TSID_DISABLE_WARNING_DEPRECATED
void setDerivative(const math::Vector &derivative)
EIGEN_MAKE_ALIGNED_OPERATOR_NEW TSID_DEPRECATED math::Vector pos
TrajectorySample(unsigned int size=0)
~TrajectorySample()=default
void setSecondDerivative(const math::Vector &second_derivative)
void resize(unsigned int size_value, unsigned int size_derivative)
TSID_DISABLE_WARNING_PUSH TSID_DISABLE_WARNING_DEPRECATED const math::Vector & getValue() const
Eigen::Map< const Eigen::Matrix< double, 3, 3 > > MapMatrix3
EIGEN_MAKE_ALIGNED_OPERATOR_NEW TSID_DEPRECATED math::Vector acc
const math::Vector & getSecondDerivative() const
void setValue(const math::Vector &value)
EIGEN_MAKE_ALIGNED_OPERATOR_NEW TSID_DEPRECATED math::Vector vel
virtual const TrajectorySample & getLastSample() const
TrajectorySample(unsigned int size_value, unsigned int size_derivative)