File tree Expand file tree Collapse file tree 1 file changed +2
-3
lines changed Expand file tree Collapse file tree 1 file changed +2
-3
lines changed Original file line number Diff line number Diff line change @@ -58,9 +58,6 @@ class TrajectoryGenerator : public rclcpp::Node
5858class TrajectoryController : public rclcpp ::Node
5959{
6060public:
61- using JointTrajectoryPointQueue =
62- iox::concurrent::LockFreeQueue<trajectory_msgs::msg::JointTrajectoryPoint, 100 >;
63-
6461 TrajectoryController ()
6562 : Node(" trajectory_controller" )
6663 {
@@ -107,6 +104,8 @@ class TrajectoryController : public rclcpp::Node
107104 }
108105
109106private:
107+ using JointTrajectoryPointQueue =
108+ iox::concurrent::LockFreeQueue<trajectory_msgs::msg::JointTrajectoryPoint, 100 >;
110109 rclcpp::TimerBase::SharedPtr timer_;
111110 rclcpp::Subscription<trajectory_msgs::msg::JointTrajectory>::SharedPtr subscription_;
112111 JointTrajectoryPointQueue queue_;
You can’t perform that action at this time.
0 commit comments