Public Member Functions | Private Attributes | List of all members
rviz_visual_tools::TFVisualTools Class Reference

#include <tf_visual_tools.h>

Public Member Functions

void publishAllTransforms (const ros::TimerEvent &e)
 At a certain frequency update the tf transforms that we are tracking This is called internally by a clock, you should not need to use this TODO: make private in next release? More...
 
bool publishTransform (const Eigen::Isometry3d &transform, const std::string &from_frame, const std::string &to_frame)
 Visualize transforms in Rviz, etc. More...
 
 TFVisualTools (double loop_hz=2)
 Constructor. More...
 

Private Attributes

ros::NodeHandle nh_
 
ros::Timer non_realtime_loop_
 
tf2_ros::TransformBroadcaster tf_pub_
 
std::vector< geometry_msgs::TransformStamped > transforms_
 

Detailed Description

Definition at line 64 of file tf_visual_tools.h.

Constructor & Destructor Documentation

◆ TFVisualTools()

rviz_visual_tools::TFVisualTools::TFVisualTools ( double  loop_hz = 2)
explicit

Constructor.

Parameters
loop_hz- how often tf is published

Definition at line 49 of file tf_visual_tools.cpp.

Member Function Documentation

◆ publishAllTransforms()

void rviz_visual_tools::TFVisualTools::publishAllTransforms ( const ros::TimerEvent e)

At a certain frequency update the tf transforms that we are tracking This is called internally by a clock, you should not need to use this TODO: make private in next release?

Definition at line 99 of file tf_visual_tools.cpp.

◆ publishTransform()

bool rviz_visual_tools::TFVisualTools::publishTransform ( const Eigen::Isometry3d &  transform,
const std::string &  from_frame,
const std::string &  to_frame 
)

Visualize transforms in Rviz, etc.

Returns
true on success

Definition at line 57 of file tf_visual_tools.cpp.

Member Data Documentation

◆ nh_

ros::NodeHandle rviz_visual_tools::TFVisualTools::nh_
private

Definition at line 88 of file tf_visual_tools.h.

◆ non_realtime_loop_

ros::Timer rviz_visual_tools::TFVisualTools::non_realtime_loop_
private

Definition at line 94 of file tf_visual_tools.h.

◆ tf_pub_

tf2_ros::TransformBroadcaster rviz_visual_tools::TFVisualTools::tf_pub_
private

Definition at line 91 of file tf_visual_tools.h.

◆ transforms_

std::vector<geometry_msgs::TransformStamped> rviz_visual_tools::TFVisualTools::transforms_
private

Definition at line 97 of file tf_visual_tools.h.


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


rviz_visual_tools
Author(s): Dave Coleman
autogenerated on Mon Feb 28 2022 23:43:06