College of DuPage Lunabotics Documentation
2025
|
Controls the robot physically via manual and autonomous commands using various controllers. More...
Public Member Functions | |
ControllerTeleop () | |
Private Member Functions | |
void | declare_and_get_parameters () |
Declares and retrieves controller mode parameters. More... | |
void | apply_controller_mode () |
Applies the correct controller mode based on parameters. More... | |
void | control_robot () |
Controls the robot based on joystick input. More... | |
void | joy_callback (const sensor_msgs::msg::Joy::SharedPtr joy_msg) |
Joystick input processing. More... | |
void | velocity_callback (const geometry_msgs::msg::Twist::SharedPtr velocity_msg) |
Velocity message callback for navigation control. More... | |
int | get_button (const sensor_msgs::msg::Joy::SharedPtr &joy_msg, const std::initializer_list< int > &mappings) |
Helper to retrieve button value based on controller mode. More... | |
double | get_axis (const sensor_msgs::msg::Joy::SharedPtr &joy_msg, const std::initializer_list< int > &mappings) |
Helper to retrieve axis value based on controller mode. More... | |
Private Attributes | |
rclcpp::Subscription< geometry_msgs::msg::Twist >::SharedPtr | velocity_subscriber_ |
rclcpp::Subscription< sensor_msgs::msg::Joy >::SharedPtr | joystick_subscriber_ |
bool | manual_enabled_ |
bool | robot_disabled_ |
bool | xbox_mode_ |
bool | ps4_mode_ |
bool | switch_mode_ |
bool | outdoor_mode_ |
double | speed_multiplier_ |
double | left_speed_ |
double | right_speed_ |
double | lift_actuator_speed_ |
double | tilt_actuator_speed_ |
bool | home_button_ |
bool | share_button_ |
bool | menu_button_ |
bool | a_button_ |
bool | b_button_ |
bool | x_button_ |
bool | y_button_ |
double | left_trigger_ |
double | right_trigger_ |
double | left_bumper_ |
double | right_bumper_ |
double | d_pad_vertical_ |
double | d_pad_horizontal_ |
double | left_joystick_x_ |
double | left_joystick_y_ |
double | right_joystick_y_ |
SparkMax | left_wheel_motor_ |
SparkMax | right_wheel_motor_ |
SparkMax | lift_actuator_motor_ |
SparkMax | tilt_actuator_left_motor_ |
SparkMax | tilt_actuator_right_motor_ |
Controls the robot physically via manual and autonomous commands using various controllers.
|
inline |
|
inlineprivate |
Applies the correct controller mode based on parameters.
|
inlineprivate |
Controls the robot based on joystick input.
|
inlineprivate |
Declares and retrieves controller mode parameters.
|
inlineprivate |
Helper to retrieve axis value based on controller mode.
|
inlineprivate |
Helper to retrieve button value based on controller mode.
|
inlineprivate |
Joystick input processing.
|
inlineprivate |
Velocity message callback for navigation control.
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |