Public Member Functions | Protected Member Functions | Protected Attributes | List of all members
DummyRobotNode Class Reference

Public Member Functions

 DummyRobotNode ()
 
void spin ()
 

Protected Member Functions

void cbInit (const geometry_msgs::PoseWithCovarianceStamped::ConstPtr &msg)
 
void cbTwist (const geometry_msgs::Twist::ConstPtr &msg)
 

Protected Attributes

ros::NodeHandle nh_
 
ros::NodeHandle pnh_
 
ros::Publisher pub_odom_
 
ros::Subscriber sub_init_
 
ros::Subscriber sub_twist_
 
tf2_ros::TransformBroadcaster tfb_
 
tf2_ros::Buffer tfbuf_
 
tf2_ros::TransformListener tfl_
 
float v_
 
float w_
 
double x_
 
double y_
 
double yaw_
 

Detailed Description

Definition at line 41 of file dummy_robot.cpp.

Constructor & Destructor Documentation

DummyRobotNode::DummyRobotNode ( )
inline

Definition at line 88 of file dummy_robot.cpp.

Member Function Documentation

void DummyRobotNode::cbInit ( const geometry_msgs::PoseWithCovarianceStamped::ConstPtr &  msg)
inlineprotected

Definition at line 65 of file dummy_robot.cpp.

void DummyRobotNode::cbTwist ( const geometry_msgs::Twist::ConstPtr &  msg)
inlineprotected

Definition at line 60 of file dummy_robot.cpp.

void DummyRobotNode::spin ( )
inline

Definition at line 104 of file dummy_robot.cpp.

Member Data Documentation

ros::NodeHandle DummyRobotNode::nh_
protected

Definition at line 44 of file dummy_robot.cpp.

ros::NodeHandle DummyRobotNode::pnh_
protected

Definition at line 45 of file dummy_robot.cpp.

ros::Publisher DummyRobotNode::pub_odom_
protected

Definition at line 53 of file dummy_robot.cpp.

ros::Subscriber DummyRobotNode::sub_init_
protected

Definition at line 55 of file dummy_robot.cpp.

ros::Subscriber DummyRobotNode::sub_twist_
protected

Definition at line 54 of file dummy_robot.cpp.

tf2_ros::TransformBroadcaster DummyRobotNode::tfb_
protected

Definition at line 57 of file dummy_robot.cpp.

tf2_ros::Buffer DummyRobotNode::tfbuf_
protected

Definition at line 56 of file dummy_robot.cpp.

tf2_ros::TransformListener DummyRobotNode::tfl_
protected

Definition at line 58 of file dummy_robot.cpp.

float DummyRobotNode::v_
protected

Definition at line 50 of file dummy_robot.cpp.

float DummyRobotNode::w_
protected

Definition at line 51 of file dummy_robot.cpp.

double DummyRobotNode::x_
protected

Definition at line 47 of file dummy_robot.cpp.

double DummyRobotNode::y_
protected

Definition at line 48 of file dummy_robot.cpp.

double DummyRobotNode::yaw_
protected

Definition at line 49 of file dummy_robot.cpp.


The documentation for this class was generated from the following file:


planner_cspace
Author(s): Atsushi Watanabe
autogenerated on Tue Jul 9 2019 05:00:13