Functions | Variables
vpe_publisher.cpp File Reference
#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>
Include dependency graph for vpe_publisher.cpp:

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
 

Function Documentation

◆ callback()

template<typename T >
void callback ( const T &  msg)

Definition at line 70 of file vpe_publisher.cpp.

◆ getPose() [1/2]

Pose getPose ( const PoseStampedConstPtr &  pose)
inline

Definition at line 65 of file vpe_publisher.cpp.

◆ getPose() [2/2]

Pose getPose ( const PoseWithCovarianceStampedConstPtr &  pose)
inline

Definition at line 67 of file vpe_publisher.cpp.

◆ localPositionCallback()

void localPositionCallback ( const PoseStamped &  msg)

Definition at line 63 of file vpe_publisher.cpp.

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 119 of file vpe_publisher.cpp.

◆ publishZero()

void publishZero ( const ros::TimerEvent e)

Definition at line 39 of file vpe_publisher.cpp.

◆ reset()

bool reset ( std_srvs::Trigger::Request &  req,
std_srvs::Trigger::Response &  res 
)

Definition at line 112 of file vpe_publisher.cpp.

Variable Documentation

◆ child_frame_id

string child_frame_id

Definition at line 29 of file vpe_publisher.cpp.

◆ frame_id

string frame_id

Definition at line 29 of file vpe_publisher.cpp.

◆ got_local_pos

ros::Time got_local_pos(0)

◆ local_frame_id

string local_frame_id

Definition at line 29 of file vpe_publisher.cpp.

◆ local_position_sub

ros::Subscriber local_position_sub

Definition at line 32 of file vpe_publisher.cpp.

◆ offset

TransformStamped offset

Definition at line 37 of file vpe_publisher.cpp.

◆ offset_frame_id

string offset_frame_id

Definition at line 29 of file vpe_publisher.cpp.

◆ offset_timeout

ros::Duration offset_timeout

Definition at line 36 of file vpe_publisher.cpp.

◆ pose

PoseStamped pose

Definition at line 34 of file vpe_publisher.cpp.

◆ publish_zero_duration

ros::Duration publish_zero_duration

Definition at line 36 of file vpe_publisher.cpp.

◆ publish_zero_timout

ros::Duration publish_zero_timout

Definition at line 36 of file vpe_publisher.cpp.

◆ reset_flag

bool reset_flag = false

Definition at line 28 of file vpe_publisher.cpp.

◆ tf_buffer

tf2_ros::Buffer tf_buffer

Definition at line 30 of file vpe_publisher.cpp.

◆ vpe

PoseStamped vpe

Definition at line 34 of file vpe_publisher.cpp.

◆ vpe_pub

ros::Publisher vpe_pub

Definition at line 31 of file vpe_publisher.cpp.

◆ zero_timer

ros::Timer zero_timer

Definition at line 33 of file vpe_publisher.cpp.



clover
Author(s): Oleg Kalachev , Artem Smirnov
autogenerated on Mon Feb 28 2022 22:08:29