Public Member Functions | |
void | init () |
void | initialize_controller () |
LFControl () | |
void | onNewPoint (const geometry_msgs::PointStamped::ConstPtr &point) |
void | step (const auv_msgs::NavSts::ConstPtr &state, std_msgs::Float32::Ptr &headingRef) |
Private Attributes | |
double | LFKp |
labust::navigation::LFModel::Line | line |
ros::Subscriber | refPoint |
labust::navigation::LFModel::vector | T0 |
double | Ts |
labust::navigation::LFModel::vector | Tt |
Definition at line 44 of file lf_test.cpp.
LFControl::LFControl | ( | ) | [inline] |
Definition at line 46 of file lf_test.cpp.
void LFControl::init | ( | ) | [inline] |
Definition at line 48 of file lf_test.cpp.
void LFControl::initialize_controller | ( | ) | [inline] |
Definition at line 80 of file lf_test.cpp.
void LFControl::onNewPoint | ( | const geometry_msgs::PointStamped::ConstPtr & | point | ) | [inline] |
Definition at line 57 of file lf_test.cpp.
void LFControl::step | ( | const auv_msgs::NavSts::ConstPtr & | state, |
std_msgs::Float32::Ptr & | headingRef | ||
) | [inline] |
Definition at line 67 of file lf_test.cpp.
double LFControl::LFKp [private] |
Definition at line 95 of file lf_test.cpp.
labust::navigation::LFModel::Line LFControl::line [private] |
Definition at line 93 of file lf_test.cpp.
ros::Subscriber LFControl::refPoint [private] |
Definition at line 94 of file lf_test.cpp.
Definition at line 92 of file lf_test.cpp.
double LFControl::Ts [private] |
Definition at line 95 of file lf_test.cpp.
Definition at line 92 of file lf_test.cpp.