Skip to content

Latest commit

 

History

History
476 lines (427 loc) · 49 KB

CHANGELOG.md

File metadata and controls

476 lines (427 loc) · 49 KB

Changelog

All notable changes to this project are documented in this file.

  • Added the DistanceTask and GravityTask to the IK (ami-iit#717)
  • Add the possibility to control a subset of linear coordinates in TSID::SE3Task (ami-iit#738)

Added

  • Add the possibility to control a subset of coordinates in TSID::CoMTask (ami-iit#724, ami-iit#727)
  • Add the possibility to set the maximum number of accepted deadline miss in System::AdvanceableRunner (ami-iit#726)

Changed

  • Remove the possibility to disable the telemetry in System::AdvanceableRunner (ami-iit#726)

0.15.0 - 2023-09-05

Added

  • 🤖 Add the configuration files to use YarpRobotLogger with ergoCubGazeboV1 (ami-iit#690)
  • Implement RK4 integrator in ContinuousDynamicalSystem component and expose the python bindings (ami-iit#711)
  • Implement blf-balancing-torque-control in utilities (ami-iit#707)
  • Implement setControlMode in IRobotControl and the associated python bindings (ami-iit#707)
  • Expose ContactBase methods for DiscreteGeometryContact bindings (ami-iit#712)
  • Expose the CoM trajectory and angular momentum trajectory in MANNTrajectoryGenerator bindings (ami-iit#712)
  • Expose the CoM trajectory computed by the CentroidalMPC (ami-iit#712)
  • Implement python bindings for CameraBridge (ami-iit#695)
  • Implement constructRDGBSensorClient() in RobotInterface component (ami-iit#695)

Changed

  • Use std::chorno::nanoseconds in clock and AdvanceableRunner (ami-iit#702)
  • Give the possibility to set an external wrench in the CentroidalDynamics instead of a pure force (ami-iit#705)
  • Use c version of qhull in the Planner component. This fixes the compatibility with PCL in ubuntu 20.04 (ami-iit#713)
  • Make ICameraBridge::isValid() virtual function (ami-iit#695)
  • icub-models 2.0.0 changed the name of the FT sensors in the iCub's URDF from being named <identifier>_ft_sensor (like l_arm_ft_sensor, l_leg_ft_sensor, ...) to <identifier>_ft (like l_arm_ft, l_leg_ft, ...). However, the yarprobotinterface configuration files in blf continued to refer to the sensors as <identifier>_ft_sensor, creating errors for software that was trying to match sensors find in URDF and sensors as exposed by the YARP's multipleanalogsensorsserver device. This PR changes all the instances of FT sensor names in iCub-related configuration files contained in blf to <identifier>_ft, restoring compatibility with icub-models 2.0.0, robots-configuration releases >= 2.5.0 and ergocub-software >= 0.3.4, see robotology/robots-configuration#562 for more details (ami-iit#720)

Fixed

  • Remove duplicated find_package in BipedalLocomotionFrameworkDependencies.cmake file (ami-iit#709)
  • Fix handling of feedforward acceleration in BipedalLocomotion::TSID::JointTrackingTask::setSetPoint (ami-iit#719)

0.14.1 - 2023-07-07

Fixed

  • Fix python bindings compilation when toml is not installed (ami-iit#700)
  • Fix YarpRobotLoggerDevice if YARP_ROBOT_NAME is not defined (ami-iit#701)

0.14.0 - 2023-07-04

Added

  • Implement a class to perform inference with the MANN network (ami-iit#652, ami-iit#686)
  • Add some useful methods to the SubModel and SubModelKinDynWrapper classes (ami-iit#661)
  • Implement Dynamics, ZeroVelocityDynamics, and JointVelocityStateDynamics classes in RobotDynamicsEstimator (ami-iit#662)
  • Implement AccelerometerMeasurementDynamics and GyroscopeMeasurementDynamics classes in RobotDynamicsEstimator (ami-iit#666)
  • Implement FrictionTorqueStateDynamics and MotorCurrentMeasurementDynamics classes in RobotDynamicsEstimator (ami-iit#667)
  • Add logging of FTs on the ergoCub legs and fix FT and IMU port names (ami-iit#671)
  • Add the possibility to log the video stream as set of frames or as video in YarpRobotLoggerDevice (ami-iit#672)
  • Add the possibility to log the RGBD stream in YarpRobotLoggerDevice (ami-iit#672)
  • Implement LieGroupDynamics in ContinuousDynamicalSystem component (ami-iit#659)
  • Implement Conversions::toiDynTreePose() (ami-iit#659)
  • Implement Conversions::toiDynTreePose() (ami-iit#659)
  • Implement MANNAutoregressive class in ML component (ami-iit#659)
  • ImplementUkfState class in RobotDynamicsEstimator (ami-iit#669)
  • Implement MANNTrajectoryGenerator class in ML component (ami-iit#668)
  • Implement a bash script to automatically log the audio along with the YarpRobotLoggerDevice (ami-iit#681)
  • Implement QuadraticBezierCurve in Math component (ami-iit#689)
  • Implement MANNAutoregressiveInputBuilder in ML component (ami-iit#689)
  • Implement the CentroidalMPC in ReducedModelControllerscomponent (ami-iit#645)
  • Implement the BaseEstimatorFromFootIMU in the Estimators component (ami-iit#641)
  • Add bindings for CentroidalMPC, CentroidalDynamics, ContactPhaseList, DiscreteGeometryContact and Corner component (ami-iit#650)

Changed

  • Restructure application folders of YarpRobotLoggerDevice (ami-iit#670)
  • 🤖 [ergoCubSN000] Clean the mas remapper files of the YarpRobotLoggerDevice (ami-iit#673)
  • 🤖 [ergoCubSN000] Enable the logging of the realsense camera YarpRobotLoggerDevice (ami-iit#672)
  • Add the possibility to force the internal state of the SchmittTrigger (ami-iit#684)
  • Add the possibility to update the contact list in the swing foot planner when the contact is not active and the new orientation is different from the previous one (ami-iit#688)
  • Add the possibility to set the boundary condition for the velocity and acceleration of the SO3Planner (ami-iit#688)
  • Satisfies the rule of 5 for InputPort, OutputPort, Advanceable, Sink and Source in System component (ami-iit#397).

Fixed

  • Fix RobotDynamicsEstimator compilation dependencies (ami-iit#665)
  • Fix the metadata assignment of the rgbd cameras (ami-iit#672)
  • Fix the RGB to BGR conversion in YarpCameraBridge for FlexImage (ami-iit#672)
  • Make the YarpSensorBridge compatible with MAS that use the same name between gyro ac magn and orientation (ami-iit#692)

0.13.0 - 2023-04-22

Added

  • Implement the DiscreteGeometryContact in Contacts component (ami-iit#626)
  • Implement the SchmittTrigger in component Math and the associated python bindings (ami-iit#624)
  • Add the support of std::chrono in The text logging (ami-iit#630)
  • Add the possibility to retrieve and set duration from the IParametersHandler (ami-iit#630)
  • Add the possibility to update the contact list in the swing foot trajectory planner (ami-iit#637)
  • Implement System::NamedTuple class (ami-iit#642)
  • Implement ContinuousDynamicalSystem::CentroidalDynamics class (ami-iit#642)

Changed

  • Update the IK tutorial to use QPInverseKinematics::build (ami-iit#621)
  • Handle case where no FT sensors are specified to split the model (ami-iit#625)
  • General restructure of the ContactDetectorand the derived classes (SchmittTriggerDetector and FixedFootDetector) (ami-iit#624) Thanks to this refactory the FixedFootDetector usage becomes similar to the others advanceable. Indeed now FixedFootDetector::advace() considers the input set by the user and provides the corresponding output. ⚠️ Even if this modification do not break the API the user may notice some strange behavior if advance was called after getting the output of the detector.
  • Restructure the Contacts component to handle time with std::chrono::nanoseconds (ami-iit#630)
  • Restructure the Planners component to handle time with std::chrono::nanoseconds (ami-iit#630)
  • Restructure the FloatingBaseEstimator component to handle time with std::chrono::nanoseconds(ami-iit#630)
  • Update the blf-position-tracking to handle time with std::chrono::nanoseconds (ami-iit#630)
  • Update the python bindings to consider the time with std::chrono::nanoseconds (ami-iit#630)
  • Robustify SubModelCreator and SubModelKinDynWrapper tests (ami-iit#631)
  • SwingFootTrajectoryPlanner::advance() must be called before getting the output (ami-iit#637)
  • Update the already existing classes in ContinuousDynamicalSystemto be compatible with the System::NamedTuple (ami-iit#642)
  • Update the code to be compatible with LieGroupControllers v0.2.0 (ami-iit#653)
  • Allow use of vectors for task gains (ami-iit#654)
  • Catch2 is now downloaded with FetchContent if BUILD_TESTING is set to ON (ami-iit#655)
  • The tests now usesCatch2 v3 (ami-iit#655)
  • Add the possibility to set vectorial gains in CoM IK and TSID tasks (ami-iit#656)

Fixed

  • Return an error if an invalid KinDynComputations object is passed to QPInverseKinematics::build() (ami-iit#622)
  • Fix QPTSID documentation (ami-iit#634)
  • Fix error messages in QPTSID class (ami-iit#639)
  • Fix compilation failure when using CMake 3.26.1 and pybind11 2.4.3 (ami-iit#643)

0.12.0 - 2023-03-07

Added

  • Add the possibility to attach all the multiple analog sensor clients (ami-iit#569)
  • Add a tutorial for the inverse kinematics (ami-iit#596)
  • Implement the ROS2 sink for the TextLogging (ami-iit#587)
  • Implement the QPFixedBaseInverseKinematics in the IK component (ami-iit#599)
  • 🤖 [ergoCubSN000] Add configuration files for the YarpRobotLoggerDevice (ami-iit#600)
  • Add functions to split a model in a set of submodels in the Estimator component (ami-iit#604)
  • Add the possibity to call the advanceable capabilities of the QuinticSpline from the python (ami-iit#609)
  • Implement the CubicSpline python bindings (ami-iit#609)
  • Implement the python bindings for the iDynTree to manif conversions (ami-iit#610)
  • Implement blf-balancing-position-control application (ami-iit#611)
  • Implement the python bindings for YarpTextLogging (ami-iit#611)
  • Add SubModelKinDynWrapper class to handle the KinDynComputation object of a sub-model (ami-iit#605)
  • Implement the JointLimitsTask for the IK (ami-iit#603)
  • Add the possibility to programmatically build an IK problem from a configuration file (ami-iit#614, ami-iit#619)

Changed

  • Ask for toml++ v3.0.1 (ami-iit#581)
  • The YarpRobotLogger will now automatically connect to the exogenous signal port if available (ami-iit#570)
  • 🤖 [iCubGenova09] Add the left and right hands skin (raw and filtered) data acquisition (ami-iit#570)
  • Add informative prints YarpSensorBridge::Impl (ami-iit#569)
  • The minimum version of iDynTree now supported is iDynTree 4.3.0 (ami-iit#588).
  • Allow using the iDynTree swig bindings in QPFixedBaseTSID for the kindyncomputation object (ami-iit#599)
  • Add the possibility to customize the video codec in the YarpRobotLoggerDevice (ami-iit#607)

Fix

  • Return an invalid PolyDriverDescriptor if description is not found in constructMultipleAnalogSensorsRemapper() (ami-iit#569)
  • Fix compatibility with OpenCV 4.7.0 (ami-iit#589)
  • Fix attachRemappedRemoteControlBoard in YarpSensorBridge when the RemoteControlBoard is not the first polydriver in the polydriverlist (ami-iit#608)
  • Fix race condition in System::ClockBuilder (ami-iit#618)

0.11.1 - 2022-12-19

Fix

  • Fix the compilation of the YarpRobotLoggerDevice in Windows and macOS (ami-iit#580)

0.11.0 - 2022-12-17

Added

  • Log the status of the system in YarpRobotLoggerDevice (ami-iit#571)
  • Add the ROS2 implementation for Clock class (ami-iit#575)

Changed

  • YARP devices are now enabled by default if YARP is found (ami-iit#576).
  • Restructure the python bindings to support official iDynTree bindings (ami-iit#578)
  • Remove unofficial iDynTree bindings based on pybind11 (ami-iit#578)

Fix

0.10.0 - 2022-09-23

Added

  • Add the possibility to set the exogenous feedback for the IK::SE3Task (ami-iit#567)
  • Implement RobotInterface::constructMultipleAnalogSensorsClient() and RobotInterface::constructMultipleAnalogsensorsRemapper() methods (ami-iit#568)

Changed

  • Add the possibility to log only a subset of text logging ports in YarpRobotLogger device (ami-iit#561)
  • Accept boolean as integer while getting an element from searchable in YarpUtilities (ami-iit#566)

Fix

  • Fix typo in the RobotInterface::constructGenericSensorClient() documentation (ami-iit#568)
  • Fix compatibility with qhull installed by vcpkg 2022.07.25 and robotology-superbuild-dependencies-vcpkg 0.10.1 (ami-iit#565).

0.9.0 - 2022-09-09

Added

  • Implement the MultiStateWeightProvider in ContinuousDynamicalSystem (ami-iit#555)
  • Implement PortInput and PortOutputin System (ami-iit#555)
  • Implement toManifTwist in Conversions component (ami-iit#557)
  • Add the default value for the desired spatial and angular velocity to the IK::SO3Task and IK::SE3Task (ami-iit#557)
  • Implement the IK::R3Task class (ami-iit#559)

Changed

  • Now Advanceable inherits from PortInput and PortOutput (ami-iit#555)

Fix

  • Fix the dependency required to compile the YarpRobotLogger device (ami-iit#554)
  • Fix the compatibility with fmt v9.0.0 (ami-iit#556)

0.8.0 - 2022-07-29

Added

  • Add the possibility to log the YarpTextLogging in the YarpRobotLogger (ami-iit#541)
  • Enable the logging FTs and IMU logging of iCubGenova09 (ami-iit#546)

Changed

  • Ported YarpLoggerDevice to robometry(ami-iit#533)
  • bipedal locomotion framework now depends on YARP 3.7.0 (ami-iit#541)

Fix

  • Avoid to use deprecated function cv::aruco::drawAxis in ArucoDetector to fix compilation with OpenCV 4.6.0 (ami-iit#552)

0.7.0 - 2022-06-21

Added

  • Implement the python bindings for the clock machinery and for the yarp clock (ami-iit#500)
  • Implement the IWeightProvider interface and the ConstantWeightProvider class in the System component (ami-iit#506)
  • Add installation of pip metadata files for when blf python bindings are installed only via CMake (ami-iit#508)
  • Implement the python bindings for the VectorsCollection message and the associated buffered port (ami-iit#511)
  • Implement the VectorsCollectionWrapper device for collection of arbitrary vector ports (ami-iit#512)
  • Add reading of right upper leg FT for iCubGenova09 and associated cartesian wrench in YarpRobotLoggerDevice configuration files (ami-iit#513)
  • Add reading of right and left arms FT for iCubGenova09 in YarpRobotLoggerDevice configuration files (ami-iit#515)
  • Add reading of right and left arms and right upper leg FTs and cartesian wrenches for iCubGazeboV3 in YarpRobotLoggerDevice (ami-iit#525)
  • Add the possibility to retrieve the temperature sensor from SensorBridge (ami-iit#519)
  • Add the possibility to set only the velocity in CubicSpline::setInitialConditions and CubicSpline::setFinalConditions (ami-iit#528)
  • Implement the python bindings for the ContinuousDynamicalSystem component (ami-iit#532)
  • Add the possibility to log the video in the YarpRobotLoggerDevice (ami-iit#516)

Changed

  • An error it will be returned if the user tries to change the clock type once the clock() has been already called once (ami-iit#500)
  • Log the arms external wrenches on the YarpRobotLogger for iCubGenova09 (ami-iit#502)
  • IK and TSID now uses the weight provider to specify the weight associated to a task (ami-iit#506)
  • The Planners, System, RobotInterface and YarpImplementation components are no more mandatory to compile the python bindings (ami-iit#511)
  • Reorganize the multiple FT sensor and external wrench files into a single file in the YarpRobotLoggerDevice (ami-iit#525)
  • Save the robot name and the names of the channel's elements in the YarpRobotLoggerDevice (ami-iit#522)
  • Use icub-models to get the urdf models for the tests (ami-iit#526)
  • The FT sensor are now considered as multianalogsensor in YarpSensorBridge (ami-iit#519)
  • Make YarpRobotLogger compatible with yarp-telemetry v0.5.1 (ami-iit#535)
  • Set for yarp-telemetry minimum version to v0.5.1 (ami-iit#535)
  • Make YarpCameraBridge::getColorImage() and YarpCameraBridge::getDepthImage() thread safe (ami-iit#516)
  • Deprecate YarpCameraBridge::get() in favor of YarpCameraBridge::getMetaData() (ami-iit#516)
  • Move from LGPL to BSD3 license (ami-iit#550)

Fix

  • Remove outdated includes in YarpRobotLoggerDevice.cpp (ami-iit#502)

0.6.0 - 2022-01-10

Added

  • Add the reading of the orientation of the head IMU in YarpRobotLoggerDevice (ami-iit#471)
  • Add the possibility to change the weight in TSID/IK (ami-iit#475)
  • Implement a FirstOrderSmoother class in ContinuousDynamicalSystem component (ami-iit#476)
  • Implement getIntegrationStep in FixedIntegration class (ami-iit#476)
  • Add the possibility to create custom LinearTasks in python (ami-iit#480)
  • Implement the possibility to compute the residual terms in the LinearTask (ami-iit#483)
  • Define VectorsCollection message in YarpUtilities (ami-iit#483)
  • Add the reading of the joint and motor acceleration in YarpSensorBridge (ami-iit#492)

Changed

  • Use yarp clock instead of system clock in YarpRobotLoggerDevice (ami-iit#473)
  • Reduce code duplication in python bindings (ami-iit#484)
  • Use TextLogger in YarpRobotLoggerDevice instead of yarp commands (ami-iit#486)
  • Ask for osqp-eigen 0.6.4.100(ami-iit#490)
  • Use enum underlying type to convert TextLogging verbosity level to spdlog verbosity level (ami-iit#495)
  • yarp-telemetry is now a dependency of the YarpRobotLoggerDevice (ami-iit#487)
  • Fix deprecated YARP functions in YarpUtilities component (ami-iit#491)

Fix

  • Fix the population of the jointAccelerations and baseAcceleration variables in QPTSID (ami-iit#478)
  • Fix the documentation in the Advanceable class (ami-iit#476)
  • Add virtual destrutors in System::Sink, System::Source, System::LinearTask, System::ITaskControlMode, TSID::TSIDLinearTask and IK::IKLinearTask classes (ami-iit#480)
  • The joint torques is now correctly retrieved in QPTSID class (ami-iit#482)
  • The motor velocity and positions are now returned in rad/s and rad (ami-iit#489)
  • Fix YarpRobotLoggerDevice documentation (ami-iit#472)

0.5.0 - 2021-11-30

Added

  • Implement Python bindings for the TSID component (ami-iit#428)
  • Add the possibility to set the name of each element of a variable stored in the variables handler (ami-iit#429)
  • Develop the python bindings for toml implementation of the parameters handler (ami-iit#432)
  • Implement the VariableRegularizationTask in TSID (ami-iit#431)
  • Implement create_tsid utility function for the python bindings (ami-iit#433)
  • Implement the AngularMomentumTask in the TSID component and the associated python bindings (ami-iit#436)
  • Implement QPTSID::toString method and the associated python bindings (ami-iit#440)
  • Implement ContactWrench python bindings (ami-iit#441)
  • Implement AngularMomentum task in the IK component and the associated bindings (ami-iit#443)
  • Implement create_ik utility function for the python bindings (ami-iit#444)
  • Add the possibility to set the task controller mode for the SE3Task in the TSID component (ami-iit#445)
  • Expose the ITaskControlMode class in the python bindings (ami-iit#445)
  • Add the possibility to enable/disable the joints and motors state logging in the YarpRobotLoggerDevice (ami-iit#453)
  • Implement QPInverseKinematics::toString method and the associated python bindings (ami-iit#461)
  • Add the cartesian wrenches logging in YarpRobotLoggerDevice (ami-iit#447)
  • Implement the python bindings for the manif conversions methods (ami-iit#465)

Changed

  • Inherits all the Eigen::Matrix constructors in the Wrenchd class (ami-iit#441)
  • Bump the minimum cmake version to 3.16.0 (ami-iit#468)

Fix

  • Fix Analog FT Sensor reading in YarpSensorBridgeImpl (ami-iit#459)
  • Fix config files in YarpRobotLoggerDevice for iCub3 head IMU reading (ami-iit#467)

0.4.0 - 2021-10-15

Added

  • Implement AdvanceableRunner::isRunning() method (ami-iit#395)
  • Implement ContactPhaseList::getPresentPhase() method (ami-iit#396)
  • Add a synchronization mechanism for the AdvanceableRunner class (ami-iit#403)
  • Add the possibility to use spdlog with YARP (ami-iit#408)
  • Add new Advanceable exposing UnicyclePlanner (ami-iit#320)

Changed

  • Add name parameter to the AdvanceableRunner class (ami-iit#406)
  • Set the required spdlog version in the cmake file (ami-iit#415)
  • Add features to FTIMULoggerDevice and rename it in YarpRobotLoggerDevice (ami-iit#405)

Fix

  • Fix missing components dependencies in the CMake machinery (ami-iit#414)
  • Fixed missing include in FloatingBaseEstimatorIO.h (ami-iit#417)

0.3.0 - 2021-08-12

Added

  • Implement CubicSpline class (ami-iit#344)
  • Implement PWM control in RobotControl class (ami-iit#346)
  • Implement ContactWrenchCone class in Math component (ami-iit#352)
  • Implement skew function in Math component (ami-iit#352)
  • Implement QPTSID class (ami-iit#366)
  • Implement motor pwm, motor encoders, wbd joint torque estimates, pid reading in YarpSensorBridge(ami-iit#359).
  • Implement FeasibleContactWrenchTask for TSID component (ami-iit#369).
  • Implement python bindings for QPInverseKinematics class (ami-iit#303)
  • Implement ControlTask in for System component (ami-iit#373).
  • Allow changing the log verbosity (ami-iit#385)
  • Implement the CoMZMP controller (ami-iit#387)

Changed

  • Add common Python files to gitignore (ami-iit#338)
  • General improvements of blf-calibration-delta-updater (ami-iit#361)
  • Add the possibility to control a subset of coordinates in IK::SE3Task (ami-iit#356)
  • Add the possibility to control a subset of coordinates in IK::CoMTask (ami-iit#357)
  • Reduce the duplicate code in IK and TSID (ami-iit#364)
  • QPFixedBaseTSID now inherits from QPTSID (ami-iit#366)
  • Enable the Current control in RobotInterface class (ami-iit#375)
  • Add the possibility to disable and enable the PD controllers in IK::SE3Task (ami-iit#373).
  • Add the possibility to use manif objects in the ForwardEuler integrator (ami-iit#379).

Fix

  • Fixed the crashing of YarpSensorBridge while trying to access unconfigured control board sensors data by adding some checks (ami-iit#378)
  • Fixed the compilation of Python bindings (enabled by the FRAMEWORK_COMPILE_PYTHON_BINDINGS CMake option) when compiling with Visual Studio (ami-iit#380).
  • Fixed the TOML and YARP implementation of the parameters handler when a std::vector<bool> is passed to the setParameter() method (ami-iit#390).

0.2.0 - 2021-06-15

Added

  • Implement IRobotControl python bindings (ami-iit#200)
  • Implement ISensorBridge python bindings (ami-iit#203)
  • Implement LeggedOdometry class as a part of FloatingBaseEstimators library and handle arbitrary contacts in FloatingBaseEstimator. (ami-iit#151)
  • Implement the possibility to set a desired reference trajectory in the TimeVaryingDCMPlanner. (ami-iit#208)
  • Implement SchmittTriggerDetector python bindings (ami-iit#213)
  • Implement ModelComputationsHelper for quick construction of KinDynComputations object using parameters handler (ami-iit#216)
  • Implement FloatingBaseEstimator and LeggedOdometry python bindings (ami-iit#218)
  • Add spdlog as mandatory dependency of the project (ami-iit#225)
  • Implement ICameraBridge and IPointCloudBridge interface classes as a part of PerceptionInterface library. (ami-iit#165)
  • Implement RealSense driver class as a part of PerceptionCapture library. (ami-iit#165)
  • Implement realsense-test utility application. (ami-iit#165)
  • Implement the inverse kinematics component (ami-iit#229)
  • Implement LinearizedFrictionCone class (ami-iit#244)
  • Added a check on whether the installed public headers have the correct folder structure (ami-iit#247)
  • Implement python bindings for VariablesHandler class (ami-iit#234)
  • Implement PerceptionFeatures library and implement ArucoDetector. (ami-iit#159)
  • Implement FixedBaseDynamics class (ami-iit#242)
  • Implemented Sink and Source classes (ami-iit#267)
  • Implement the IClock, StdClock and YarpClock classes (ami-iit#269)
  • Implement YarpCameraBridge class for Yarp implementation of ICameraBridge (ami-iit#237)
  • Implement PointCloudProcessor class and modify realsense-test to test point clouds handling with Realsense. (ami-iit#236)
  • Implement AdvanceableRunner and SharedResource classes in System component (ami-iit#272)
  • Implement handleQuitSignals() function in System component (ami-iit#277)
  • Implement TaskSpaceInverseDynamics interface (ami-iit#279)
  • Implement Wrench class (ami-iit#279)
  • Implement SO3Task in TSID component (ami-iit#281)
  • Implement clone method in ParametersHandler classes (ami-iit#288)
  • Implement VariablesHandler::clear() and VariablesHandler::initialize() (ami-iit#291)
  • Implement the possibility to set the default contact in the ContactList class (ami-iit#297)
  • Implement FixedFootDetector class (ami-iit#284)
  • Implement QPFixedBaseTSID class (ami-iit#251)
  • Implement YarpImplementation::setFromFile() (ami-iit#307)
  • Implement CoMTask in TSID (ami-iit#304)
  • Implement YarpParametersHandler bindings (ami-iit#309)
  • Implement contactListMapFromJson() and contactListMapToJson() methods and python bindings (ami-iit#316)
  • Implement a matioCpp-based strain2 sensors' FT-IMU logger example device (ami-iit#326)
  • Implement TomlImplementation in ParametersHandler (ami-iit#328)
  • Implement blf_calibration_delta_updater.py application (ami-iit#332)

Changed

  • Move all the Contacts related classes in Contacts component (ami-iit#204)
  • Move all the ContactDetectors related classes in Contacts component (ami-iit#209)
  • The DCMPlanner and TimeVaryingDCMPlanner initialize functions take as input an std::weak_ptr. (ami-iit#208)
  • Use Math::StandardAccelerationOfGravitation instead of hardcoding 9.81. (ami-iit#211)
  • Convert iDynTree types in FloatingBaseEstimators component to Eigen/manif types (ami-iit#215)
  • Use std::optional instead of raw pointer in ISensorBridge. (ami-iit#226)
  • Use System::LinearTask in TSID component (ami-iit#240)
  • Restructure python bindings in submodules (ami-iit#238)
  • Integrators and DynamicalSystems are now in the ContinuousDynamicalSystem component (ami-iit#242)
  • Add Input template class to System::Advanceable (ami-iit#267)
  • Add support for landmarks and kinematics-free estimation in FloatingBaseEstimators. (ami-iit#254)
  • If FRAMEWORK_DETECT_ACTIVE_PYTHON_SITEPACKAGES is OFF, for Python bindings use installation directory provided by sysconfig Python module. (ami-iit#274)
  • Reduce memory allocation in YarpSensorBridge (ami-iit#278)
  • Use TextLogging in VariablesHandler class (ami-iit#291)
  • Fix YarpImplementation::setParameterPrivate() when a boolean or a vector of boolean is passed (ami-iit#311)
  • Add foot_take_off_acceleration and foot_take_off_velocity parameters in the SwingFootPlanner class (ami-iit#323)
  • Change the parameters handler verbosity (ami-iit#330)
  • Restore backward compatibility of SwingFootPlanner parameters (ami-iit#334)
  • Bump manif version to 0.0.4 (ami-iit#339)

Fixed

  • Fix missing implementation of YarpSensorBridge::getFailedSensorReads(). (ami-iit#202)
  • Fixed mas-imu-test configuration files after FW fix.
  • Fixed the implementation ``YarpSensorBridge::attachAllSixAxisForceTorqueSensors()`. (ami-iit#231)
  • Avoid the "Generating the Urdf Model from" message to appear when doing ccmake. (ami-iit#243)
  • Fixed the installation path of public headers related to perception libraries. (ami-iit#245)
  • Fixed InstallBasicPackageFiles to avoid the same problem of ami-iit/matio-cpp#41 (ami-iit#253)
  • Call positionInterface->setRefSpeeds() only once when a position reference is set in YarpRobotControl (ami-iit#271)
  • Fix initialization of reference frame for world in LeggedOdometry class. (ami-iit#289)
  • LeggedOdometry::Impl::updateInternalContactStates() is now called even if the legged odometry is not initialize. This was required to have a meaningful base estimation the first time LeggedOdometry::changeFixedFrame() is called. (ami-iit#292)
  • Avoid to use the default copy-constructor and copy-assignment operator in ContactPhaseList class (ami-iit#295)
  • Fix toString() method of VariablesHandler class (ami-iit#302)
  • Fix in YarpUtilities::getVectorFromSearchable when a vector of boolean is passed as input (ami-iit#313)
  • Various fixes for the yarp devices (ami-iit#337)

0.1.1 - 2021-05-08

Fix

  • Fix the documentation in TemplateHelpers.h

0.1.0 - 2021-02-22

Added