Namespaces | Classes | Typedefs | Functions | Variables
tf2_ros Namespace Reference

Namespaces

 filter_failure_reasons
 

Classes

class  Buffer
 Standard implementation of the tf2_ros::BufferInterface abstract data type. More...
 
class  BufferClient
 Action client-based implementation of the tf2_ros::BufferInterface abstract data type. More...
 
class  BufferInterface
 Abstract interface for wrapping tf2::BufferCore in a ROS-based API. Implementations include tf2_ros::Buffer and tf2_ros::BufferClient. More...
 
class  BufferServer
 Action server for the actionlib-based implementation of tf2_ros::BufferInterface. More...
 
class  MessageFilter
 Follows the patterns set by the message_filters package to implement a filter which only passes messages through once there is transform data available. More...
 
class  MessageFilterBase
 
class  StaticTransformBroadcaster
 This class provides an easy way to publish coordinate frame transform information. It will handle all the messaging and stuffing of messages. And the function prototypes lay out all the necessary data needed for each message. More...
 
class  TransformBroadcaster
 This class provides an easy way to publish coordinate frame transform information. It will handle all the messaging and stuffing of messages. And the function prototypes lay out all the necessary data needed for each message. More...
 
class  TransformListener
 This class provides an easy way to request and receive coordinate frame transform information. More...
 

Typedefs

typedef filter_failure_reasons::FilterFailureReason FilterFailureReason
 

Functions

void conditionally_append_timeout_info (std::string *errstr, const ros::Time &start_time, const ros::Duration &timeout)
 
ros::Time now_fallback_to_wall ()
 
void sleep_fallback_to_wall (const ros::Duration &d)
 

Variables

static const double CAN_TRANSFORM_POLLING_SCALE = 0.01
 
static const std::string threading_error = "Do not call canTransform or lookupTransform with a timeout unless you are using another thread for populating data. Without a dedicated thread it will always timeout. If you have a separate thread servicing tf messages, call setUsingDedicatedThread(true) on your Buffer instance."
 

Detailed Description

Author
Wim Meeussen
Tully Foote

Typedef Documentation

◆ FilterFailureReason

Definition at line 73 of file message_filter.h.

Function Documentation

◆ conditionally_append_timeout_info()

void tf2_ros::conditionally_append_timeout_info ( std::string *  errstr,
const ros::Time start_time,
const ros::Duration timeout 
)

Definition at line 106 of file buffer.cpp.

◆ now_fallback_to_wall()

ros::Time tf2_ros::now_fallback_to_wall ( )

This is a workaround for the case that we're running inside of rospy and ros::Time is not initialized inside the c++ instance. This makes the system fall back to Wall time if not initialized.

Definition at line 75 of file buffer.cpp.

◆ sleep_fallback_to_wall()

void tf2_ros::sleep_fallback_to_wall ( const ros::Duration d)

This is a workaround for the case that we're running inside of rospy and ros::Time is not initialized inside the c++ instance. This makes the system fall back to Wall time if not initialized. https://github.com/ros/geometry/issues/30

Definition at line 93 of file buffer.cpp.

Variable Documentation

◆ CAN_TRANSFORM_POLLING_SCALE

const double tf2_ros::CAN_TRANSFORM_POLLING_SCALE = 0.01
static

Definition at line 41 of file buffer.cpp.

◆ threading_error

const std::string tf2_ros::threading_error = "Do not call canTransform or lookupTransform with a timeout unless you are using another thread for populating data. Without a dedicated thread it will always timeout. If you have a separate thread servicing tf messages, call setUsingDedicatedThread(true) on your Buffer instance."
static

Definition at line 139 of file buffer.h.



tf2_ros
Author(s): Eitan Marder-Eppstein, Wim Meeussen
autogenerated on Mon Jun 27 2022 02:43:12