Public Member Functions | Private Attributes | List of all members
rm_control::RobotStateHandle Class Reference

#include <robot_state_interface.h>

Public Member Functions

std::string getName () const
 
geometry_msgs::TransformStamped lookupTransform (const std::string &target_frame, const std::string &source_frame, const ros::Time &time)
 
 RobotStateHandle ()=default
 
 RobotStateHandle (std::string name, tf2_ros::Buffer *buffer)
 
bool setTransform (const geometry_msgs::TransformStamped &transform, const std::string &authority, bool is_static=false) const
 
bool setTransform (const std::vector< geometry_msgs::TransformStamped > &transforms, const std::string &authority, bool is_static=false) const
 

Private Attributes

tf2_ros::Bufferbuffer_ {}
 
std::string name_
 

Detailed Description

Definition at line 81 of file robot_state_interface.h.

Constructor & Destructor Documentation

◆ RobotStateHandle() [1/2]

rm_control::RobotStateHandle::RobotStateHandle ( )
default

◆ RobotStateHandle() [2/2]

rm_control::RobotStateHandle::RobotStateHandle ( std::string  name,
tf2_ros::Buffer buffer 
)
inline

Definition at line 116 of file robot_state_interface.h.

Member Function Documentation

◆ getName()

std::string rm_control::RobotStateHandle::getName ( ) const
inline

Definition at line 143 of file robot_state_interface.h.

◆ lookupTransform()

geometry_msgs::TransformStamped rm_control::RobotStateHandle::lookupTransform ( const std::string &  target_frame,
const std::string &  source_frame,
const ros::Time time 
)
inline

Definition at line 123 of file robot_state_interface.h.

◆ setTransform() [1/2]

bool rm_control::RobotStateHandle::setTransform ( const geometry_msgs::TransformStamped &  transform,
const std::string &  authority,
bool  is_static = false 
) const
inline

Definition at line 129 of file robot_state_interface.h.

◆ setTransform() [2/2]

bool rm_control::RobotStateHandle::setTransform ( const std::vector< geometry_msgs::TransformStamped > &  transforms,
const std::string &  authority,
bool  is_static = false 
) const
inline

Definition at line 135 of file robot_state_interface.h.

Member Data Documentation

◆ buffer_

tf2_ros::Buffer* rm_control::RobotStateHandle::buffer_ {}
private

Definition at line 150 of file robot_state_interface.h.

◆ name_

std::string rm_control::RobotStateHandle::name_
private

Definition at line 149 of file robot_state_interface.h.


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


rm_common
Author(s):
autogenerated on Tue May 6 2025 02:23:36