Contents
This node facilitates interaction with the iRobot create in high level ways. For example, via a path message and/or user defined speed/turn.
API Documentation
base_planner_cu
irobot_create_cu provides a high level interface between all other nodes and the iRobot create robot. It also keeps track of the system state (i.e. user is in control, vs. autonomous mode, etc.) and published data about the state to the rest of the system. In autonomous mode, irobot_create_cu controls the robot to follow paths sent to it in the /map_cu coordinate frame. If the user is controlling the robot via the visualization_cu node (or the /cu/user_control_cu topic), then it sends appropriate drive commands to the robot. If there is a bumper hit, then irobot_create_cu is in-charge of reacting and sending bumper data to the rest of the system.Subscribed Topics
/cu/user_control_cu (geometry_msgs/Pose2D)- This is a simple control message for the robot base, x is forward speed and theta is turn in robot coordinates (/robot_cu).
- The robot's best estimate of where it is, given all pose data, in map coordinates (/map_cu).
- This is a global path between robot and goal in map coordinates (/map_cu).
- Pose of the goal in map coordinates (/map_cu).
- A flag containing information from the base_planner_cu node:
- 1 = no path to goal exists.
- A flag indicating what the user is doing via the visualization_cu node:
- 0 = passive, doing nothing
- 1 = manual stop
- 2 = manual control
Published Topics
/cu/odometer_pose_cu (geometry_msgs/Pose2D)- 2D pose created using only the wheel odometers in the local coordinate system used by the irobot create itself.
- The position of a bumper hit in map coordinates (/map_cu in tf).
- A flag indicating what state irobot_create_cu is in:
- 0 = initial state (havn't recieved enough info to start moving)
- 1 = planning and moving normally
- 2 = bumper hit, backing up
- 3 = no path to goal exists
- 4 = manual stop
- 5 = manual control
Services Called
/cu/get_map_cu (nav_msgs/GetMap)- Waits for this on boot so that irobot_create_cu knows mapper_cu is up and running before attempting interaction with it.
Parameters
~bumper_backup_distance (double, default: 0.015 (m))- After a bumper hit, the robot backs-up this distance (meters) before moving again.
- After a bumper hit the robot moves at this speed to back up (m/s).
- Left and right bumper hits are represented as being this many radians away from local x axis.
- Bumper hits are represented as being this far away (in meters) from the center of the robot.
- When true, the tf ROS package is used to facilitate coordinate transformations.
Required tf Transforms
/robot_cu → /map_cu- Transform from robot to map coordinates.