#include <ros/ros.h>#include <sensor_msgs/Joy.h>#include <corobot_msgs/MoveArm.h>#include <corobot_msgs/MotorCommand.h>#include <corobot_msgs/takepic.h>#include <corobot_msgs/PanTilt.h>#include <std_msgs/Int32.h>#include <math.h>
Go to the source code of this file.
Functions | |
| void | joyCallback (const sensor_msgs::Joy::ConstPtr &joy) |
| int | main (int argc, char **argv) |
| void | velocityCallback (const std_msgs::Int32::ConstPtr &msg) |
Variables | |
| ros::Publisher | driveControl_pub |
| int | gripper_state |
| ros::Publisher | move_arm_pub |
| double | orx |
| double | ory |
| double | orz |
| ros::Publisher | pan_tilt_control |
| int | pan_value |
| int | save_image_state = 0 |
| int | speed_left |
| int | speed_right |
| int | speed_value |
| ros::Publisher | takepic_pub |
| int | tilt_value |
| bool | turningLeft |
| bool | turningRight |
| void joyCallback | ( | const sensor_msgs::Joy::ConstPtr & | joy | ) |
Definition at line 65 of file joystick_control.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 326 of file joystick_control.cpp.
| void velocityCallback | ( | const std_msgs::Int32::ConstPtr & | msg | ) |
Definition at line 59 of file joystick_control.cpp.
Definition at line 47 of file joystick_control.cpp.
| int gripper_state |
Definition at line 56 of file joystick_control.cpp.
Definition at line 47 of file joystick_control.cpp.
| double orx |
Definition at line 53 of file joystick_control.cpp.
| double ory |
Definition at line 53 of file joystick_control.cpp.
| double orz |
Definition at line 53 of file joystick_control.cpp.
Definition at line 47 of file joystick_control.cpp.
| int pan_value |
Definition at line 52 of file joystick_control.cpp.
| int save_image_state = 0 |
Definition at line 57 of file joystick_control.cpp.
| int speed_left |
Definition at line 50 of file joystick_control.cpp.
| int speed_right |
Definition at line 50 of file joystick_control.cpp.
| int speed_value |
Definition at line 50 of file joystick_control.cpp.
Definition at line 47 of file joystick_control.cpp.
| int tilt_value |
Definition at line 52 of file joystick_control.cpp.
| bool turningLeft |
Definition at line 51 of file joystick_control.cpp.
| bool turningRight |
Definition at line 51 of file joystick_control.cpp.