ROS Navigation Goal Trigger
Hello all I have a question, is there a way to take the navigation goal when a real robot reaches a goal as a trigger to operate a motor like a stepper motor for example?
ROS Resources: Documentation | Support | Discussion Forum | Index | Service Status | ros @ Robotics Stack Exchange |
Hello all I have a question, is there a way to take the navigation goal when a real robot reaches a goal as a trigger to operate a motor like a stepper motor for example?
Yes, if you use move_base
you can use its published topics:
https://wiki.ros.org/move_base#Action...
Action Published Topics
move_base/feedback
(move_base_msgs/MoveBaseActionFeedback
)Feedback contains the current position of the base in the world.
move_base/status
(actionlib_msgs/GoalStatusArray
)Provides status information on the goals that are sent to the move_base
action.
Asked: 2022-06-21 03:45:35 -0600
Seen: 87 times
Last updated: Jun 21 '22
VSLAM based navigation with Kinect, where do I begin?
Problem running stage navigation tutorial
Navigation planning based on kinect data in 2.5D?
What topics are necessary to log for creating a SLAM comparison bag file?
erratic_gazebo tutorial not working
Publishing a xform from /map to /base_link?
Navigation Stack with gmapping