#include <ros/ros.h>#include <rcll_ros_msgs/SendBeaconSignal.h>#include <geometry_msgs/PoseWithCovarianceStamped.h>Go to the source code of this file.
Functions | |
| void | cb_pose (const geometry_msgs::PoseWithCovarianceStamped::ConstPtr &msg) |
| void | cb_timer (const ros::WallTimerEvent &event, ros::NodeHandle &n) |
| void | init_service_client (ros::NodeHandle &n) |
| int | main (int argc, char **argv) |
Variables | |
| geometry_msgs::PoseWithCovarianceStamped | last_pose_ |
| ros::ServiceClient | scl_send_beacon_ |
| unsigned int | seq_num_ |
| void cb_pose | ( | const geometry_msgs::PoseWithCovarianceStamped::ConstPtr & | msg | ) |
Definition at line 32 of file rcll_beacon_sender_node.cpp.
| void cb_timer | ( | const ros::WallTimerEvent & | event, |
| ros::NodeHandle & | n | ||
| ) |
Definition at line 47 of file rcll_beacon_sender_node.cpp.
| void init_service_client | ( | ros::NodeHandle & | n | ) |
Definition at line 38 of file rcll_beacon_sender_node.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 76 of file rcll_beacon_sender_node.cpp.
| geometry_msgs::PoseWithCovarianceStamped last_pose_ |
Definition at line 27 of file rcll_beacon_sender_node.cpp.
| ros::ServiceClient scl_send_beacon_ |
Definition at line 28 of file rcll_beacon_sender_node.cpp.
| unsigned int seq_num_ |
Definition at line 30 of file rcll_beacon_sender_node.cpp.