Namespaces | |
| biped | |
| quad | |
Classes | |
| class | CartesianJointConverter |
| Converts a Cartesian robot representation to joint angles. More... | |
| struct | ColorT |
| Supplies some predefined colors to be used for RVIZ markers. More... | |
| struct | Convert |
| class | Endeffectors |
| class | EndeffectorsContact |
| class | EndeffectorsMotion |
| class | InverseKinematics |
| Converts Cartesian endeffector positions into joint angles. More... | |
| class | Joints |
| class | RobotStateCartesian |
| class | RobotStateJoint |
| class | RvizRobotBuilder |
| Constructs RVIZ markers that visualize a Cartesian robot state. More... | |
| class | State3d |
| class | State3dEuler |
| class | StateAng3d |
| class | StateLin1d |
| class | StateLin2d |
| class | StateLin3d |
| class | StateLinXd |
| class | UrdfVisualizer |
| Publishes RVIZ transforms used to visualize a robot's URDF. More... | |
Typedefs | |
| typedef uint | EndeffectorID |
| typedef Endeffectors< Eigen::Vector3d > | EndeffectorsAcc |
| typedef Endeffectors< Eigen::Vector3d > | EndeffectorsPos |
| typedef Endeffectors< Eigen::Vector3d > | EndeffectorsVel |
| typedef Eigen::Quaterniond | Quaterniond |
| typedef Eigen::Vector2d | Vector2d |
| typedef Eigen::Vector3d | Vector3d |
| typedef Eigen::Matrix< double, 6, 1 > | Vector6d |
| typedef Eigen::VectorXd | VectorXd |
Enumerations | |
| enum | Coords2D |
| enum | Coords3D |
| enum | Coords6D |
| enum | MotionDerivative |
Functions | |
| static Vector3d | GetEulerZYXAngles (const Quaterniond &q) |
| static Quaterniond | GetQuaternionFromEulerZYX (double yaw, double pitch, double roll) |
| StateLinXd | operator* (double mult, const StateLinXd &rhs) |
| StateLinXd | operator+ (const StateLinXd &lhs, const StateLinXd &rhs) |
| std::ostream & | operator<< (std::ostream &out, const StateAng3d &ori) |
| std::ostream & | operator<< (std::ostream &out, const StateLinXd &pos) |
| std::ostream & | operator<< (std::ostream &out, const State3d &pose) |
| std::ostream & | operator<< (std::ostream &stream, Endeffectors< T > endeffectors) |
| static Coords2D | To2D (Coords3D dim) |
Variables | |
| static const Coords6D | AllDim6D [] |
| AX | |
| AY | |
| AZ | |
| static ColorT | color |
| kAcc | |
| static constexpr int | kDim2d |
| static constexpr int | kDim3d |
| static constexpr int | kDim6d |
| kJerk | |
| kPos | |
| kVel | |
| LX | |
| LY | |
| LZ | |
| X | |
| X_ | |
| Y | |
| Y_ | |
| Z | |
|
static |
Definition at line 69 of file rviz_colors.h.