Skip to content
Open
Changes from 3 commits
Commits
File filter

Filter by extension

Filter by extension

Conversations
Failed to load comments.
Loading
Jump to
Jump to file
Failed to load files.
Loading
Diff view
Diff view
6 changes: 5 additions & 1 deletion tf2_ros/include/tf2_ros/buffer_server.h
Original file line number Diff line number Diff line change
Expand Up @@ -82,12 +82,16 @@ class BufferServer
: buffer_(buffer),
logger_(node->get_logger())
{
rcl_action_server_options_t action_server_ops = rcl_action_server_get_default_options();
action_server_ops.result_timeout.nanoseconds = (rcl_duration_value_t)RCL_S_TO_NS(0);
server_ = rclcpp_action::create_server<LookupTransformAction>(
node,
ns,
std::bind(&BufferServer::goalCB, this, std::placeholders::_1, std::placeholders::_2),
std::bind(&BufferServer::cancelCB, this, std::placeholders::_1),
std::bind(&BufferServer::acceptedCB, this, std::placeholders::_1));
std::bind(&BufferServer::acceptedCB, this, std::placeholders::_1),
action_server_ops
);

check_timer_ = rclcpp::create_timer(
node, node->get_clock(), check_period, std::bind(&BufferServer::checkTransforms, this));
Expand Down