#include <ros/ros.h>#include <std_msgs/Float64MultiArray.h>#include <tf/transform_listener.h>#include <sensor_msgs/JointState.h>#include <trajectory_msgs/JointTrajectory.h>Go to the source code of this file.
Functions | |
| void | callback (const sensor_msgs::JointState::ConstPtr &joint_state) |
| int | main (int argc, char **argv) |
| void | reset () |
| template<typename T > | |
| int | sgn (T val) |
Variables | |
| bool | have_pan =false |
| bool | have_tilt =false |
| double | pan_position =0 |
| ros::Publisher | pub_controller_command |
| double | tilt_position =0 |
| bool | tracking =false |
| trajectory_msgs::JointTrajectory | traj |
| void callback | ( | const sensor_msgs::JointState::ConstPtr & | joint_state | ) |
Definition at line 19 of file pan_tilt_object_tracking_pid.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 55 of file pan_tilt_object_tracking_pid.cpp.
| void reset | ( | ) |
Definition at line 46 of file pan_tilt_object_tracking_pid.cpp.
| int sgn | ( | T | val | ) |
Definition at line 42 of file pan_tilt_object_tracking_pid.cpp.
| bool have_pan =false |
Definition at line 14 of file pan_tilt_object_tracking_pid.cpp.
| bool have_tilt =false |
Definition at line 14 of file pan_tilt_object_tracking_pid.cpp.
| double pan_position =0 |
Definition at line 13 of file pan_tilt_object_tracking_pid.cpp.
| ros::Publisher pub_controller_command |
Definition at line 15 of file pan_tilt_object_tracking_pid.cpp.
| double tilt_position =0 |
Definition at line 13 of file pan_tilt_object_tracking_pid.cpp.
| bool tracking =false |
Definition at line 14 of file pan_tilt_object_tracking_pid.cpp.
| trajectory_msgs::JointTrajectory traj |
Definition at line 16 of file pan_tilt_object_tracking_pid.cpp.