Class WallFollowStateManager

Inheritance Relationships

Base Type

Class Documentation

class WallFollowStateManager : public irobot_create_nodes::WallFollowState

Manage state machine for transition between wall follow behaviors.

Public Functions

inline explicit WallFollowStateManager(const rclcpp::Logger &logger)
void initialize(int8_t follow_side)
virtual bool get_next_velocity(const tf2::Transform &robot_pose, const irobot_create_msgs::msg::IrIntensityVector &ir_intensity, const std::vector<std::string> &active_hazard_frames, WFVelocityCommand &vel_cmd) override
inline virtual WallFollowStateID get_id() override
inline virtual bool is_engaged() override