|
Quad-SDK
|
This is the complete list of members for StateEstimator, including all inherited members.
| init(ros::NodeHandle &nh)=0 | StateEstimator | pure virtual |
| last_imu_msg_ | StateEstimator | protected |
| last_joint_state_msg_ | StateEstimator | protected |
| last_mocap_msg_ | StateEstimator | protected |
| loadMocapMsg(geometry_msgs::PoseStamped::ConstPtr last_mocap_msg) | StateEstimator | |
| loadSensorMsg(sensor_msgs::Imu last_imu_msg, sensor_msgs::JointState last_joint_state_msg) | StateEstimator | |
| quadKD_ | StateEstimator | protected |
| readIMU(const sensor_msgs::Imu::ConstPtr &last_imu_msg, Eigen::Vector3d &fk, Eigen::Vector3d &wk, Eigen::Quaterniond &qk) | StateEstimator | |
| readJointEncoder(const sensor_msgs::JointState::ConstPtr &last_joint_state_msg, Eigen::VectorXd &jk) | StateEstimator | |
| state_est_ | StateEstimator | protected |
| StateEstimator() | StateEstimator | |
| updateOnce(quad_msgs::RobotState &last_robot_state_msg)=0 | StateEstimator | pure virtual |