Public Types | Public Member Functions | Private Attributes | List of all members
mbf_utility::RobotInformation Class Reference

#include <robot_information.h>

Public Types

typedef boost::shared_ptr< RobotInformationPtr
 

Public Member Functions

const std::string & getGlobalFrame () const
 
const std::string & getRobotFrame () const
 
bool getRobotPose (geometry_msgs::PoseStamped &robot_pose) const
 Computes the current robot pose (robot_frame_) in the global frame (global_frame_). More...
 
bool getRobotVelocity (geometry_msgs::TwistStamped &robot_velocity, ros::Duration look_back_duration) const
 
const ros::DurationgetTfTimeout () const
 
const TFgetTransformListener () const
 
 RobotInformation (TF &tf_listener, const std::string &global_frame, const std::string &robot_frame, const ros::Duration &tf_timeout)
 

Private Attributes

const std::string & global_frame_
 
const std::string & robot_frame_
 
const TFtf_listener_
 
const ros::Durationtf_timeout_
 

Detailed Description

Definition at line 53 of file robot_information.h.

Member Typedef Documentation

Definition at line 57 of file robot_information.h.

Constructor & Destructor Documentation

mbf_utility::RobotInformation::RobotInformation ( TF tf_listener,
const std::string &  global_frame,
const std::string &  robot_frame,
const ros::Duration tf_timeout 
)

Definition at line 45 of file robot_information.cpp.

Member Function Documentation

const std::string & mbf_utility::RobotInformation::getGlobalFrame ( ) const

Definition at line 74 of file robot_information.cpp.

const std::string & mbf_utility::RobotInformation::getRobotFrame ( ) const

Definition at line 76 of file robot_information.cpp.

bool mbf_utility::RobotInformation::getRobotPose ( geometry_msgs::PoseStamped &  robot_pose) const

Computes the current robot pose (robot_frame_) in the global frame (global_frame_).

Parameters
robot_poseReference to the robot_pose message object to be filled.
Returns
true, if the current robot pose could be computed, false otherwise.

Definition at line 55 of file robot_information.cpp.

bool mbf_utility::RobotInformation::getRobotVelocity ( geometry_msgs::TwistStamped &  robot_velocity,
ros::Duration  look_back_duration 
) const

Definition at line 68 of file robot_information.cpp.

const ros::Duration & mbf_utility::RobotInformation::getTfTimeout ( ) const

Definition at line 80 of file robot_information.cpp.

const TF & mbf_utility::RobotInformation::getTransformListener ( ) const

Definition at line 78 of file robot_information.cpp.

Member Data Documentation

const std::string& mbf_utility::RobotInformation::global_frame_
private

Definition at line 85 of file robot_information.h.

const std::string& mbf_utility::RobotInformation::robot_frame_
private

Definition at line 87 of file robot_information.h.

const TF& mbf_utility::RobotInformation::tf_listener_
private

Definition at line 83 of file robot_information.h.

const ros::Duration& mbf_utility::RobotInformation::tf_timeout_
private

Definition at line 89 of file robot_information.h.


The documentation for this class was generated from the following files:


mbf_utility
Author(s): Sebastian Pütz
autogenerated on Fri Nov 6 2020 03:56:22