We read every piece of feedback, and take your input very seriously.
To see all available qualifiers, see our documentation.
There was an error while loading. Please reload this page.
1 parent 05c0830 commit de368f2Copy full SHA for de368f2
source/Tutorials/Intermediate/URDF/Using-URDF-with-Robot-State-Publisher-cpp.rst
@@ -113,7 +113,7 @@ Fire up your favorite editor and paste the following code into
113
// robot_state_publisher will deal with this transformation
114
broadcaster = std::make_shared<tf2_ros::TransformBroadcaster>(this);
115
// create a broadcaster to tell the tf2 state information
116
- // this broadcaster will determine the position of coordinate system 'asix' in coordinate system 'odom'
+ // this broadcaster will determine the position of coordinate system 'axis' in coordinate system 'odom'
117
RCLCPP_INFO(this->get_logger(),"Starting state publisher");
118
119
loop_rate_=std::make_shared<rclcpp::Rate>(33ms);
0 commit comments