#include <turtlebot3_drive.h>
Definition at line 43 of file turtlebot3_drive.h.
◆ Turtlebot3Drive()
Turtlebot3Drive::Turtlebot3Drive |
( |
| ) |
|
◆ ~Turtlebot3Drive()
Turtlebot3Drive::~Turtlebot3Drive |
( |
| ) |
|
◆ controlLoop()
bool Turtlebot3Drive::controlLoop |
( |
| ) |
|
◆ init()
bool Turtlebot3Drive::init |
( |
| ) |
|
◆ laserScanMsgCallBack()
void Turtlebot3Drive::laserScanMsgCallBack |
( |
const sensor_msgs::LaserScan::ConstPtr & |
msg | ) |
|
|
private |
◆ odomMsgCallBack()
void Turtlebot3Drive::odomMsgCallBack |
( |
const nav_msgs::Odometry::ConstPtr & |
msg | ) |
|
|
private |
◆ updatecommandVelocity()
void Turtlebot3Drive::updatecommandVelocity |
( |
double |
linear, |
|
|
double |
angular |
|
) |
| |
|
private |
◆ check_forward_dist_
double Turtlebot3Drive::check_forward_dist_ |
|
private |
◆ check_side_dist_
double Turtlebot3Drive::check_side_dist_ |
|
private |
◆ cmd_vel_pub_
◆ escape_range_
double Turtlebot3Drive::escape_range_ |
|
private |
◆ laser_scan_sub_
◆ nh_
◆ nh_priv_
◆ odom_sub_
◆ prev_tb3_pose_
double Turtlebot3Drive::prev_tb3_pose_ |
|
private |
◆ scan_data_
double Turtlebot3Drive::scan_data_[3] = {0.0, 0.0, 0.0} |
|
private |
◆ tb3_pose_
double Turtlebot3Drive::tb3_pose_ |
|
private |
The documentation for this class was generated from the following files: