Skip to content

Commit

Permalink
fix spellcheck
Browse files Browse the repository at this point in the history
Signed-off-by: Yamato Ando <[email protected]>
  • Loading branch information
YamatoAndo committed Jun 5, 2024
1 parent bea144b commit 8d47515
Show file tree
Hide file tree
Showing 2 changed files with 6 additions and 6 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -76,8 +76,8 @@ class GyroOdometerNode : public rclcpp::Node

bool vehicle_twist_arrived_;
bool imu_arrived_;
rclcpp::Time latest_vehicle_twist_rostime_;
rclcpp::Time latest_imu_rostime_;
rclcpp::Time latest_vehicle_twist_ros_time_;
rclcpp::Time latest_imu_ros_time_;
std::deque<geometry_msgs::msg::TwistWithCovarianceStamped> vehicle_twist_queue_;
std::deque<sensor_msgs::msg::Imu> gyro_queue_;

Expand Down
8 changes: 4 additions & 4 deletions localization/gyro_odometer/src/gyro_odometer_core.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -88,7 +88,7 @@ void GyroOdometerNode::callbackVehicleTwist(
"topic_time_stamp", static_cast<rclcpp::Time>(vehicle_twist_ptr->header.stamp).nanoseconds());

vehicle_twist_arrived_ = true;
latest_vehicle_twist_rostime_ = vehicle_twist_ptr->header.stamp;
latest_vehicle_twist_ros_time_ = vehicle_twist_ptr->header.stamp;
vehicle_twist_queue_.push_back(*vehicle_twist_ptr);
concatGyroAndOdometer();

Expand All @@ -102,7 +102,7 @@ void GyroOdometerNode::callbackImu(const sensor_msgs::msg::Imu::ConstSharedPtr i
"topic_time_stamp", static_cast<rclcpp::Time>(imu_msg_ptr->header.stamp).nanoseconds());

imu_arrived_ = true;
latest_imu_rostime_ = imu_msg_ptr->header.stamp;
latest_imu_ros_time_ = imu_msg_ptr->header.stamp;
gyro_queue_.push_back(*imu_msg_ptr);
concatGyroAndOdometer();

Expand Down Expand Up @@ -138,8 +138,8 @@ void GyroOdometerNode::concatGyroAndOdometer()
}

// check timeout
const double vehicle_twist_dt = std::abs((this->now() - latest_vehicle_twist_rostime_).seconds());
const double imu_dt = std::abs((this->now() - latest_imu_rostime_).seconds());
const double vehicle_twist_dt = std::abs((this->now() - latest_vehicle_twist_ros_time_).seconds());
const double imu_dt = std::abs((this->now() - latest_imu_ros_time_).seconds());
diagnostics_->addKeyValue("vehicle_twist_time_stamp_dt", vehicle_twist_dt);
diagnostics_->addKeyValue("imu_time_stamp_dt", imu_dt);
if (vehicle_twist_dt > message_timeout_sec_) {
Expand Down

0 comments on commit 8d47515

Please sign in to comment.