Skip to content

Commit

Permalink
Fixing 3586: rviz panel operating in multiple non-standard frames (ro…
Browse files Browse the repository at this point in the history
…s-navigation#3595)

* Fixes ros-navigation#3586 on rviz time stamping

* removing timing from rviz testing panel

Signed-off-by: enricosutera <enricosutera@outlook.com>
  • Loading branch information
SteveMacenski authored and enricosutera committed May 19, 2024
1 parent 2ee8472 commit 1d3005b
Showing 1 changed file with 2 additions and 2 deletions.
4 changes: 2 additions & 2 deletions nav2_rviz_plugins/src/nav2_panel.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -710,7 +710,7 @@ geometry_msgs::msg::PoseStamped Nav2Panel::convert_to_msg(
auto msg = geometry_msgs::msg::PoseStamped();

msg.header.frame_id = "map";
msg.header.stamp = rclcpp::Clock().now();
// msg.header.stamp = client_node_->now(); // client node doesn't respect sim time yet

msg.pose.position.x = pose[0];
msg.pose.position.y = pose[1];
Expand Down Expand Up @@ -948,7 +948,7 @@ Nav2Panel::onNewGoal(double x, double y, double theta, QString frame)
{
auto pose = geometry_msgs::msg::PoseStamped();

pose.header.stamp = rclcpp::Clock().now();
// pose.header.stamp = client_node_->now(); // client node doesn't respect sim time yet
pose.header.frame_id = frame.toStdString();
pose.pose.position.x = x;
pose.pose.position.y = y;
Expand Down

0 comments on commit 1d3005b

Please sign in to comment.