|
| void | abortGoal (const std::string msg) |
| |
| void | drawLine (double x0, double y0, double x1, double y1) |
| |
| void | dynamicReconfigCallback (move_basic::MovebasicConfig &config, uint32_t) |
| |
| void | executeAction (const move_base_msgs::MoveBaseGoalConstPtr &goal) |
| |
| bool | getTransform (const std::string &from, const std::string &to, tf2::Transform &tf) |
| |
| void | goalCallback (const geometry_msgs::PoseStamped::ConstPtr &msg) |
| |
| void | sendCmd (double angular, double linear) |
| |
| void | stopCallback (const std_msgs::Bool::ConstPtr &msg) |
| |
| bool | transformPose (const std::string &from, const std::string &to, const tf2::Transform &in, tf2::Transform &out) |
| |
Definition at line 56 of file move_basic.cpp.
◆ MoveBasic()
◆ abortGoal()
| void MoveBasic::abortGoal |
( |
const std::string |
msg | ) |
|
|
private |
◆ drawLine()
| void MoveBasic::drawLine |
( |
double |
x0, |
|
|
double |
y0, |
|
|
double |
x1, |
|
|
double |
y1 |
|
) |
| |
|
private |
◆ dynamicReconfigCallback()
| void MoveBasic::dynamicReconfigCallback |
( |
move_basic::MovebasicConfig & |
config, |
|
|
uint32_t |
|
|
) |
| |
|
private |
◆ executeAction()
| void MoveBasic::executeAction |
( |
const move_base_msgs::MoveBaseGoalConstPtr & |
goal | ) |
|
|
private |
◆ getTransform()
| bool MoveBasic::getTransform |
( |
const std::string & |
from, |
|
|
const std::string & |
to, |
|
|
tf2::Transform & |
tf |
|
) |
| |
|
private |
◆ goalCallback()
| void MoveBasic::goalCallback |
( |
const geometry_msgs::PoseStamped::ConstPtr & |
msg | ) |
|
|
private |
◆ moveLinear()
| bool MoveBasic::moveLinear |
( |
tf2::Transform & |
goalInDriving, |
|
|
const std::string & |
drivingFrame, |
|
|
tf2::Transform & |
goalInPlanning, |
|
|
const std::string & |
planningFrame |
|
) |
| |
◆ rotate()
| bool MoveBasic::rotate |
( |
double |
requestedYaw, |
|
|
const std::string & |
drivingFrame |
|
) |
| |
◆ run()
◆ sendCmd()
| void MoveBasic::sendCmd |
( |
double |
angular, |
|
|
double |
linear |
|
) |
| |
|
private |
◆ stopCallback()
| void MoveBasic::stopCallback |
( |
const std_msgs::Bool::ConstPtr & |
msg | ) |
|
|
private |
◆ transformPose()
◆ actionServer
◆ alternateDrivingFrame
| std::string MoveBasic::alternateDrivingFrame |
|
private |
◆ alternatePlanningFrame
| std::string MoveBasic::alternatePlanningFrame |
|
private |
◆ angularTolerance
| double MoveBasic::angularTolerance |
|
private |
◆ baseFrame
| std::string MoveBasic::baseFrame |
|
private |
◆ cmdPub
◆ collision_checker
◆ dr_srv
| dynamic_reconfigure::Server<move_basic::MovebasicConfig> MoveBasic::dr_srv |
|
private |
◆ errorPub
◆ forwardLeft
| tf2::Vector3 MoveBasic::forwardLeft |
|
private |
◆ forwardObstacleDist
| float MoveBasic::forwardObstacleDist |
|
private |
◆ forwardObstacleThreshold
| double MoveBasic::forwardObstacleThreshold |
|
private |
◆ forwardRight
| tf2::Vector3 MoveBasic::forwardRight |
|
private |
◆ goalPub
◆ goalSub
◆ lateralKd
| double MoveBasic::lateralKd |
|
private |
◆ lateralKi
| double MoveBasic::lateralKi |
|
private |
◆ lateralKp
| double MoveBasic::lateralKp |
|
private |
◆ leftObstacleDist
| float MoveBasic::leftObstacleDist |
|
private |
◆ linearAcceleration
| double MoveBasic::linearAcceleration |
|
private |
◆ linearTolerance
| double MoveBasic::linearTolerance |
|
private |
◆ listener
◆ localizationLatency
| double MoveBasic::localizationLatency |
|
private |
◆ maxLateralVelocity
| double MoveBasic::maxLateralVelocity |
|
private |
◆ maxLinearVelocity
| double MoveBasic::maxLinearVelocity |
|
private |
◆ maxTurningVelocity
| double MoveBasic::maxTurningVelocity |
|
private |
◆ minLinearVelocity
| double MoveBasic::minLinearVelocity |
|
private |
◆ minSideDist
| double MoveBasic::minSideDist |
|
private |
◆ minTurningVelocity
| double MoveBasic::minTurningVelocity |
|
private |
◆ obstacle_points
◆ obstacleDistPub
◆ obstacleWaitThreshold
| double MoveBasic::obstacleWaitThreshold |
|
private |
◆ pathPub
◆ preferredDrivingFrame
| std::string MoveBasic::preferredDrivingFrame |
|
private |
◆ preferredPlanningFrame
| std::string MoveBasic::preferredPlanningFrame |
|
private |
◆ rightObstacleDist
| float MoveBasic::rightObstacleDist |
|
private |
◆ runawayTimeoutSecs
| double MoveBasic::runawayTimeoutSecs |
|
private |
◆ stop
◆ stopSub
◆ tfBuffer
◆ turningAcceleration
| double MoveBasic::turningAcceleration |
|
private |
The documentation for this class was generated from the following file: