#include <robot_information.h>
Definition at line 53 of file robot_information.h.
mbf_abstract_nav::RobotInformation::RobotInformation |
( |
TF & |
tf_listener, |
|
|
const std::string & |
global_frame, |
|
|
const std::string & |
robot_frame, |
|
|
const ros::Duration & |
tf_timeout |
|
) |
| |
const std::string & mbf_abstract_nav::RobotInformation::getGlobalFrame |
( |
| ) |
const |
const std::string & mbf_abstract_nav::RobotInformation::getRobotFrame |
( |
| ) |
const |
bool mbf_abstract_nav::RobotInformation::getRobotPose |
( |
geometry_msgs::PoseStamped & |
robot_pose | ) |
const |
bool mbf_abstract_nav::RobotInformation::getRobotVelocity |
( |
geometry_msgs::TwistStamped & |
robot_velocity, |
|
|
ros::Duration |
look_back_duration |
|
) |
| const |
const ros::Duration & mbf_abstract_nav::RobotInformation::getTfTimeout |
( |
| ) |
const |
const TF & mbf_abstract_nav::RobotInformation::getTransformListener |
( |
| ) |
const |
const std::string& mbf_abstract_nav::RobotInformation::global_frame_ |
|
private |
const std::string& mbf_abstract_nav::RobotInformation::robot_frame_ |
|
private |
const TF& mbf_abstract_nav::RobotInformation::tf_listener_ |
|
private |
const ros::Duration& mbf_abstract_nav::RobotInformation::tf_timeout_ |
|
private |
The documentation for this class was generated from the following files: