#include <PTUNode.h>
Public Member Functions | |
| bool | ok () |
| ok Method to check if the PTUNode is still working More... | |
| PTUNode (ros::NodeHandle &n) | |
| PTUNode Constructor for PTUNode class. More... | |
| void | spinOnce () |
| spinOnce Method that is used to spin the PTUNode once, including ros::spinOnce(). Run this in a loop. More... | |
| ~PTUNode () | |
Private Member Functions | |
| bool | emptyAlive (std_srvs::Empty::Request &req, std_srvs::Empty::Response &res) |
| bool | getRange (asr_flir_ptu_driver::Range::Request &req, asr_flir_ptu_driver::Range::Response &res) |
| bool | predict (asr_flir_ptu_driver::Predict::Request &req, asr_flir_ptu_driver::Predict::Response &res) |
| bool | setSettings () |
| bool | setSpeedControl () |
| void | setState (const asr_flir_ptu_driver::State::ConstPtr &msg) |
| bool | updateSettings (std_srvs::Empty::Request &, std_srvs::Empty::Response &) |
| bool | updateSpeedControl (std_srvs::Empty::Request &, std_srvs::Empty::Response &) |
| bool | validatePanTilt (asr_flir_ptu_driver::Validate::Request &req, asr_flir_ptu_driver::Validate::Response &res) |
Private Attributes | |
| ros::ServiceServer | alive_service |
| ros::Publisher | joint_pub |
| ros::Publisher | joint_pub_old |
| ros::Subscriber | joint_sub |
| ros::NodeHandle | node_handle |
| ros::ServiceServer | path_prediction_service |
| asr_flir_ptu_driver::PTUDriver * | ptu |
| std::string | ptu_pan_frame |
| std::string | ptu_pan_frame_rotated |
| std::string | ptu_tilt_frame |
| std::string | ptu_tilt_frame_rotated |
| std::string | ptu_topic_state |
| ros::ServiceServer | range_service |
| int | seq_num |
| std::string | service_alive |
| std::string | service_path_prediction |
| std::string | service_range |
| std::string | service_settings_update |
| std::string | service_speed_control_update |
| std::string | service_validation |
| ros::ServiceServer | settings_service |
| ros::ServiceServer | speedmode_service |
| tf::TransformBroadcaster | tb_pan |
| tf::TransformBroadcaster | tb_tilt |
| std::string | topic_state |
| std::string | topic_state_command |
| ros::ServiceServer | validate_service |
Static Private Attributes | |
| static constexpr double | DEG_TO_RAD = M_PI / 180.0 |
| PTUNode::PTUNode | ( | ros::NodeHandle & | n | ) |
PTUNode Constructor for PTUNode class.
| n | noehandle to use |
Definition at line 4 of file PTUNode.cpp.
| PTUNode::~PTUNode | ( | ) |
Definition at line 65 of file PTUNode.cpp.
|
private |
Definition at line 129 of file PTUNode.cpp.
|
private |
Definition at line 140 of file PTUNode.cpp.
| bool PTUNode::ok | ( | ) |
ok Method to check if the PTUNode is still working
Definition at line 309 of file PTUNode.cpp.
|
private |
Definition at line 121 of file PTUNode.cpp.
|
private |
Definition at line 159 of file PTUNode.cpp.
|
private |
Definition at line 288 of file PTUNode.cpp.
|
private |
Definition at line 72 of file PTUNode.cpp.
| void PTUNode::spinOnce | ( | ) |
spinOnce Method that is used to spin the PTUNode once, including ros::spinOnce(). Run this in a loop.
Definition at line 313 of file PTUNode.cpp.
|
private |
Definition at line 136 of file PTUNode.cpp.
|
private |
Definition at line 284 of file PTUNode.cpp.
|
private |
Definition at line 96 of file PTUNode.cpp.
|
private |
|
staticprivate |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |