Example class that can hold state and provide methods that handle incoming data.
More...
Example class that can hold state and provide methods that handle incoming data.
Definition at line 58 of file gear_example_node.cpp.
| void MyCompetitionClass::break_beam_callback |
( |
const osrf_gear::Proximity::ConstPtr & |
msg | ) |
|
|
inline |
| void MyCompetitionClass::competition_state_callback |
( |
const std_msgs::String::ConstPtr & |
msg | ) |
|
|
inline |
| void MyCompetitionClass::current_score_callback |
( |
const std_msgs::Float32::ConstPtr & |
msg | ) |
|
|
inline |
| void MyCompetitionClass::goal_callback |
( |
const osrf_gear::Goal::ConstPtr & |
goal_msg | ) |
|
|
inline |
| void MyCompetitionClass::joint_state_callback |
( |
const sensor_msgs::JointState::ConstPtr & |
joint_state_msg | ) |
|
|
inline |
| void MyCompetitionClass::logical_camera_callback |
( |
const osrf_gear::LogicalCameraImage::ConstPtr & |
image_msg | ) |
|
|
inline |
| void MyCompetitionClass::send_arm_to_zero_state |
( |
| ) |
|
|
inline |
Create a JointTrajectory with all positions set to zero, and command the arm.
Definition at line 113 of file gear_example_node.cpp.
| std::string MyCompetitionClass::competition_state_ |
|
private |
| sensor_msgs::JointState MyCompetitionClass::current_joint_states_ |
|
private |
| double MyCompetitionClass::current_score_ |
|
private |
| bool MyCompetitionClass::has_been_zeroed_ |
|
private |
| std::vector<osrf_gear::Goal> MyCompetitionClass::received_goals_ |
|
private |
The documentation for this class was generated from the following file: