Skip to content

Commit de368f2

Browse files
mergify[bot]buglas
andauthored
Update Using-URDF-with-Robot-State-Publisher-cpp.rst (#5811) (#5815)
Change 'asix' to 'axis' (cherry picked from commit 9f6165a) Signed-off-by: buglas <[email protected]> Co-authored-by: buglas <[email protected]>
1 parent 05c0830 commit de368f2

File tree

1 file changed

+1
-1
lines changed

1 file changed

+1
-1
lines changed

source/Tutorials/Intermediate/URDF/Using-URDF-with-Robot-State-Publisher-cpp.rst

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -113,7 +113,7 @@ Fire up your favorite editor and paste the following code into
113113
// robot_state_publisher will deal with this transformation
114114
broadcaster = std::make_shared<tf2_ros::TransformBroadcaster>(this);
115115
// create a broadcaster to tell the tf2 state information
116-
// this broadcaster will determine the position of coordinate system 'asix' in coordinate system 'odom'
116+
// this broadcaster will determine the position of coordinate system 'axis' in coordinate system 'odom'
117117
RCLCPP_INFO(this->get_logger(),"Starting state publisher");
118118
119119
loop_rate_=std::make_shared<rclcpp::Rate>(33ms);

0 commit comments

Comments
 (0)