SMACC2
|
#include <cb_position_control_free_space.hpp>
Public Attributes | |
double | yaw_goal_tolerance_rads_ = 0.1 |
double | threshold_distance_ = 3.0 |
geometry_msgs::msg::Pose | target_pose_ |
Private Attributes | |
double | targetYaw_ |
bool | goalReached_ |
double | k_betta_ |
double | max_angular_yaw_speed_ |
double | prev_error_linear_ = 0.0 |
double | prev_error_angular_ = 0.0 |
double | integral_linear_ = 0.0 |
double | integral_angular_ = 0.0 |
double | max_linear_velocity = 1.0 |
double | max_angular_velocity = 1.0 |
rclcpp::Publisher< geometry_msgs::msg::Twist >::SharedPtr | cmd_vel_pub_ |
Additional Inherited Members | |
Protected Member Functions inherited from smacc2::SmaccAsyncClientBehavior | |
void | postSuccessEvent () |
void | postFailureEvent () |
virtual void | dispose () override |
bool | isShutdownRequested () |
onEntry is executed in a new thread. However the current state cannot be left until the onEntry thread finishes. This flag can be checked from the onEntry thread to force finishing the thread. | |
Protected Member Functions inherited from smacc2::ISmaccClientBehavior | |
virtual void | runtimeConfigure () |
template<typename EventType > | |
void | postEvent (const EventType &ev) |
template<typename EventType > | |
void | postEvent () |
ISmaccState * | getCurrentState () |
virtual rclcpp::Node::SharedPtr | getNode () const |
virtual rclcpp::Logger | getLogger () const |
Definition at line 29 of file cb_position_control_free_space.hpp.
cl_nitrosz::CbPositionControlFreeSpace::CbPositionControlFreeSpace | ( | ) |
Definition at line 30 of file cb_position_control_free_space.cpp.
|
overridevirtual |
Reimplemented from smacc2::ISmaccClientBehavior.
Definition at line 37 of file cb_position_control_free_space.cpp.
References cmd_vel_pub_, smacc2::ISmaccClientBehavior::getLogger(), smacc2::ISmaccClientBehavior::getName(), smacc2::ISmaccClientBehavior::getNode(), goalReached_, integral_angular_, integral_linear_, max_angular_velocity, max_linear_velocity, smacc2::SmaccAsyncClientBehavior::postSuccessEvent(), prev_error_angular_, prev_error_linear_, smacc2::ISmaccClientBehavior::requiresComponent(), target_pose_, and threshold_distance_.
Referenced by cl_nitrosz::CbNavigateNextWaypointFree::onEntry().
|
overridevirtual |
Reimplemented from smacc2::ISmaccClientBehavior.
Definition at line 197 of file cb_position_control_free_space.cpp.
void cl_nitrosz::CbPositionControlFreeSpace::updateParameters | ( | ) |
Definition at line 35 of file cb_position_control_free_space.cpp.
|
private |
Definition at line 47 of file cb_position_control_free_space.hpp.
Referenced by onEntry().
|
private |
Definition at line 33 of file cb_position_control_free_space.hpp.
Referenced by onEntry().
|
private |
Definition at line 40 of file cb_position_control_free_space.hpp.
Referenced by onEntry().
|
private |
Definition at line 39 of file cb_position_control_free_space.hpp.
Referenced by onEntry().
|
private |
Definition at line 34 of file cb_position_control_free_space.hpp.
|
private |
Definition at line 45 of file cb_position_control_free_space.hpp.
Referenced by onEntry().
|
private |
Definition at line 35 of file cb_position_control_free_space.hpp.
|
private |
Definition at line 44 of file cb_position_control_free_space.hpp.
Referenced by onEntry().
|
private |
Definition at line 38 of file cb_position_control_free_space.hpp.
Referenced by onEntry().
|
private |
Definition at line 37 of file cb_position_control_free_space.hpp.
Referenced by onEntry().
geometry_msgs::msg::Pose cl_nitrosz::CbPositionControlFreeSpace::target_pose_ |
Definition at line 54 of file cb_position_control_free_space.hpp.
Referenced by cl_nitrosz::CbNavigateNextWaypointFree::onEntry(), and onEntry().
|
private |
Definition at line 32 of file cb_position_control_free_space.hpp.
double cl_nitrosz::CbPositionControlFreeSpace::threshold_distance_ = 3.0 |
Definition at line 52 of file cb_position_control_free_space.hpp.
Referenced by onEntry().
double cl_nitrosz::CbPositionControlFreeSpace::yaw_goal_tolerance_rads_ = 0.1 |
Definition at line 50 of file cb_position_control_free_space.hpp.