Skip to content
Merged
Show file tree
Hide file tree
Changes from all 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
2 changes: 1 addition & 1 deletion rclcpp/include/rclcpp/executor.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -487,7 +487,7 @@ class Executor
*/
RCLCPP_PUBLIC
static void
execute_timer(rclcpp::TimerBase::SharedPtr timer, const std::shared_ptr<void> & dataPtr);
execute_timer(rclcpp::TimerBase::SharedPtr timer, const std::shared_ptr<void> & data_ptr);

/// Run service server executable.
/**
Expand Down
6 changes: 3 additions & 3 deletions rclcpp/include/rclcpp/timer.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -326,10 +326,10 @@ class GenericTimer : public TimerBase
>::type * = nullptr
>
void
execute_callback_delegate(const rcl_timer_call_info_t & timer_call_info_)
execute_callback_delegate(const rcl_timer_call_info_t & timer_call_info)
{
const TimerInfo info{Time{timer_call_info_.expected_call_time, clock_->get_clock_type()},
Time{timer_call_info_.actual_call_time, clock_->get_clock_type()}};
const TimerInfo info{Time{timer_call_info.expected_call_time, clock_->get_clock_type()},
Time{timer_call_info.actual_call_time, clock_->get_clock_type()}};
callback_(info);
}

Expand Down
4 changes: 2 additions & 2 deletions rclcpp/src/rclcpp/executor.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -547,9 +547,9 @@ Executor::execute_subscription(rclcpp::SubscriptionBase::SharedPtr subscription)
}

void
Executor::execute_timer(rclcpp::TimerBase::SharedPtr timer, const std::shared_ptr<void> & dataPtr)
Executor::execute_timer(rclcpp::TimerBase::SharedPtr timer, const std::shared_ptr<void> & data_ptr)
{
timer->execute_callback(dataPtr);
timer->execute_callback(data_ptr);
}

void
Expand Down