Namespaces | |
| id | |
Typedefs | |
| typedef Eigen::VectorXd | VectorXd |
Enumerations | |
| enum | BipedIDs |
| enum | Dim2D |
| enum | Dim3D |
| enum | Dim6D |
| enum | Dx |
| enum | QuadrupedIDs |
| enum | YCursorRows { HEADING =6, OPTIMIZE =8, VISUALIZE, INITIALIZATION, PLOT, REPLAY_SPEED, GOAL_POS, GOAL_ORI, ROBOT, GAIT, OPTIMIZE_GAIT, TERRAIN, DURATION, CLOSE, END } |
Functions | |
| static Eigen::Matrix3d | BuildInertiaTensor (double Ixx, double Iyy, double Izz, double Ixy, double Ixz, double Iyz) |
| std::vector< NodesVariablesPhaseBased::PolyInfo > | BuildPolyInfos (int phase_count, bool first_phase_constant, int n_polys_in_changing_phase) |
| SingleRigidBodyDynamics::Jac | Cross (const Eigen::Vector3d &in) |
| TEST (DynamicModelTest, GetBaseAcceleration) | |
| TEST (DynamicConstraintTest, UpdateConstraintValues) | |
| TEST (DynamicModelTest, TestRotations) | |
| TEST (DynamicModelTest, GetJacobianOfAccWrtBase) | |
| static Dim2D | To2D (Dim3D dim) |
| static xpp::StateLinXd | ToXpp (const towr::State &towr) |
| static std::pair< xpp::EndeffectorID, std::string > | ToXppEndeffector (int number_of_ee, int towr_ee_id) |
| void | UserCommandCallback (const towr_ros::TowrCommand &msg_in) |
Variables | |
| static const Dim6D | AllDim6D [] |
| AX | |
| AY | |
| AZ | |
| static std::map< towr::BipedIDs, std::string > | biped_to_name |
| static std::map< towr::BipedIDs, xpp::biped::FootIDs > | biped_to_xpp_id |
| static constexpr int | k2D |
| static constexpr int | k3D |
| static constexpr int | k6D |
| kAcc | |
| kJerk | |
| kPos | |
| kVel | |
| L | |
| LF | |
| LH | |
| LX | |
| LY | |
| LZ | |
| static std::map< towr::QuadrupedIDs, std::string > | quad_to_name |
| static std::map< towr::QuadrupedIDs, xpp::quad::FootIDs > | quad_to_xpp_id |
| R | |
| RF | |
| RH | |
| static const std::map< RobotModel::Robot, std::string > | robot_names |
| static ros::Publisher | rviz_pub |
| static ros::Publisher | rviz_pub |
| static const std::map< HeightMap::TerrainID, std::string > | terrain_names |
| X | |
| X_ | |
| static constexpr int | X_DESCRIPTION = 10 |
| static constexpr int | X_KEY = 1 |
| static constexpr int | X_VALUE = 35 |
| Y | |
| Y_ | |
| static constexpr int | Y_STATUS = END+1 |
| Z | |
| enum towr::YCursorRows |
| Enumerator | |
|---|---|
| HEADING | |
| OPTIMIZE | |
| VISUALIZE | |
| INITIALIZATION | |
| PLOT | |
| REPLAY_SPEED | |
| GOAL_POS | |
| GOAL_ORI | |
| ROBOT | |
| GAIT | |
| OPTIMIZE_GAIT | |
| TERRAIN | |
| DURATION | |
| CLOSE | |
| END | |
Definition at line 46 of file towr_user_interface.cc.
|
static |
Converts class "State" between two domains (have same internal representation).
Definition at line 118 of file towr_xpp_ee_map.h.
|
static |
Converts endeffector IDs of towr into the corresponding number used in xpp.
| number_of_ee | Number of endeffectors of current robot model. |
| towr_ee_id | Integer used to represent the endeffector inside towr. |
Definition at line 86 of file towr_xpp_ee_map.h.
| void towr::UserCommandCallback | ( | const towr_ros::TowrCommand & | msg_in | ) |
Definition at line 44 of file goal_pose_publisher.cc.
|
static |
|
static |
Mapping endeffector IDs
Definition at line 46 of file towr_xpp_ee_map.h.
|
static |
|
static |
Definition at line 52 of file towr_xpp_ee_map.h.
|
static |
Definition at line 42 of file rviz_terrain_publisher.cc.
|
static |
Definition at line 42 of file goal_pose_publisher.cc.
|
static |
Definition at line 51 of file towr_user_interface.cc.
|
static |
Definition at line 50 of file towr_user_interface.cc.
|
static |
Definition at line 52 of file towr_user_interface.cc.
|
static |
Definition at line 49 of file towr_user_interface.cc.