, including all inherited members.
applyOdomTransform(Particles &particles, const tf::Transform &odomTransform) | humanoid_localization::MotionModel | |
applyOdomTransform(tf::Pose &particlePose, const tf::Transform &odomTransform) | humanoid_localization::MotionModel | [protected] |
applyOdomTransformTemporal(Particles &particles, const ros::Time &t, double dt) | humanoid_localization::MotionModel | |
calibrateOdometry(const tf::Transform &odomTransform) const | humanoid_localization::MotionModel | [protected] |
computeOdomTransform(const tf::Transform currentPose) const | humanoid_localization::MotionModel | |
getLastOdomPose(tf::Stamped< tf::Pose > &lastOdomPose) const | humanoid_localization::MotionModel | |
lookupLocalTransform(const std::string &targetFrame, const ros::Time &t, tf::StampedTransform &localTransform) const | humanoid_localization::MotionModel | |
lookupOdomPose(const ros::Time &t, tf::Stamped< tf::Pose > &odomPose) const | humanoid_localization::MotionModel | |
lookupOdomTransform(const ros::Time &t, tf::Transform &odomTransform) const | humanoid_localization::MotionModel | |
lookupPoseHeight(const ros::Time &t, double &poseHeight) const | humanoid_localization::MotionModel | |
m_baseFrameId | humanoid_localization::MotionModel | [protected] |
m_firstOdometryReceived | humanoid_localization::MotionModel | [protected] |
m_footprintFrameId | humanoid_localization::MotionModel | [protected] |
m_lastOdomPose | humanoid_localization::MotionModel | [protected] |
m_odomCalibration2D | humanoid_localization::MotionModel | [protected] |
m_odomFrameId | humanoid_localization::MotionModel | [protected] |
m_odomNoise2D | humanoid_localization::MotionModel | [protected] |
m_odomNoisePitch | humanoid_localization::MotionModel | [protected] |
m_odomNoiseRoll | humanoid_localization::MotionModel | [protected] |
m_odomNoiseZ | humanoid_localization::MotionModel | [protected] |
m_rngNormal | humanoid_localization::MotionModel | [protected] |
m_rngUniform | humanoid_localization::MotionModel | [protected] |
m_tfListener | humanoid_localization::MotionModel | [protected] |
MotionModel(ros::NodeHandle *nh, EngineT *rngEngine, tf::TransformListener *tf, const std::string &odomFrameId, const std::string &baseFrameId) | humanoid_localization::MotionModel | |
odomTransformNoise(const tf::Transform &odomTransform) | humanoid_localization::MotionModel | [protected] |
reset() | humanoid_localization::MotionModel | |
storeOdomPose(const tf::Stamped< tf::Pose > &odomPose) | humanoid_localization::MotionModel | |
transformPose(tf::Pose &particlePose, const tf::Transform &odomTransform) | humanoid_localization::MotionModel | [protected] |
~MotionModel() | humanoid_localization::MotionModel | [virtual] |