From 73bd5bfb6247b513964df7a7fc8093c3cbf615e1 Mon Sep 17 00:00:00 2001 From: Giulio Romualdi Date: Wed, 16 Jun 2021 18:25:56 +0200 Subject: [PATCH 1/8] Implement Spline interface --- src/Planners/CMakeLists.txt | 2 +- .../Planners/QuinticSpline.h | 31 ++---- .../BipedalLocomotion/Planners/Spline.h | 104 ++++++++++++++++++ src/Planners/src/QuinticSpline.cpp | 6 +- 4 files changed, 119 insertions(+), 24 deletions(-) create mode 100644 src/Planners/include/BipedalLocomotion/Planners/Spline.h diff --git a/src/Planners/CMakeLists.txt b/src/Planners/CMakeLists.txt index b11cd2152a..f6b2c30c32 100644 --- a/src/Planners/CMakeLists.txt +++ b/src/Planners/CMakeLists.txt @@ -8,7 +8,7 @@ if (FRAMEWORK_COMPILE_Planners) add_bipedal_locomotion_library( NAME Planners - PUBLIC_HEADERS ${H_PREFIX}/ConvexHullHelper.h ${H_PREFIX}/DCMPlanner.h ${H_PREFIX}/TimeVaryingDCMPlanner.h ${H_PREFIX}/QuinticSpline.h ${H_PREFIX}/SO3Planner.h ${H_PREFIX}/SO3Planner.tpp ${H_PREFIX}/SwingFootPlanner.h + PUBLIC_HEADERS ${H_PREFIX}/ConvexHullHelper.h ${H_PREFIX}/DCMPlanner.h ${H_PREFIX}/TimeVaryingDCMPlanner.h ${H_PREFIX}/Spline.h ${H_PREFIX}/QuinticSpline.h ${H_PREFIX}/SO3Planner.h ${H_PREFIX}/SO3Planner.tpp ${H_PREFIX}/SwingFootPlanner.h SOURCES src/ConvexHullHelper.cpp src/DCMPlanner.cpp src/TimeVaryingDCMPlanner.cpp src/QuinticSpline.cpp src/SwingFootPlanner.cpp PUBLIC_LINK_LIBRARIES Eigen3::Eigen BipedalLocomotion::ParametersHandler BipedalLocomotion::System BipedalLocomotion::Contacts PRIVATE_LINK_LIBRARIES Qhull::qhullcpp Qhull::qhullstatic_r casadi BipedalLocomotion::Math BipedalLocomotion::TextLogging diff --git a/src/Planners/include/BipedalLocomotion/Planners/QuinticSpline.h b/src/Planners/include/BipedalLocomotion/Planners/QuinticSpline.h index 5403ace0f5..3d53f57d65 100644 --- a/src/Planners/include/BipedalLocomotion/Planners/QuinticSpline.h +++ b/src/Planners/include/BipedalLocomotion/Planners/QuinticSpline.h @@ -8,29 +8,21 @@ #ifndef BIPEDAL_LOCOMOTION_PLANNERS_QUINTIC_SPLINE_H #define BIPEDAL_LOCOMOTION_PLANNERS_QUINTIC_SPLINE_H -#include #include +#include #include -#include +#include namespace BipedalLocomotion { namespace Planners { - -struct QuinticSplineState -{ - Eigen::VectorXd position; - Eigen::VectorXd velocity; - Eigen::VectorXd acceleration; -}; - /** * Quintic spline implement a 5-th order polynomial spline in \$f\mathbb{R}^n\$f. */ -class QuinticSpline : public System::Source +class QuinticSpline : public Spline { /** * Private implementation of the class @@ -56,7 +48,7 @@ class QuinticSpline : public System::Source * @param dt the time step of the advance block. * @return True in case of success, false otherwise. */ - bool setAdvanceTimeStep(const double& dt); + bool setAdvanceTimeStep(const double& dt) final; /** * Set the knots of the spline. @@ -64,7 +56,8 @@ class QuinticSpline : public System::Source * @param time vector containing the time instant of the knots. * @return True in case of success, false otherwise. */ - bool setKnots(const std::vector& position, const std::vector& time); + bool setKnots(const std::vector& position, // + const std::vector& time) final; /** * Set the initial condition of the spline @@ -73,7 +66,7 @@ class QuinticSpline : public System::Source * @return True in case of success, false otherwise. */ bool setInitialConditions(Eigen::Ref velocity, - Eigen::Ref acceleration); + Eigen::Ref acceleration) final; /** * Set the final condition of the spline @@ -82,7 +75,7 @@ class QuinticSpline : public System::Source * @return True in case of success, false otherwise. */ bool setFinalConditions(Eigen::Ref velocity, - Eigen::Ref acceleration); + Eigen::Ref acceleration) final; /** * Evaluate the spline at a given point @@ -95,7 +88,7 @@ class QuinticSpline : public System::Source bool evaluatePoint(const double& t, Eigen::Ref position, Eigen::Ref velocity, - Eigen::Ref acceleration); + Eigen::Ref acceleration) final; /** * Evaluate the spline at a given point @@ -103,8 +96,7 @@ class QuinticSpline : public System::Source * @param state of the system * @return True in case of success, false otherwise. */ - bool evaluatePoint(const double& t, - QuinticSplineState& state); + bool evaluatePoint(const double& t, SplineState& state) final; /** * Get the state of the system. @@ -112,7 +104,7 @@ class QuinticSpline : public System::Source * features. * @return a const reference of the requested object. */ - const QuinticSplineState& getOutput() const final; + const SplineState& getOutput() const final; /** * Determines the validity of the object retrieved with get() @@ -129,7 +121,6 @@ class QuinticSpline : public System::Source * @return True if the advance is successfull. */ bool advance() final; - }; } // namespace Planners } // namespace BipedalLocomotion diff --git a/src/Planners/include/BipedalLocomotion/Planners/Spline.h b/src/Planners/include/BipedalLocomotion/Planners/Spline.h new file mode 100644 index 0000000000..bf12d87010 --- /dev/null +++ b/src/Planners/include/BipedalLocomotion/Planners/Spline.h @@ -0,0 +1,104 @@ +/** + * @file Spline.h + * @authors Giulio Romualdi + * @copyright 2020. 2021 Istituto Italiano di Tecnologia (IIT). This software may be modified and + * distributed under the terms of the GNU Lesser General Public License v2.1 or any later version. + */ + +#ifndef BIPEDAL_LOCOMOTION_PLANNERS_SPLINE_H +#define BIPEDAL_LOCOMOTION_PLANNERS_SPLINE_H + +#include +#include + +#include + +#include + +namespace BipedalLocomotion +{ +namespace Planners +{ + +struct SplineState +{ + Eigen::VectorXd position; + Eigen::VectorXd velocity; + Eigen::VectorXd acceleration; +}; + +/** + * spline implement an interface for a Spline in \f$\mathbb{R}^n\f$ + */ +class Spline : public System::Source +{ +public: + /** + * Destructor. + */ + virtual ~Spline() = default; + + /** + * Set the time step of the advance interface. + * @warning if the the time step is not set the user cannot use the advance features. + * @param dt the time step of the advance block. + * @return True in case of success, false otherwise. + */ + virtual bool setAdvanceTimeStep(const double& dt) = 0; + + /** + * Set the knots of the spline. + * @param position position of the knots in \$f\mathbb{R}^n\$f. + * @param time vector containing the time instant of the knots. + * @return True in case of success, false otherwise. + */ + virtual bool setKnots(const std::vector& position, // + const std::vector& time) + = 0; + + /** + * Set the initial condition of the spline + * @param velocity initial velocity (i.e. first derivative). + * @param acceleration initial acceleration (i.e. second derivative). + * @return True in case of success, false otherwise. + */ + virtual bool setInitialConditions(Eigen::Ref velocity, + Eigen::Ref acceleration) + = 0; + + /** + * Set the final condition of the spline + * @param velocity final velocity (i.e. first derivative). + * @param acceleration final acceleration (i.e. second derivative). + * @return True in case of success, false otherwise. + */ + virtual bool setFinalConditions(Eigen::Ref velocity, + Eigen::Ref acceleration) + = 0; + + /** + * Evaluate the spline at a given point + * @param t instant time + * @param position position at time t + * @param velocity velocity at time t + * @param acceleration acceleration at time t + * @return True in case of success, false otherwise. + */ + virtual bool evaluatePoint(const double& t, + Eigen::Ref position, + Eigen::Ref velocity, + Eigen::Ref acceleration) + = 0; + + /** + * Evaluate the spline at a given point + * @param t instant time + * @param state of the system + * @return True in case of success, false otherwise. + */ + virtual bool evaluatePoint(const double& t, SplineState& state) = 0; +}; +} // namespace Planners +} // namespace BipedalLocomotion + +#endif // BIPEDAL_LOCOMOTION_PLANNERS_SPLINE_H diff --git a/src/Planners/src/QuinticSpline.cpp b/src/Planners/src/QuinticSpline.cpp index 93f5bcbb4e..595509e266 100644 --- a/src/Planners/src/QuinticSpline.cpp +++ b/src/Planners/src/QuinticSpline.cpp @@ -63,7 +63,7 @@ struct QuinticSpline::Impl bool areCoefficientsComputed{false}; /**< If true the coefficients are computed and updated */ - QuinticSplineState currentTrajectory; /**< Current trajectory stored in the advance state */ + SplineState currentTrajectory; /**< Current trajectory stored in the advance state */ double advanceTimeStep{0.0}; /**< Time step of the advance interface. */ double advanceCurrentTime{0.0}; /**< current time of the advance object. */ @@ -841,7 +841,7 @@ bool QuinticSpline::evaluatePoint(const double& t, return true; } -bool QuinticSpline::evaluatePoint(const double& t, QuinticSplineState& state) +bool QuinticSpline::evaluatePoint(const double& t, SplineState& state) { return this->evaluatePoint(t, state.position, state.velocity, state.acceleration); } @@ -875,7 +875,7 @@ bool QuinticSpline::advance() return evaluatePoint(m_pimpl->advanceCurrentTime, m_pimpl->currentTrajectory); } -const QuinticSplineState& QuinticSpline::getOutput() const +const SplineState& QuinticSpline::getOutput() const { return m_pimpl->currentTrajectory; } From b17185a76e5eb79047766cb53f0c420636b0d43d Mon Sep 17 00:00:00 2001 From: Giulio Romualdi Date: Mon, 21 Jun 2021 17:51:41 +0200 Subject: [PATCH 2/8] Draw the first implementation of CubicSpline --- src/Planners/CMakeLists.txt | 4 +- .../BipedalLocomotion/Planners/CubicSpline.h | 128 +++ src/Planners/src/CubicSpline.cpp | 768 ++++++++++++++++++ 3 files changed, 898 insertions(+), 2 deletions(-) create mode 100644 src/Planners/include/BipedalLocomotion/Planners/CubicSpline.h create mode 100644 src/Planners/src/CubicSpline.cpp diff --git a/src/Planners/CMakeLists.txt b/src/Planners/CMakeLists.txt index f6b2c30c32..ba76e8d999 100644 --- a/src/Planners/CMakeLists.txt +++ b/src/Planners/CMakeLists.txt @@ -8,8 +8,8 @@ if (FRAMEWORK_COMPILE_Planners) add_bipedal_locomotion_library( NAME Planners - PUBLIC_HEADERS ${H_PREFIX}/ConvexHullHelper.h ${H_PREFIX}/DCMPlanner.h ${H_PREFIX}/TimeVaryingDCMPlanner.h ${H_PREFIX}/Spline.h ${H_PREFIX}/QuinticSpline.h ${H_PREFIX}/SO3Planner.h ${H_PREFIX}/SO3Planner.tpp ${H_PREFIX}/SwingFootPlanner.h - SOURCES src/ConvexHullHelper.cpp src/DCMPlanner.cpp src/TimeVaryingDCMPlanner.cpp src/QuinticSpline.cpp src/SwingFootPlanner.cpp + PUBLIC_HEADERS ${H_PREFIX}/ConvexHullHelper.h ${H_PREFIX}/DCMPlanner.h ${H_PREFIX}/TimeVaryingDCMPlanner.h ${H_PREFIX}/Spline.h ${H_PREFIX}/QuinticSpline.h ${H_PREFIX}/SO3Planner.h ${H_PREFIX}/SO3Planner.tpp ${H_PREFIX}/SwingFootPlanner.h ${H_PREFIX}/CubicSpline.h + SOURCES src/ConvexHullHelper.cpp src/DCMPlanner.cpp src/TimeVaryingDCMPlanner.cpp src/QuinticSpline.cpp src/SwingFootPlanner.cpp src/CubicSpline.cpp PUBLIC_LINK_LIBRARIES Eigen3::Eigen BipedalLocomotion::ParametersHandler BipedalLocomotion::System BipedalLocomotion::Contacts PRIVATE_LINK_LIBRARIES Qhull::qhullcpp Qhull::qhullstatic_r casadi BipedalLocomotion::Math BipedalLocomotion::TextLogging INSTALLATION_FOLDER Planners) diff --git a/src/Planners/include/BipedalLocomotion/Planners/CubicSpline.h b/src/Planners/include/BipedalLocomotion/Planners/CubicSpline.h new file mode 100644 index 0000000000..366aee0275 --- /dev/null +++ b/src/Planners/include/BipedalLocomotion/Planners/CubicSpline.h @@ -0,0 +1,128 @@ +/** + * @file CubicSpline.h + * @authors Giulio Romualdi + * @copyright 2020 Istituto Italiano di Tecnologia (IIT). This software may be modified and + * distributed under the terms of the GNU Lesser General Public License v2.1 or any later version. + */ + +#ifndef BIPEDAL_LOCOMOTION_PLANNERS_CUBIC_SPLINE_H +#define BIPEDAL_LOCOMOTION_PLANNERS_CUBIC_SPLINE_H + +#include +#include + +#include + +#include + +namespace BipedalLocomotion +{ +namespace Planners +{ +/** + * Cubic spline implement a 5-th order polynomial spline in \$f\mathbb{R}^n\$f. + */ +class CubicSpline : public Spline +{ + /** + * Private implementation of the class + */ + struct Impl; + std::unique_ptr m_pimpl; /**< Private implementation */ + +public: + /** + * Constructor. + */ + CubicSpline(); + + /** + * Destructor. + * @note It is required by the PIMPL idiom. + */ + ~CubicSpline(); + + /** + * Set the time step of the advance interface. + * @warning if the the time step is not set the user cannot use the advance features. + * @param dt the time step of the advance block. + * @return True in case of success, false otherwise. + */ + bool setAdvanceTimeStep(const double& dt) final; + + /** + * Set the knots of the spline. + * @param position position of the knots in \$f\mathbb{R}^n\$f. + * @param time vector containing the time instant of the knots. + * @return True in case of success, false otherwise. + */ + bool setKnots(const std::vector& position, // + const std::vector& time) final; + + /** + * Set the initial condition of the spline + * @param velocity initial velocity (i.e. first derivative). + * @param acceleration initial acceleration (i.e. second derivative). + * @return True in case of success, false otherwise. + */ + bool setInitialConditions(Eigen::Ref velocity, + Eigen::Ref acceleration) final; + + /** + * Set the final condition of the spline + * @param velocity final velocity (i.e. first derivative). + * @param acceleration final acceleration (i.e. second derivative). + * @return True in case of success, false otherwise. + */ + bool setFinalConditions(Eigen::Ref velocity, + Eigen::Ref acceleration) final; + + /** + * Evaluate the spline at a given point + * @param t instant time + * @param position position at time t + * @param velocity velocity at time t + * @param acceleration acceleration at time t + * @return True in case of success, false otherwise. + */ + bool evaluatePoint(const double& t, + Eigen::Ref position, + Eigen::Ref velocity, + Eigen::Ref acceleration) final; + + /** + * Evaluate the spline at a given point + * @param t instant time + * @param state of the system + * @return True in case of success, false otherwise. + */ + bool evaluatePoint(const double& t, SplineState& state) final; + + /** + * Get the state of the system. + * @warning if the the time step of the advance is not set the user cannot use the advance + * features. + * @return a const reference of the requested object. + */ + const SplineState& getOutput() const final; + + /** + * Determines the validity of the object retrieved with get() + * @warning if the the time step of the advance is not set the user cannot use the advance + * features. + * @return True if the object is valid, false otherwise. + */ + bool isOutputValid() const final; + + /** + * Advance the internal state. This may change the value retrievable from get(). + * @warning if the the time step of the advance is not set the user cannot use the advance + * features. + * @return True if the advance is successfull. + */ + bool advance() final; +}; +} // namespace Planners +} // namespace BipedalLocomotion + +#endif // BIPEDAL_LOCOMOTION_PLANNERS_CUBIC_SPLINE_H diff --git a/src/Planners/src/CubicSpline.cpp b/src/Planners/src/CubicSpline.cpp new file mode 100644 index 0000000000..2ca9dd8be8 --- /dev/null +++ b/src/Planners/src/CubicSpline.cpp @@ -0,0 +1,768 @@ +/** + * @file CubicSpline.cpp + * @authors Giulio Romualdi + * @copyright 2020 Istituto Italiano di Tecnologia (IIT). This software may be modified and + * distributed under the terms of the GNU Lesser General Public License v2.1 or any later version. + */ + +#include +#include + +#include + +#include +#include + +using namespace BipedalLocomotion::Planners; + +struct CubicSpline::Impl +{ + /** + * Struct containing the boundary condtion + */ + struct BoundaryConditions + { + Eigen::VectorXd velocity; + Eigen::VectorXd acceleration; + }; + + /** + * Description of a knot + */ + struct Knot + { + Eigen::VectorXd position; /**< Knot position */ + Eigen::VectorXd velocity; /**< first derivative of spline computed at t@knot */ + Eigen::VectorXd acceleration; /**< second derivative of spline computed at t@knot */ + + double timeInstant; /**< Knot time (it is an absolute time ) */ + }; + + /** + * Description of a 5-th polynomial. It contains the coefficients, the initial/final knots and + * the duration of the sub-trajectory. + */ + struct Polynomial + { + Eigen::VectorXd a0; + Eigen::VectorXd a1; + Eigen::VectorXd a2; + Eigen::VectorXd a3; + + const Knot* initialPoint; + const Knot* finalPoint; + + double duration; + }; + + BoundaryConditions initialCondition; /**< Initial condition */ + BoundaryConditions finalCondition; /**< Final condition */ + + std::vector knots; /**< Collection of all the knots */ + std::vector polynomials; /**< Collection of all the polynomials */ + + bool areCoefficientsComputed{false}; /**< If true the coefficients are computed and updated */ + + SplineState currentTrajectory; /**< Current trajectory stored in the advance state */ + double advanceTimeStep{0.0}; /**< Time step of the advance interface. */ + double advanceCurrentTime{0.0}; /**< current time of the advance object. */ + + /** + * Reset a given knot with a time instant and a position + */ + void resetKnot(const double& timeInstant, + Eigen::Ref position, + Knot& knot); + + /** + * Get the position at given time for a sub-trajectory + */ + void getPositionAtTime(const double& t, + const Polynomial& poly, + Eigen::Ref position); + + /** + * Get the velocity at given time for a sub-trajectory + */ + void getVelocityAtTime(const double& t, + const Polynomial& poly, + Eigen::Ref velocity); + + /** + * Get the acceleration at given time for a sub-trajectory + */ + void getAccelerationAtTime(const double& t, + const Polynomial& poly, + Eigen::Ref acceleration); + + /** + * Compute the duration of each phase + */ + bool computePhasesDuration(); + + /** + * Set the boundary condition. This function is called before computing all the intermediate + * velocities and accelerations. + */ + bool setBoundaryVelocitiesAndAcceleration(); + + /** + * addTripletCurrentKnot is a helper function to generate a triplet containing a 2x2 matrix. + * This matrix is used to compute the intermediate velocity and acceleration. + */ + void addTripletCurrentKnot(const int& knotIndex, + const int& rowOffset, + const int& columnOffset, + std::vector>& tripletList); + + /** + * addTripletPreviousKnot is a helper function to generate a triplet containing a 2x2 matrix. + * This matrix is used to compute the intermediate velocity and acceleration. + */ + void addTripletPreviousKnot(const int& knotIndex, + const int& rowOffset, + const int& columnOffset, + std::vector>& tripletList); + /** + * addTripletNextKnot is a helper function to generate a triplet containing a 2x2 matrix. + * This matrix is used to compute the intermediate velocity and acceleration. + */ + void addTripletNextKnot(const int& knotIndex, + const int& rowOffset, + const int& columnOffset, + std::vector>& tripletList); + + /** + * addKnownTermKnotPosition is a helper function to generate a 2-d vector, + * This vector is the known term used to compute the intermediate velocity and acceleration. + */ + void addKnownTermKnotPosition(const std::size_t& knotIndex, + const std::size_t& coordinateIndex, + Eigen::Ref b); + + /** + * addKnownTermNextKnot is a helper function to generate a 2-d vector, + * This vector is the known term used to compute the intermediate velocity and acceleration. + */ + void addKnownTermNextKnot(const std::size_t& knotIndex, + const std::size_t& coordinateIndex, + Eigen::Ref b); + + /** + * addKnownTermPreviousKnot is a helper function to generate a 2-d vector, + * This vector is the known term used to compute the intermediate velocity and acceleration. + */ + void addKnownTermPreviousKnot(const std::size_t& knotIndex, + const std::size_t& coordinateIndex, + Eigen::Ref b); + + /** + * Compute the intermediate velocities + */ + void computeIntermediateVelocities(); + + /** + * Function to set the coefficients of the polynomials + */ + void setPolynomialCoefficients(Polynomial& poly); + + /** + * This function is the entry point to compute the coefficients of the spline + */ + bool computeCoefficients(); +}; + +CubicSpline::CubicSpline() +{ + m_pimpl = std::make_unique(); +} + +CubicSpline::~CubicSpline() = default; + +bool CubicSpline::setInitialConditions(Eigen::Ref velocity, + Eigen::Ref /**acceleration*/) +{ + m_pimpl->initialCondition.velocity = velocity; + + // Set the initial state for the advance interface + m_pimpl->currentTrajectory.velocity = velocity; + m_pimpl->currentTrajectory.acceleration = Eigen::VectorXd::Zero(velocity.size()); + + // The initial conditions changed. The coefficients are outdated. + m_pimpl->areCoefficientsComputed = false; + + return true; +} + +bool CubicSpline::setFinalConditions(Eigen::Ref velocity, + Eigen::Ref /**acceleration*/) +{ + m_pimpl->finalCondition.velocity = velocity; + m_pimpl->finalCondition.acceleration = Eigen::VectorXd::Zero(velocity.size()); + + // The final conditions changed. The coefficients are outdated. + m_pimpl->areCoefficientsComputed = false; + + return true; +} + +bool CubicSpline::setAdvanceTimeStep(const double& dt) +{ + constexpr auto logPrefix = "[CubicSpline::setAdvanceTimeStep]"; + + if (dt <= 0) + { + log()->error("{} The time step of the advance object has to be a strictly positive number.", + logPrefix); + return false; + } + + m_pimpl->advanceTimeStep = dt; + + return true; +} + +bool CubicSpline::setKnots(const std::vector& position, + const std::vector& time) +{ + constexpr auto logPrefix = "[CubicSpline::setKnots]"; + + if (position.size() < 2) + { + log()->error("{} The number of knots has to be at least 2.", logPrefix); + return false; + } + + if (time.size() != position.size()) + { + log()->error("{} The number of points has to be equal to the length of the time vector.", + logPrefix); + return false; + } + + // resize the vector containing all the knots + m_pimpl->knots.resize(time.size()); + + const std::size_t sizeOfVectors = position[0].size(); + for (std::size_t i = 0; i < m_pimpl->knots.size(); i++) + { + if (position[i].size() != sizeOfVectors) + { + log()->error("{} The size of the knot number {} is different from the one expected. " + "Expected: {} Retrieved {}.", + logPrefix, + i, + sizeOfVectors, + position[i].size()); + return false; + } + + // set all the knots + m_pimpl->resetKnot(time[i], position[i], m_pimpl->knots[i]); + } + + // set the initial state for the advance interface + m_pimpl->currentTrajectory.position = position.front(); + m_pimpl->advanceCurrentTime = time.front(); + + // The knots changed. The coefficients are outdated. + m_pimpl->areCoefficientsComputed = false; + + return true; +} + +void CubicSpline::Impl::resetKnot(const double& timeInstant, + Eigen::Ref position, + Knot& knot) +{ + knot.timeInstant = timeInstant; + knot.position = position; + + const std::size_t sizeOfVectors = position.size(); + knot.velocity.resize(sizeOfVectors); + knot.acceleration.resize(sizeOfVectors); +} + +bool CubicSpline::Impl::computePhasesDuration() +{ + constexpr auto errorPrefix = "[CubicSpline::Impl::computePhasesDuration]"; + + for (std::size_t i = 0; i < knots.size() - 1; i++) + { + polynomials[i].duration = knots[i + 1].timeInstant - knots[i].timeInstant; + + // This is required or stability purposes, the matrix A may not be invertible. + if (std::abs(polynomials[i].duration) <= std::numeric_limits::epsilon()) + { + log()->error("{} Two consecutive points have the same time coordinate.", errorPrefix); + return false; + } + } + return true; +} + +bool CubicSpline::Impl::computeCoefficients() +{ + constexpr auto errorPrefix = "[CubicSpline::Impl::computeCoefficients]"; + // check if the user already sets the knots + if (knots.empty()) + { + log()->error("{} Please set the knots before computing the coefficients.", errorPrefix); + return false; + } + + // the number of polynomials is equal to the "number of knots - 1" + this->polynomials.resize(knots.size() - 1); + + // set the velocity and acceleration boundary conditions + if (!this->setBoundaryVelocitiesAndAcceleration()) + { + log()->error("{} Unable to set the boundary conditions related to the velocity and " + "acceleration.", + errorPrefix); + return false; + } + + // compute the duration of each phase (sub-trajectory) + if (!this->computePhasesDuration()) + { + log()->error("{} Unable to compute the phase duration.", errorPrefix); + return false; + } + + // populate the polynomials vector with the knots + for (int i = 0; i < polynomials.size(); i++) + { + polynomials[i].initialPoint = &(knots[i]); + polynomials[i].finalPoint = &(knots[i + 1]); + } + + // intermediate conditions have to be computed only if the knots are greater than equal 3 + if (knots.size() > 2) + { + this->computeIntermediateVelocities(); + } + + // populate the coefficients of each polynomial + for (auto& poly : polynomials) + { + this->setPolynomialCoefficients(poly); + } + + // the coefficients have been computed + areCoefficientsComputed = true; + + return true; +} + +bool CubicSpline::Impl::setBoundaryVelocitiesAndAcceleration() +{ + constexpr auto errorPrefix = "[CubicSpline::Impl::setBoundaryVelocitiesAndAcceleration]"; + + // this is an internal function and it is called only after setting the knots. However + // the following assert checks that the number of knots is at least 1 + assert(!knots.empty()); + + const int knotSize = knots.front().position.size(); + + if (knotSize != initialCondition.velocity.size()) + { + log()->error("{} The size of the initial velocity is different from the expected one. " + "Expected: {}. Retrieved: {}.", + errorPrefix, + knotSize, + initialCondition.velocity.size()); + return false; + } + + if (knotSize != initialCondition.acceleration.size()) + { + log()->error("{} The size of the initial acceleration is different from the expected one. " + "Expected: {}. Retrieved: {}.", + errorPrefix, + knotSize, + initialCondition.acceleration.size()); + return false; + } + + if (knotSize != finalCondition.velocity.size()) + { + log()->error("{} The size of the final velocity is different from the expected one. " + "Expected: {}. Retrieved: {}.", + errorPrefix, + knotSize, + finalCondition.velocity.size()); + return false; + } + + if (knotSize != finalCondition.acceleration.size()) + { + log()->error("{} The size of the final acceleration is different from the expected one. " + "Expected: {}. Retrieved: {}.", + errorPrefix, + knotSize, + finalCondition.acceleration.size()); + return false; + } + + // store the boundary conditions + knots.front().velocity = initialCondition.velocity; + knots.front().acceleration = initialCondition.acceleration; + + knots.back().velocity = finalCondition.velocity; + knots.back().acceleration = finalCondition.acceleration; + + return true; +} + +void CubicSpline::Impl::addTripletCurrentKnot(const int& knotIndex, + const int& rowOffset, + const int& columnOffset, + std::vector>& tripletList) +{ + const auto& poly = polynomials[knotIndex]; + const auto& prevPoly = polynomials[knotIndex - 1]; + + // The following triplet represent this matrix + // / / 1 1\ \ + // | 4 |------ - --| | + // | |T T | | + // | \ i - 1 i/ | + // \ / + + tripletList.emplace_back(rowOffset, + columnOffset, + 4 * (1 / prevPoly.duration + 1 / poly.duration)); +} + +void CubicSpline::Impl::addTripletPreviousKnot(const int& knotIndex, + const int& rowOffset, + const int& columnOffset, + std::vector>& tripletList) +{ + const auto& poly = polynomials[knotIndex - 1]; + + // The following triplet represent this matrix + // / 2 \ + // | ------- | + // | T | + // \ i - 1 / + + tripletList.emplace_back(rowOffset, columnOffset, 2 / poly.duration); +} + +void CubicSpline::Impl::addTripletNextKnot(const int& knotIndex, + const int& rowOffset, + const int& columnOffset, + std::vector>& tripletList) +{ + const auto& poly = polynomials[knotIndex]; + + // The following triplet represent this matrix + // / 2 \ + // | --- | + // | T | + // \ i / + + tripletList.emplace_back(rowOffset, columnOffset, 2 / poly.duration); +} + +void CubicSpline::Impl::addKnownTermKnotPosition(const std::size_t& knotIndex, + const std::size_t& coordinateIndex, + Eigen::Ref b) +{ + const auto& poly = polynomials; + + const auto& i = knotIndex; + const auto& j = coordinateIndex; + + b[0] += 6 + * (1 / std::pow(poly[i - 1].duration, 2) + * (knots[i].position[j] - knots[i - 1].position[j]) + + 1 / std::pow(poly[i].duration, 3) + * (knots[i].position[j] - knots[i + 1].position[j])); +} + +void CubicSpline::Impl::addKnownTermNextKnot(const std::size_t& knotIndex, + const std::size_t& coordinateIndex, + Eigen::Ref b) +{ + const auto& poly = polynomials; + const auto& i = knotIndex; + const auto& j = coordinateIndex; + b[0] -= 2 * knots[i + 1].velocity[j] / poly[i].duration; +} + +void CubicSpline::Impl::addKnownTermPreviousKnot(const std::size_t& knotIndex, + const std::size_t& coordinateIndex, + Eigen::Ref b) +{ + const auto& poly = polynomials; + + const auto& i = knotIndex; + const auto& j = coordinateIndex; + + b[0] -= 2 * knots[i - 1].velocity[j] / poly[i - 1].duration; +} + +void CubicSpline::Impl::setPolynomialCoefficients(Polynomial& poly) +{ + const auto& T = poly.duration; + + const auto& x0 = poly.initialPoint->position; + const auto& dx0 = poly.initialPoint->velocity; + + const auto& xT = poly.finalPoint->position; + const auto& dxT = poly.finalPoint->velocity; + + poly.a0 = x0; + poly.a1 = dx0; + poly.a2 = -(3 * x0 - 3 * xT + 2 * T * dx0 + T * dxT) / (T * T); + poly.a3 = (2*x0 - 2*xT + T*dx0 + T*dxT) / (T * T * T); +} + +void CubicSpline::Impl::computeIntermediateVelocities() +{ + // here we assume that at least 3 points has been defined + const std::size_t numberOfInteriorKnots = knots.size() - 2; + + Eigen::SparseMatrix A(numberOfInteriorKnots, numberOfInteriorKnots); + std::vector> tripletsList; + + // Given a set of interior points the we can define a matrix A as + // __ __ + // | x x 0 0 0 0 0 0 0 0 0 0 ... 0 0 0 0 0 0 0 | + // | x x x 0 0 0 0 0 0 0 0 0 ... 0 0 0 0 0 0 0 | + // | 0 x x x 0 0 0 0 0 0 0 0 ... 0 0 0 0 0 0 0 | + // /\ ______ | 0 0 x x x 0 0 0 0 0 0 0 ... 0 0 0 0 0 0 0 | + // / \ |______| | 0 0 0 x x x 0 0 0 0 0 0 ... 0 0 0 0 0 0 0 | + // / /\ \ ______ | ........................ | + // / ____ \ |______| | ........................ | + // /_/ \_\ | ........................ | + // | 0 0 0 0 0 0 0 0 0 0 0 0 ... x x x 0 0 0 0 | + // | 0 0 0 0 0 0 0 0 0 0 0 0 ... 0 x x x 0 0 0 | + // | 0 0 0 0 0 0 0 0 0 0 0 0 ... 0 0 x x x 0 0 | + // | 0 0 0 0 0 0 0 0 0 0 0 0 ... 0 0 0 x x x 0 | + // | 0 0 0 0 0 0 0 0 0 0 0 0 ... 0 0 0 0 x x x | + // | 0 0 0 0 0 0 0 0 0 0 0 0 ... 0 0 0 0 0 x x | + // |__ __| + // + // where x represents a non zero number and 0 represents the number 0. The matrix A can be + // stored as a sparse matrix where the number of non zero entries for the extremum elements are + // 2 and the number of non zero elements for the interior (non extremum elements) are 3 + // The matrix A is a square matrix whose number of columns (and rows) is equal to the + // number of interior knots of the spline times. If there is only an interior knot, A is a 1x1 + // dense matrix. + unsigned int numberOfExpectedTriplets = 1; + if (numberOfInteriorKnots > 1) + { + constexpr std::size_t numberOfExtremumElements = 2; + constexpr std::size_t numberOfNonExtremumElements = 4; + constexpr std::size_t numberOfExtremum = 2; + numberOfExpectedTriplets = numberOfNonExtremumElements // + * (numberOfInteriorKnots - numberOfExtremum) + + numberOfExtremum * numberOfExtremumElements; + } + tripletsList.reserve(numberOfExpectedTriplets); + + for (int i = 0; i < numberOfInteriorKnots; i++) + { + const int absoluteKnotIndex = i + 1; + + // in this case there is only one interior knot A will be a 2 + if (i == 0 && (i + 1) == numberOfInteriorKnots) + { + this->addTripletCurrentKnot(absoluteKnotIndex, 0, 0, tripletsList); + } else if (i == 0) + { + this->addTripletCurrentKnot(absoluteKnotIndex, i, 0, tripletsList); + this->addTripletNextKnot(absoluteKnotIndex, i, 1, tripletsList); + } else if (i + 1 == numberOfInteriorKnots) + { + this->addTripletPreviousKnot(absoluteKnotIndex, i, (i - 1), tripletsList); + this->addTripletCurrentKnot(absoluteKnotIndex, i, (i - 1) + 1, tripletsList); + } else + { + this->addTripletPreviousKnot(absoluteKnotIndex, i, (i - 1), tripletsList); + this->addTripletCurrentKnot(absoluteKnotIndex, i, (i - 1) + 1, tripletsList); + this->addTripletNextKnot(absoluteKnotIndex, i, (i - 1) + 1 + 1, tripletsList); + } + } + + A.setFromTriplets(tripletsList.begin(), tripletsList.end()); + + // compute first coordinate + Eigen::VectorXd b(A.rows()); + for (size_t j = 0; j < knots.front().position.size(); j++) + { + b.setZero(); + for (size_t i = 0; i < numberOfInteriorKnots; i++) + { + const int absoluteKnotIndex = i + 1; + + if (i == 0 && (i + 1) == numberOfInteriorKnots) + { + this->addKnownTermKnotPosition(absoluteKnotIndex, j, b.head<1>()); + this->addKnownTermNextKnot(absoluteKnotIndex, j, b.head<1>()); + this->addKnownTermPreviousKnot(absoluteKnotIndex, j, b.head<1>()); + + } else if (i == 0) + { + this->addKnownTermKnotPosition(absoluteKnotIndex, j, b.head<1>()); + this->addKnownTermPreviousKnot(absoluteKnotIndex, j, b.head<1>()); + + } else if (i + 1 == numberOfInteriorKnots) + { + this->addKnownTermNextKnot(absoluteKnotIndex, j, b.segment<1>(i)); + this->addKnownTermKnotPosition(absoluteKnotIndex, j, b.segment<1>(i)); + } + + else + { + this->addKnownTermKnotPosition(absoluteKnotIndex, j, b.segment<2>(i)); + } + } + + Eigen::SparseQR, + Eigen::COLAMDOrdering::StorageIndex>> + qrDecomposition; + qrDecomposition.compute(A); + Eigen::VectorXd solution = qrDecomposition.solve(b); + + for (size_t i = 0; i < numberOfInteriorKnots; i++) + { + const int absoluteKnotIndex = i + 1; + + knots[absoluteKnotIndex].velocity[j] = solution[i]; + } + } +} + +void CubicSpline::Impl::getPositionAtTime(const double& t, + const Polynomial& poly, + Eigen::Ref position) +{ + // improve the readability of the code + const auto& a0 = poly.a0; + const auto& a1 = poly.a1; + const auto& a2 = poly.a2; + const auto& a3 = poly.a3; + + position = a0 + a1 * t + a2 * std::pow(t, 2) + a3 * std::pow(t, 3); +} + +void CubicSpline::Impl::getVelocityAtTime(const double& t, + const Polynomial& poly, + Eigen::Ref velocity) +{ + // improve the readability of the code + const auto& a1 = poly.a1; + const auto& a2 = poly.a2; + const auto& a3 = poly.a3; + + velocity = a1 + 2 * a2 * t + 3 * a3 * std::pow(t, 2); +} + +void CubicSpline::Impl::getAccelerationAtTime(const double& t, + const Polynomial& poly, + Eigen::Ref acceleration) +{ + // improve the readability of the code + const auto& a2 = poly.a2; + const auto& a3 = poly.a3; + + acceleration = 2 * a2 + 2 * 3 * a3 * t; +} + +bool CubicSpline::evaluatePoint(const double& t, + Eigen::Ref position, + Eigen::Ref velocity, + Eigen::Ref acceleration) +{ + constexpr auto logPrefix = "[CubicSpline::evaluatePoint]"; + if (!m_pimpl->areCoefficientsComputed) + { + if (!m_pimpl->computeCoefficients()) + { + log()->error("{} Unable to compute the coefficients of the spline.", logPrefix); + return false; + } + } + + if (t < m_pimpl->polynomials.front().initialPoint->timeInstant) + { + position = m_pimpl->knots.front().position; + velocity = m_pimpl->knots.front().velocity; + acceleration = m_pimpl->knots.front().acceleration; + + return true; + } + + if (t >= m_pimpl->polynomials.back().finalPoint->timeInstant) + { + position = m_pimpl->knots.back().position; + velocity = m_pimpl->knots.back().velocity; + acceleration = m_pimpl->knots.back().acceleration; + + return true; + } + + const auto poly = std::find_if(m_pimpl->polynomials.begin(), + m_pimpl->polynomials.end(), + [&t](const auto& p) { + return ((t >= p.initialPoint->timeInstant) + && (t < p.finalPoint->timeInstant)); + }); + + if (poly == m_pimpl->polynomials.end()) + { + log()->error("{} Unable to find the sub-trajectory.", logPrefix); + return false; + } + + m_pimpl->getPositionAtTime(t - poly->initialPoint->timeInstant, *poly, position); + m_pimpl->getVelocityAtTime(t - poly->initialPoint->timeInstant, *poly, velocity); + m_pimpl->getAccelerationAtTime(t - poly->initialPoint->timeInstant, *poly, acceleration); + + return true; +} + +bool CubicSpline::evaluatePoint(const double& t, SplineState& state) +{ + return this->evaluatePoint(t, state.position, state.velocity, state.acceleration); +} + +bool CubicSpline::isOutputValid() const +{ + // if the time step is different from zero and the user already set the knots the advance + // capabilities can be used + bool ok = (m_pimpl->advanceTimeStep != 0.0) && (!m_pimpl->knots.empty()); + return ok; +} + +bool CubicSpline::advance() +{ + constexpr auto logPrefix = "[CubicSpline::advance]"; + if (!this->isOutputValid()) + { + log()->error("{} The advance capabilities cannot ne used. Have you set the advance time " + "step?", + logPrefix); + return false; + } + + // advance the time step + m_pimpl->advanceCurrentTime = std::min(m_pimpl->advanceTimeStep + m_pimpl->advanceCurrentTime, + m_pimpl->knots.back().timeInstant); + + // Here we can improve the performances by avoiding calling the evaluatePoint function + // indeed this function performs a binary search to find the sub-trajectory for a given time + // instant. When the advance is called the sequence of the sub-trajectory is already + // predetermined. + return evaluatePoint(m_pimpl->advanceCurrentTime, m_pimpl->currentTrajectory); +} + +const SplineState& CubicSpline::getOutput() const +{ + return m_pimpl->currentTrajectory; +} From 0c0aa79583986775b352148fad0433d0135c163c Mon Sep 17 00:00:00 2001 From: Giulio Romualdi Date: Mon, 21 Jun 2021 21:24:00 +0200 Subject: [PATCH 3/8] Bugfix in CubicSpline.cpp --- src/Planners/src/CubicSpline.cpp | 49 ++++++++++++++++++++++---------- 1 file changed, 34 insertions(+), 15 deletions(-) diff --git a/src/Planners/src/CubicSpline.cpp b/src/Planners/src/CubicSpline.cpp index 2ca9dd8be8..94977c6417 100644 --- a/src/Planners/src/CubicSpline.cpp +++ b/src/Planners/src/CubicSpline.cpp @@ -183,6 +183,7 @@ bool CubicSpline::setInitialConditions(Eigen::Ref velocit Eigen::Ref /**acceleration*/) { m_pimpl->initialCondition.velocity = velocity; + m_pimpl->initialCondition.acceleration = Eigen::VectorXd::Zero(velocity.size()); // Set the initial state for the advance interface m_pimpl->currentTrajectory.velocity = velocity; @@ -191,6 +192,11 @@ bool CubicSpline::setInitialConditions(Eigen::Ref velocit // The initial conditions changed. The coefficients are outdated. m_pimpl->areCoefficientsComputed = false; + if (m_pimpl->finalCondition.velocity.size() != 0 && !m_pimpl->knots.empty()) + { + return this->evaluatePoint(m_pimpl->knots.front().timeInstant, m_pimpl->currentTrajectory); + } + return true; } @@ -203,6 +209,11 @@ bool CubicSpline::setFinalConditions(Eigen::Ref velocity, // The final conditions changed. The coefficients are outdated. m_pimpl->areCoefficientsComputed = false; + if (m_pimpl->initialCondition.velocity.size() != 0 && !m_pimpl->knots.empty()) + { + return this->evaluatePoint(m_pimpl->knots.front().timeInstant, m_pimpl->currentTrajectory); + } + return true; } @@ -268,6 +279,12 @@ bool CubicSpline::setKnots(const std::vector& position, // The knots changed. The coefficients are outdated. m_pimpl->areCoefficientsComputed = false; + if (m_pimpl->initialCondition.velocity.size() != 0 + && m_pimpl->finalCondition.velocity.size() != 0) + { + return this->evaluatePoint(m_pimpl->knots.front().timeInstant, m_pimpl->currentTrajectory); + } + return true; } @@ -477,10 +494,8 @@ void CubicSpline::Impl::addKnownTermKnotPosition(const std::size_t& knotIndex, const auto& j = coordinateIndex; b[0] += 6 - * (1 / std::pow(poly[i - 1].duration, 2) - * (knots[i].position[j] - knots[i - 1].position[j]) - + 1 / std::pow(poly[i].duration, 3) - * (knots[i].position[j] - knots[i + 1].position[j])); + * ((knots[i].position[j] - knots[i - 1].position[j]) / std::pow(poly[i - 1].duration, 2) + + (knots[i + 1].position[j] - knots[i].position[j]) / std::pow(poly[i].duration, 2)); } void CubicSpline::Impl::addKnownTermNextKnot(const std::size_t& knotIndex, @@ -518,7 +533,7 @@ void CubicSpline::Impl::setPolynomialCoefficients(Polynomial& poly) poly.a0 = x0; poly.a1 = dx0; poly.a2 = -(3 * x0 - 3 * xT + 2 * T * dx0 + T * dxT) / (T * T); - poly.a3 = (2*x0 - 2*xT + T*dx0 + T*dxT) / (T * T * T); + poly.a3 = (2 * x0 - 2 * xT + T * dx0 + T * dxT) / (T * T * T); } void CubicSpline::Impl::computeIntermediateVelocities() @@ -664,8 +679,8 @@ void CubicSpline::Impl::getVelocityAtTime(const double& t, } void CubicSpline::Impl::getAccelerationAtTime(const double& t, - const Polynomial& poly, - Eigen::Ref acceleration) + const Polynomial& poly, + Eigen::Ref acceleration) { // improve the readability of the code const auto& a2 = poly.a2; @@ -691,19 +706,23 @@ bool CubicSpline::evaluatePoint(const double& t, if (t < m_pimpl->polynomials.front().initialPoint->timeInstant) { - position = m_pimpl->knots.front().position; - velocity = m_pimpl->knots.front().velocity; - acceleration = m_pimpl->knots.front().acceleration; + constexpr double initialTime = 0; + + m_pimpl->getPositionAtTime(initialTime, m_pimpl->polynomials.front(), position); + m_pimpl->getVelocityAtTime(initialTime, m_pimpl->polynomials.front(), velocity); + m_pimpl->getAccelerationAtTime(initialTime, m_pimpl->polynomials.front(), acceleration); + return true; } if (t >= m_pimpl->polynomials.back().finalPoint->timeInstant) { - position = m_pimpl->knots.back().position; - velocity = m_pimpl->knots.back().velocity; - acceleration = m_pimpl->knots.back().acceleration; - + const double finalTime = m_pimpl->polynomials.back().finalPoint->timeInstant + - m_pimpl->polynomials.back().initialPoint->timeInstant; + m_pimpl->getPositionAtTime(finalTime, m_pimpl->polynomials.back(), position); + m_pimpl->getVelocityAtTime(finalTime, m_pimpl->polynomials.back(), velocity); + m_pimpl->getAccelerationAtTime(finalTime, m_pimpl->polynomials.back(), acceleration); return true; } @@ -759,7 +778,7 @@ bool CubicSpline::advance() // indeed this function performs a binary search to find the sub-trajectory for a given time // instant. When the advance is called the sequence of the sub-trajectory is already // predetermined. - return evaluatePoint(m_pimpl->advanceCurrentTime, m_pimpl->currentTrajectory); + return this->evaluatePoint(m_pimpl->advanceCurrentTime, m_pimpl->currentTrajectory); } const SplineState& CubicSpline::getOutput() const From 8c491408eec69b3894ad8ab16d985cd8eb3dc907 Mon Sep 17 00:00:00 2001 From: Giulio Romualdi Date: Mon, 21 Jun 2021 21:26:18 +0200 Subject: [PATCH 4/8] Restructure SplineTest --- src/Planners/tests/CMakeLists.txt | 4 ++-- src/Planners/tests/{QuinticSplineTest.cpp => SplineTest.cpp} | 0 2 files changed, 2 insertions(+), 2 deletions(-) rename src/Planners/tests/{QuinticSplineTest.cpp => SplineTest.cpp} (100%) diff --git a/src/Planners/tests/CMakeLists.txt b/src/Planners/tests/CMakeLists.txt index 0c993cfd4a..2dac4de84f 100644 --- a/src/Planners/tests/CMakeLists.txt +++ b/src/Planners/tests/CMakeLists.txt @@ -13,8 +13,8 @@ add_bipedal_test( LINKS BipedalLocomotion::Planners BipedalLocomotion::Math) add_bipedal_test( - NAME QuinticSpline - SOURCES QuinticSplineTest.cpp + NAME Spline + SOURCES SplineTest.cpp LINKS BipedalLocomotion::Planners) add_bipedal_test( diff --git a/src/Planners/tests/QuinticSplineTest.cpp b/src/Planners/tests/SplineTest.cpp similarity index 100% rename from src/Planners/tests/QuinticSplineTest.cpp rename to src/Planners/tests/SplineTest.cpp From 03e47295b2c3951a5310c60d536529248be6b3d2 Mon Sep 17 00:00:00 2001 From: Giulio Romualdi Date: Mon, 21 Jun 2021 21:27:16 +0200 Subject: [PATCH 5/8] Add the possibility to choose the interpolation method in SwingFootPlanner class --- .../Planners/SwingFootPlanner.h | 27 ++++--- src/Planners/src/SwingFootPlanner.cpp | 79 +++++++++++++------ 2 files changed, 70 insertions(+), 36 deletions(-) diff --git a/src/Planners/include/BipedalLocomotion/Planners/SwingFootPlanner.h b/src/Planners/include/BipedalLocomotion/Planners/SwingFootPlanner.h index 3813350d74..e4760648c5 100644 --- a/src/Planners/include/BipedalLocomotion/Planners/SwingFootPlanner.h +++ b/src/Planners/include/BipedalLocomotion/Planners/SwingFootPlanner.h @@ -14,7 +14,7 @@ #include #include -#include +#include #include #include @@ -51,8 +51,10 @@ class SwingFootPlanner : public System::Source use) */ SO3PlannerInertial m_SO3Planner; /**< Trajectory planner in SO(3) */ - QuinticSpline m_planarPlanner; /**< Trajectory planner for the x y coordinates of the foot */ - QuinticSpline m_heightPlanner; /**< Trajectory planner for the z coordinate of the foot */ + std::unique_ptr m_planarPlanner; /**< Trajectory planner for the x y coordinates of the + foot */ + std::unique_ptr m_heightPlanner; /**< Trajectory planner for the z coordinate of the + foot */ double m_stepHeight{0.0}; /**< Height of the swing foot. Note that this value could not be the maximum height of the foot. If m_footApexTime is set to 0.5 the @@ -70,15 +72,16 @@ class SwingFootPlanner : public System::Source * Initialize the planner. * @param handler pointer to the parameter handler. * @note the following parameters are required by the class - * | Parameter Name | Type | Description | Mandatory | - * |:----------------------------:|:--------:|:--------------------------------------------------------------------------------------------------------------------:|:---------:| - * | `sampling_time` | `double` | Sampling time of the planner in seconds | Yes | - * | `step_height` | `double` | Height of the swing foot. It is not the maximum height of the foot. If apex time is 0.5 `step_height` is the maximum | Yes | - * | `foot_apex_time` | `double` | Number between 0 and 1 representing the foot apex instant. If 0 the apex happens at take off if 1 at touch down | Yes | - * | `foot_landing_velocity` | `double` | Landing vertical velocity (default value 0.0) | No | - * | `foot_landing_acceleration` | `double` | Landing vertical acceleration (default value 0.0) | No | - * | `foot_take_off_velocity` | `double` | Take-off vertical velocity (default value 0.0) | No | - * | `foot_take_off_acceleration` | `double` | Take-off vertical acceleration (default value 0.0) | No | + * | Parameter Name | Type | Description | Mandatory | + * |:----------------------------:|:--------:|:--------------------------------------------------------------------------------------------------------------------------------------------------------------:|:---------:| + * | `sampling_time` | `double` | Sampling time of the planner in seconds | Yes | + * | `step_height` | `double` | Height of the swing foot. It is not the maximum height of the foot. If apex time is 0.5 `step_height` is the maximum | Yes | + * | `foot_apex_time` | `double` | Number between 0 and 1 representing the foot apex instant. If 0 the apex happens at take off if 1 at touch down | Yes | + * | `foot_landing_velocity` | `double` | Landing vertical velocity (default value 0.0) | No | + * | `foot_landing_acceleration` | `double` | Landing vertical acceleration (default value 0.0) | No | + * | `foot_take_off_velocity` | `double` | Take-off vertical velocity (default value 0.0) | No | + * | `foot_take_off_acceleration` | `double` | Take-off vertical acceleration (default value 0.0) | No | + * | `interpolation_method` | `string` | Define the interpolation method for the trajectory of the position. Accepted parameters: `min_acceleration`, `min_jerk` (default value `min_acceleration`) | No | * @return True in case of success/false otherwise. */ bool initialize(std::weak_ptr handler) final; diff --git a/src/Planners/src/SwingFootPlanner.cpp b/src/Planners/src/SwingFootPlanner.cpp index da4779788f..5a1b08c4e0 100644 --- a/src/Planners/src/SwingFootPlanner.cpp +++ b/src/Planners/src/SwingFootPlanner.cpp @@ -6,6 +6,8 @@ */ #include +#include +#include #include #include @@ -81,13 +83,42 @@ bool SwingFootPlanner::initialize(std::weak_ptrgetParameter("interpolation_method", interpolationMethod)) + { + if (interpolationMethod == "min_acceleration") + { + m_planarPlanner = std::make_unique(); + m_heightPlanner = std::make_unique(); + } else if (interpolationMethod == "min_jerk") + { + m_planarPlanner = std::make_unique(); + m_heightPlanner = std::make_unique(); + } else + { + log()->warn("{} The parameter named 'interpolation_method' must be equal to " + "'min_acceleration' or 'min_jerk'. The 'min_acceleration' method will be " + "used.", + logPrefix); + m_planarPlanner = std::make_unique(); + m_heightPlanner = std::make_unique(); + } + } else + { + log()->info("{} The parameter named 'interpolation_method' not found. The " + "'min_acceleration' method will be used.", + logPrefix); + m_planarPlanner = std::make_unique(); + m_heightPlanner = std::make_unique(); + } + + m_planarPlanner->setInitialConditions(Eigen::Vector2d::Zero(), Eigen::Vector2d::Zero()); + m_planarPlanner->setFinalConditions(Eigen::Vector2d::Zero(), Eigen::Vector2d::Zero()); - m_heightPlanner.setInitialConditions(Vector1d::Constant(footTakeOffVelocity), - Vector1d::Constant(footTakeOffAcceleration)); - m_heightPlanner.setFinalConditions(Vector1d::Constant(footLandingVelocity), - Vector1d::Constant(footLandingAcceleration)); + m_heightPlanner->setInitialConditions(Vector1d::Constant(footTakeOffVelocity), + Vector1d::Constant(footTakeOffAcceleration)); + m_heightPlanner->setFinalConditions(Vector1d::Constant(footLandingVelocity), + Vector1d::Constant(footLandingAcceleration)); return true; } @@ -146,10 +177,10 @@ bool SwingFootPlanner::updateSE3Traj() } manif::SE3d::Translation position; - if (!m_planarPlanner.evaluatePoint(m_currentTrajectoryTime, - position.head<2>(), - m_state.mixedVelocity.coeffs().head<2>(), - m_state.mixedAcceleration.coeffs().head<2>())) + if (!m_planarPlanner->evaluatePoint(m_currentTrajectoryTime, + position.head<2>(), + m_state.mixedVelocity.coeffs().head<2>(), + m_state.mixedAcceleration.coeffs().head<2>())) { log()->error("{} Unable to get the planar trajectory at time t = {}.", logPrefix, @@ -157,10 +188,10 @@ bool SwingFootPlanner::updateSE3Traj() return false; } - if (!m_heightPlanner.evaluatePoint(m_currentTrajectoryTime, - position.segment<1>(2), - m_state.mixedVelocity.coeffs().segment<1>(2), - m_state.mixedAcceleration.coeffs().segment<1>(2))) + if (!m_heightPlanner->evaluatePoint(m_currentTrajectoryTime, + position.segment<1>(2), + m_state.mixedVelocity.coeffs().segment<1>(2), + m_state.mixedAcceleration.coeffs().segment<1>(2))) { log()->error("{} Unable to the height trajectory at time t = {}.", logPrefix, @@ -223,10 +254,10 @@ bool SwingFootPlanner::advance() return false; } - if (!m_planarPlanner.setKnots({m_currentContactPtr->pose.translation().head<2>(), - nextContactPtr->pose.translation().head<2>()}, - {m_currentContactPtr->deactivationTime, - nextContactPtr->activationTime})) + if (!m_planarPlanner->setKnots({m_currentContactPtr->pose.translation().head<2>(), + nextContactPtr->pose.translation().head<2>()}, + {m_currentContactPtr->deactivationTime, + nextContactPtr->activationTime})) { log()->error("{} Unable to set the knots for the planar planner.", logPrefix); return false; @@ -240,12 +271,12 @@ bool SwingFootPlanner::advance() const double footHeightViaPointTime = m_footApexTime * T // + m_currentContactPtr->deactivationTime; - if (!m_heightPlanner.setKnots({m_currentContactPtr->pose.translation().tail<1>(), - Vector1d::Constant(footHeightViaPointPos), - nextContactPtr->pose.translation().tail<1>()}, - {m_currentContactPtr->deactivationTime, - footHeightViaPointTime, - nextContactPtr->activationTime})) + if (!m_heightPlanner->setKnots({m_currentContactPtr->pose.translation().tail<1>(), + Vector1d::Constant(footHeightViaPointPos), + nextContactPtr->pose.translation().tail<1>()}, + {m_currentContactPtr->deactivationTime, + footHeightViaPointTime, + nextContactPtr->activationTime})) { log()->error("{} Unable to set the knots for the knots for the height planner.", logPrefix); From 53b4042eeb7c47f86bdf4bf5bb68741cbc178ac7 Mon Sep 17 00:00:00 2001 From: Giulio Romualdi Date: Mon, 21 Jun 2021 21:49:07 +0200 Subject: [PATCH 6/8] Improve the documentation of CubicSpline --- .../include/BipedalLocomotion/Planners/CubicSpline.h | 6 ++++-- 1 file changed, 4 insertions(+), 2 deletions(-) diff --git a/src/Planners/include/BipedalLocomotion/Planners/CubicSpline.h b/src/Planners/include/BipedalLocomotion/Planners/CubicSpline.h index 366aee0275..ece5ef7234 100644 --- a/src/Planners/include/BipedalLocomotion/Planners/CubicSpline.h +++ b/src/Planners/include/BipedalLocomotion/Planners/CubicSpline.h @@ -1,7 +1,7 @@ /** * @file CubicSpline.h * @authors Giulio Romualdi - * @copyright 2020 Istituto Italiano di Tecnologia (IIT). This software may be modified and + * @copyright 2021 Istituto Italiano di Tecnologia (IIT). This software may be modified and * distributed under the terms of the GNU Lesser General Public License v2.1 or any later version. */ @@ -20,7 +20,7 @@ namespace BipedalLocomotion namespace Planners { /** - * Cubic spline implement a 5-th order polynomial spline in \$f\mathbb{R}^n\$f. + * Cubic spline implement a 3-rd order polynomial spline in \$f\mathbb{R}^n\$f. */ class CubicSpline : public Spline { @@ -63,6 +63,7 @@ class CubicSpline : public Spline * Set the initial condition of the spline * @param velocity initial velocity (i.e. first derivative). * @param acceleration initial acceleration (i.e. second derivative). + * @note the acceleration is not considered in the spline evaluation * @return True in case of success, false otherwise. */ bool setInitialConditions(Eigen::Ref velocity, @@ -72,6 +73,7 @@ class CubicSpline : public Spline * Set the final condition of the spline * @param velocity final velocity (i.e. first derivative). * @param acceleration final acceleration (i.e. second derivative). + * @note the acceleration is not considered in the spline evaluation * @return True in case of success, false otherwise. */ bool setFinalConditions(Eigen::Ref velocity, From 147e21aecaa6d74ab7b7ce4f5cd603973e783c9a Mon Sep 17 00:00:00 2001 From: Giulio Romualdi Date: Mon, 21 Jun 2021 21:50:18 +0200 Subject: [PATCH 7/8] Update CHANGELOG.md --- CHANGELOG.md | 2 ++ 1 file changed, 2 insertions(+) diff --git a/CHANGELOG.md b/CHANGELOG.md index d1b8264073..b7cf3979c0 100644 --- a/CHANGELOG.md +++ b/CHANGELOG.md @@ -3,6 +3,8 @@ All notable changes to this project are documented in this file. ## [Unreleased] ### Added +- Implement `CubicSpline` class (https://github.com/dic-iit/bipedal-locomotion-framework/pull/344) + ### Changed ### Fix From b6cc6ef1442175e9e3bc2e65d3995c77aa8be4c9 Mon Sep 17 00:00:00 2001 From: Giulio Romualdi Date: Tue, 22 Jun 2021 15:25:58 +0200 Subject: [PATCH 8/8] Fix typo in CubicSpline.cpp --- src/Planners/src/CubicSpline.cpp | 6 +++--- 1 file changed, 3 insertions(+), 3 deletions(-) diff --git a/src/Planners/src/CubicSpline.cpp b/src/Planners/src/CubicSpline.cpp index 94977c6417..cbcee3d972 100644 --- a/src/Planners/src/CubicSpline.cpp +++ b/src/Planners/src/CubicSpline.cpp @@ -1,7 +1,7 @@ /** * @file CubicSpline.cpp * @authors Giulio Romualdi - * @copyright 2020 Istituto Italiano di Tecnologia (IIT). This software may be modified and + * @copyright 2021 Istituto Italiano di Tecnologia (IIT). This software may be modified and * distributed under the terms of the GNU Lesser General Public License v2.1 or any later version. */ @@ -39,8 +39,8 @@ struct CubicSpline::Impl }; /** - * Description of a 5-th polynomial. It contains the coefficients, the initial/final knots and - * the duration of the sub-trajectory. + * Description of a 3-rd order polynomial. It contains the coefficients, the initial/final knots + * and the duration of the sub-trajectory. */ struct Polynomial {