File tree Expand file tree Collapse file tree 1 file changed +4
-3
lines changed
Expand file tree Collapse file tree 1 file changed +4
-3
lines changed Original file line number Diff line number Diff line change @@ -53,7 +53,8 @@ Trajectory::update(std::shared_ptr<trajectory_msgs::msg::JointTrajectory> joint_
5353TrajectoryPointConstIter
5454Trajectory::sample (const rclcpp::Time & sample_time)
5555{
56- THROW_ON_NULLPTR (trajectory_msg_)
56+ // TODO(karsten1987): Enable this for eloquent when `rclcpp::is_pointer` is used
57+ // THROW_ON_NULLPTR(trajectory_msg_)
5758
5859 // skip if current time hasn't reached traj time of the first msg yet
5960 if (time_less_than (sample_time, trajectory_start_time_)) {
@@ -74,15 +75,15 @@ Trajectory::sample(const rclcpp::Time & sample_time)
7475TrajectoryPointConstIter
7576Trajectory::begin () const
7677{
77- THROW_ON_NULLPTR (trajectory_msg_)
78+ // THROW_ON_NULLPTR(trajectory_msg_)
7879
7980 return trajectory_msg_->points .begin ();
8081}
8182
8283TrajectoryPointConstIter
8384Trajectory::end () const
8485{
85- THROW_ON_NULLPTR (trajectory_msg_)
86+ // THROW_ON_NULLPTR(trajectory_msg_)
8687
8788 return trajectory_msg_->points .end ();
8889}
You can’t perform that action at this time.
0 commit comments