#include <string>
#include <ros/ros.h>
#include <tf2/transform_datatypes.h>
#include <tf2_ros/buffer.h>
#include <tf2_ros/transform_listener.h>
#include <tf2_ros/static_transform_broadcaster.h>
#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
#include <geometry_msgs/TransformStamped.h>
#include <geometry_msgs/PoseStamped.h>
#include <geometry_msgs/PoseWithCovarianceStamped.h>
#include <std_srvs/Trigger.h>
Go to the source code of this file.
Functions | |
template<typename T > | |
void | callback (const T &msg) |
Pose | getPose (const PoseStampedConstPtr &pose) |
Pose | getPose (const PoseWithCovarianceStampedConstPtr &pose) |
void | localPositionCallback (const PoseStamped &msg) |
int | main (int argc, char **argv) |
void | publishZero (const ros::TimerEvent &e) |
bool | reset (std_srvs::Trigger::Request &req, std_srvs::Trigger::Response &res) |
Variables | |
string | child_frame_id |
string | frame_id |
ros::Time | got_local_pos (0) |
string | local_frame_id |
ros::Subscriber | local_position_sub |
TransformStamped | offset |
string | offset_frame_id |
ros::Duration | offset_timeout |
PoseStamped | pose |
ros::Duration | publish_zero_duration |
ros::Duration | publish_zero_timout |
bool | reset_flag = false |
tf2_ros::Buffer | tf_buffer |
PoseStamped | vpe |
ros::Publisher | vpe_pub |
ros::Timer | zero_timer |
void callback | ( | const T & | msg | ) |
Definition at line 70 of file vpe_publisher.cpp.
|
inline |
Definition at line 65 of file vpe_publisher.cpp.
|
inline |
Definition at line 67 of file vpe_publisher.cpp.
void localPositionCallback | ( | const PoseStamped & | msg | ) |
Definition at line 63 of file vpe_publisher.cpp.
Definition at line 119 of file vpe_publisher.cpp.
void publishZero | ( | const ros::TimerEvent & | e | ) |
Definition at line 39 of file vpe_publisher.cpp.
bool reset | ( | std_srvs::Trigger::Request & | req, |
std_srvs::Trigger::Response & | res | ||
) |
Definition at line 112 of file vpe_publisher.cpp.
string child_frame_id |
Definition at line 29 of file vpe_publisher.cpp.
string frame_id |
Definition at line 29 of file vpe_publisher.cpp.
ros::Time got_local_pos(0) |
string local_frame_id |
Definition at line 29 of file vpe_publisher.cpp.
ros::Subscriber local_position_sub |
Definition at line 32 of file vpe_publisher.cpp.
TransformStamped offset |
Definition at line 37 of file vpe_publisher.cpp.
string offset_frame_id |
Definition at line 29 of file vpe_publisher.cpp.
ros::Duration offset_timeout |
Definition at line 36 of file vpe_publisher.cpp.
PoseStamped pose |
Definition at line 34 of file vpe_publisher.cpp.
ros::Duration publish_zero_duration |
Definition at line 36 of file vpe_publisher.cpp.
ros::Duration publish_zero_timout |
Definition at line 36 of file vpe_publisher.cpp.
bool reset_flag = false |
Definition at line 28 of file vpe_publisher.cpp.
tf2_ros::Buffer tf_buffer |
Definition at line 30 of file vpe_publisher.cpp.
PoseStamped vpe |
Definition at line 34 of file vpe_publisher.cpp.
ros::Publisher vpe_pub |
Definition at line 31 of file vpe_publisher.cpp.
ros::Timer zero_timer |
Definition at line 33 of file vpe_publisher.cpp.