Public Member Functions | |
void | command_cb (const orbit_pantilt::JointCommandConstPtr &msg) |
void | config_cb (orbit_pantilt::OrbitPanTiltConfig &config, uint32_t level) |
double | min_max_angle (double raw_data_rad, double min_deg, double max_deg) |
OrbitPanTilt () | |
bool | pan_reset (std_srvs::Empty::Request &req, std_srvs::Empty::Response &res) |
int | set_ext_ctrls (int fd, int id, int value) |
bool | tilt_reset (std_srvs::Empty::Request &req, std_srvs::Empty::Response &res) |
Private Types | |
typedef dynamic_reconfigure::Server < orbit_pantilt::OrbitPanTiltConfig > | ReconfigureServer |
Private Attributes | |
std::string | device_ |
int | fd_ |
ros::NodeHandle | nh_ |
double | pan_ |
int | pan_ratio_ |
ReconfigureServer | reconfigure_server_ |
double | tilt_ |
int | tilt_ratio_ |
Definition at line 24 of file orbit_pantilt.cpp.
typedef dynamic_reconfigure::Server<orbit_pantilt::OrbitPanTiltConfig> OrbitPanTilt::ReconfigureServer [private] |
Definition at line 29 of file orbit_pantilt.cpp.
OrbitPanTilt::OrbitPanTilt | ( | ) | [inline] |
Definition at line 130 of file orbit_pantilt.cpp.
void OrbitPanTilt::command_cb | ( | const orbit_pantilt::JointCommandConstPtr & | msg | ) | [inline] |
Definition at line 95 of file orbit_pantilt.cpp.
void OrbitPanTilt::config_cb | ( | orbit_pantilt::OrbitPanTiltConfig & | config, |
uint32_t | level | ||
) | [inline] |
Definition at line 56 of file orbit_pantilt.cpp.
double OrbitPanTilt::min_max_angle | ( | double | raw_data_rad, |
double | min_deg, | ||
double | max_deg | ||
) | [inline] |
Definition at line 87 of file orbit_pantilt.cpp.
bool OrbitPanTilt::pan_reset | ( | std_srvs::Empty::Request & | req, |
std_srvs::Empty::Response & | res | ||
) | [inline] |
Definition at line 112 of file orbit_pantilt.cpp.
int OrbitPanTilt::set_ext_ctrls | ( | int | fd, |
int | id, | ||
int | value | ||
) | [inline] |
Definition at line 39 of file orbit_pantilt.cpp.
bool OrbitPanTilt::tilt_reset | ( | std_srvs::Empty::Request & | req, |
std_srvs::Empty::Response & | res | ||
) | [inline] |
Definition at line 120 of file orbit_pantilt.cpp.
std::string OrbitPanTilt::device_ [private] |
Definition at line 34 of file orbit_pantilt.cpp.
int OrbitPanTilt::fd_ [private] |
Definition at line 33 of file orbit_pantilt.cpp.
ros::NodeHandle OrbitPanTilt::nh_ [private] |
Definition at line 26 of file orbit_pantilt.cpp.
double OrbitPanTilt::pan_ [private] |
Definition at line 35 of file orbit_pantilt.cpp.
int OrbitPanTilt::pan_ratio_ [private] |
Definition at line 36 of file orbit_pantilt.cpp.
Definition at line 30 of file orbit_pantilt.cpp.
double OrbitPanTilt::tilt_ [private] |
Definition at line 35 of file orbit_pantilt.cpp.
int OrbitPanTilt::tilt_ratio_ [private] |
Definition at line 36 of file orbit_pantilt.cpp.