1#ifndef ROBOTOC_BIPED_WALK_FOOT_STEP_PLANNER_HPP_
2#define ROBOTOC_BIPED_WALK_FOOT_STEP_PLANNER_HPP_
8#include "Eigen/Geometry"
70 void setGaitPattern(const Eigen::Vector3d& step_length, const
double step_yaw,
71 const
bool enable_double_support_phase);
82 const
double yaw_rate_cmd, const
double swing_time,
83 const
double double_support_time, const
double gain);
85 void init(const Eigen::VectorXd& q) override;
87 bool plan(const
double t, const Eigen::VectorXd& q, const Eigen::VectorXd& v,
89 const
int planning_steps) override;
103 const Eigen::Vector3d&
CoM(const
int step) const override;
105 const Eigen::Matrix3d&
R(const
int step) const override;
107 int size()
const override {
return planning_size_; }
113 const std::shared_ptr<BipedWalkFootStepPlanner>& planner);
115 EIGEN_MAKE_ALIGNED_OPERATOR_NEW
121 bool enable_raibert_heuristic_;
122 int L_foot_id_, R_foot_id_, current_step_, planning_size_;
123 double left_to_right_leg_distance_, foot_height_to_com_height_;
125 std::vector<std::vector<Eigen::Vector3d>> contact_position_ref_;
126 std::vector<std::vector<Eigen::Matrix3d>> contact_surface_ref_;
127 std::vector<Eigen::Vector3d> com_ref_;
128 std::vector<Eigen::Matrix3d> R_;
129 Eigen::Vector3d vcom_, vcom_cmd_, step_length_;
130 Eigen::Matrix3d R_yaw_, R_current_;
131 double yaw_rate_cmd_;
132 bool enable_double_support_phase_;
Moving window filter for foot step planning.
Definition: moving_window_filter.hpp:17
Raibert heuristic for foot step planning.
Definition: raibert_heuristic.hpp:23
Dynamics and kinematics model of robots. Wraps pinocchio::Model and pinocchio::Data....
Definition: robot.hpp:32
Definition: constraint_component_base.hpp:17
std::vector< T, Eigen::aligned_allocator< T > > aligned_vector
std vector with Eigen::aligned_allocator.
Definition: aligned_vector.hpp:14
pinocchio::SE3 SE3
Using pinocchio::SE3 without its namespace.
Definition: se3.hpp:15