Skip to content

Commit

Permalink
Update queue size
Browse files Browse the repository at this point in the history
  • Loading branch information
JafarAbdi committed Apr 1, 2021
1 parent c6a1e76 commit 534cc10
Showing 1 changed file with 3 additions and 2 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -144,11 +144,12 @@ void planning_scene_monitor::CurrentStateMonitor::startStateMonitor(const std::s
if (tf_buffer_ && !robot_model_->getMultiDOFJointModels().empty())
{
using callback_t = std::function<void(const tf2_msgs::msg::TFMessage::ConstSharedPtr)>;
tf_buffer_->setUsingDedicatedThread(true);
transform_subscriber_ = node_->create_subscription<tf2_msgs::msg::TFMessage>(
"/tf", tf2_ros::DynamicListenerQoS(),
"/tf", tf2_ros::DynamicListenerQoS(25),
callback_t(std::bind(&CurrentStateMonitor::transfromCallback, this, std::placeholders::_1, false)));
static_transfrom_subscriber_ = node_->create_subscription<tf2_msgs::msg::TFMessage>(
"/tf_static", tf2_ros::StaticListenerQoS(),
"/tf_static", tf2_ros::StaticListenerQoS(25),
callback_t(std::bind(&CurrentStateMonitor::transfromCallback, this, std::placeholders::_1, true)));
}
state_monitor_started_ = true;
Expand Down

0 comments on commit 534cc10

Please sign in to comment.