#include "ros/ros.h"#include "geometry_msgs/Twist.h"#include "turtlesim/Pose.h"#include <sstream>
Go to the source code of this file.
Functions | |
| double | degrees2radians (double angle_in_degrees) |
| double | getDistance (double x1, double y1, double x2, double y2) |
| void | gridClean () |
| int | main (int argc, char **argv) |
| void | move (double speed, double distance, bool isForward) |
| void | moveGoal (turtlesim::Pose goal_pose, double distance_tolerance) |
| void | poseCallback (const turtlesim::Pose::ConstPtr &pose_message) |
| void | rotate (double angular_speed, double angle, bool clockwise) |
| void | setDesiredOrientation (double desired_angle_radians) |
| void | spiralClean () |
Variables | |
| const double | PI = 3.14159265359 |
| ros::Subscriber | pose_subscriber |
| turtlesim::Pose | turtlesim_pose |
| ros::Publisher | velocity_publisher |
| const double | x_max = 11.0 |
| const double | x_min = 0.0 |
| const double | y_max = 11.0 |
| const double | y_min = 0.0 |
| double degrees2radians | ( | double | angle_in_degrees | ) |
Definition at line 179 of file robot_cleaner.cpp.
| double getDistance | ( | double | x1, |
| double | y1, | ||
| double | x2, | ||
| double | y2 | ||
| ) |
Definition at line 198 of file robot_cleaner.cpp.
| void gridClean | ( | ) |
Definition at line 240 of file robot_cleaner.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
test your code here
Definition at line 37 of file robot_cleaner.cpp.
| void move | ( | double | speed, |
| double | distance, | ||
| bool | isForward | ||
| ) |
makes the robot move with a certain linear velocity for a certain distance in a forward or backward straight direction.
| void moveGoal | ( | turtlesim::Pose | goal_pose, |
| double | distance_tolerance | ||
| ) |
Definition at line 202 of file robot_cleaner.cpp.
| void poseCallback | ( | const turtlesim::Pose::ConstPtr & | pose_message | ) |
Definition at line 192 of file robot_cleaner.cpp.
| void rotate | ( | double | angular_speed, |
| double | angle, | ||
| bool | clockwise | ||
| ) |
| void setDesiredOrientation | ( | double | desired_angle_radians | ) |
Definition at line 184 of file robot_cleaner.cpp.
| void spiralClean | ( | ) |
Definition at line 279 of file robot_cleaner.cpp.
| const double PI = 3.14159265359 |
Definition at line 26 of file robot_cleaner.cpp.
Definition at line 17 of file robot_cleaner.cpp.
Definition at line 18 of file robot_cleaner.cpp.
Definition at line 16 of file robot_cleaner.cpp.
| const double x_max = 11.0 |
Definition at line 23 of file robot_cleaner.cpp.
| const double x_min = 0.0 |
Definition at line 21 of file robot_cleaner.cpp.
| const double y_max = 11.0 |
Definition at line 24 of file robot_cleaner.cpp.
| const double y_min = 0.0 |
Definition at line 22 of file robot_cleaner.cpp.