#include <MecanumKinematics.h>

Public Member Functions | |
| void | execForwKin (const sensor_msgs::JointState &js, nav_msgs::Odometry &odom, OdomPose &cpose) |
| void | execInvKin (const geometry_msgs::Twist &twist, trajectory_msgs::JointTrajectory &traj) |
| Mecanum4WKinematics () | |
| void | setAxis1Length (double dLength) |
| void | setAxis2Length (double dLength) |
| void | setWheelDiameter (double dDiam) |
Private Attributes | |
| double | m_dAxis1Length |
| double | m_dAxis2Length |
| double | m_dDiam |
Definition at line 46 of file MecanumKinematics.h.
Definition at line 41 of file Mecanum4WKinematics.cpp.
| void Mecanum4WKinematics::execForwKin | ( | const sensor_msgs::JointState & | js, |
| nav_msgs::Odometry & | odom, | ||
| OdomPose & | cpose | ||
| ) | [virtual] |
Reimplemented from Kinematics.
Definition at line 47 of file Mecanum4WKinematics.cpp.
| void Mecanum4WKinematics::execInvKin | ( | const geometry_msgs::Twist & | twist, |
| trajectory_msgs::JointTrajectory & | traj | ||
| ) | [virtual] |
Reimplemented from Kinematics.
Definition at line 79 of file Mecanum4WKinematics.cpp.
| void Mecanum4WKinematics::setAxis1Length | ( | double | dLength | ) |
Definition at line 111 of file Mecanum4WKinematics.cpp.
| void Mecanum4WKinematics::setAxis2Length | ( | double | dLength | ) |
Definition at line 116 of file Mecanum4WKinematics.cpp.
| void Mecanum4WKinematics::setWheelDiameter | ( | double | dDiam | ) |
Definition at line 122 of file Mecanum4WKinematics.cpp.
double Mecanum4WKinematics::m_dAxis1Length [private] |
Definition at line 70 of file MecanumKinematics.h.
double Mecanum4WKinematics::m_dAxis2Length [private] |
Definition at line 71 of file MecanumKinematics.h.
double Mecanum4WKinematics::m_dDiam [private] |
Definition at line 72 of file MecanumKinematics.h.