Example class that can hold state and provide methods that handle incoming data. More...
Public Member Functions | |
void | break_beam_callback (const osrf_gear::Proximity::ConstPtr &msg) |
Called when a new Proximity message is received. More... | |
void | competition_state_callback (const std_msgs::String::ConstPtr &msg) |
Called when a new message is received. More... | |
void | current_score_callback (const std_msgs::Float32::ConstPtr &msg) |
Called when a new message is received. More... | |
void | goal_callback (const osrf_gear::Goal::ConstPtr &goal_msg) |
Called when a new Goal message is received. More... | |
void | joint_state_callback (const sensor_msgs::JointState::ConstPtr &joint_state_msg) |
Called when a new JointState message is received. More... | |
void | logical_camera_callback (const osrf_gear::LogicalCameraImage::ConstPtr &image_msg) |
Called when a new LogicalCameraImage message is received. More... | |
MyCompetitionClass (ros::NodeHandle &node) | |
void | send_arm_to_zero_state () |
Create a JointTrajectory with all positions set to zero, and command the arm. More... | |
Private Attributes | |
std::string | competition_state_ |
sensor_msgs::JointState | current_joint_states_ |
double | current_score_ |
bool | has_been_zeroed_ |
ros::Publisher | joint_trajectory_publisher_ |
std::vector< osrf_gear::Goal > | received_goals_ |
Example class that can hold state and provide methods that handle incoming data.
Definition at line 58 of file gear_example_node.cpp.
|
inlineexplicit |
Definition at line 61 of file gear_example_node.cpp.
|
inline |
Called when a new Proximity message is received.
Definition at line 139 of file gear_example_node.cpp.
|
inline |
Called when a new message is received.
Definition at line 80 of file gear_example_node.cpp.
|
inline |
Called when a new message is received.
Definition at line 71 of file gear_example_node.cpp.
|
inline |
Called when a new Goal message is received.
Definition at line 89 of file gear_example_node.cpp.
|
inline |
Called when a new JointState message is received.
Definition at line 96 of file gear_example_node.cpp.
|
inline |
Called when a new LogicalCameraImage message is received.
Definition at line 131 of file gear_example_node.cpp.
|
inline |
Create a JointTrajectory with all positions set to zero, and command the arm.
Definition at line 113 of file gear_example_node.cpp.
|
private |
Definition at line 146 of file gear_example_node.cpp.
|
private |
Definition at line 150 of file gear_example_node.cpp.
|
private |
Definition at line 147 of file gear_example_node.cpp.
|
private |
Definition at line 151 of file gear_example_node.cpp.
|
private |
Definition at line 148 of file gear_example_node.cpp.
|
private |
Definition at line 149 of file gear_example_node.cpp.