Public Member Functions | |
void | callback (const nav_msgs::OdometryConstPtr &msg_0, const nav_msgs::OdometryConstPtr &msg_1) |
virtual void | onInit () |
RobotFollow () | |
virtual | ~RobotFollow () |
Private Types | |
typedef sync_policies::ApproximateTime < nav_msgs::Odometry, nav_msgs::Odometry > | ApproximatePolicy |
typedef message_filters::Synchronizer < ApproximatePolicy > | ApproximateSync |
Private Attributes | |
float | angular_velocity_ |
boost::shared_ptr < ApproximateSync > | approximate_sync_ |
float | follow_distance_ |
float | linear_velocity_ |
int | maximum_queue_size_ |
ros::NodeHandle | nh_ |
float | pi_ |
ros::Publisher | pub_ |
message_filters::Subscriber < nav_msgs::Odometry > | sub_0_ |
message_filters::Subscriber < nav_msgs::Odometry > | sub_1_ |
Definition at line 35 of file follow.cpp.
typedef sync_policies::ApproximateTime<nav_msgs::Odometry, nav_msgs::Odometry> micros_mars_task_alloc::RobotFollow::ApproximatePolicy [private] |
Definition at line 49 of file follow.cpp.
typedef message_filters::Synchronizer<ApproximatePolicy> micros_mars_task_alloc::RobotFollow::ApproximateSync [private] |
Definition at line 50 of file follow.cpp.
micros_mars_task_alloc::RobotFollow::RobotFollow | ( | ) | [inline] |
Definition at line 38 of file follow.cpp.
virtual micros_mars_task_alloc::RobotFollow::~RobotFollow | ( | ) | [inline, virtual] |
Definition at line 39 of file follow.cpp.
void micros_mars_task_alloc::RobotFollow::callback | ( | const nav_msgs::OdometryConstPtr & | msg_0, |
const nav_msgs::OdometryConstPtr & | msg_1 | ||
) |
Definition at line 73 of file follow.cpp.
void micros_mars_task_alloc::RobotFollow::onInit | ( | ) | [virtual] |
Implements nodelet::Nodelet.
Definition at line 60 of file follow.cpp.
float micros_mars_task_alloc::RobotFollow::angular_velocity_ [private] |
Definition at line 55 of file follow.cpp.
boost::shared_ptr<ApproximateSync> micros_mars_task_alloc::RobotFollow::approximate_sync_ [private] |
Definition at line 52 of file follow.cpp.
float micros_mars_task_alloc::RobotFollow::follow_distance_ [private] |
Definition at line 55 of file follow.cpp.
float micros_mars_task_alloc::RobotFollow::linear_velocity_ [private] |
Definition at line 55 of file follow.cpp.
int micros_mars_task_alloc::RobotFollow::maximum_queue_size_ [private] |
Definition at line 56 of file follow.cpp.
Reimplemented from nodelet::Nodelet.
Definition at line 47 of file follow.cpp.
float micros_mars_task_alloc::RobotFollow::pi_ [private] |
Definition at line 55 of file follow.cpp.
Definition at line 57 of file follow.cpp.
message_filters::Subscriber<nav_msgs::Odometry> micros_mars_task_alloc::RobotFollow::sub_0_ [private] |
Definition at line 54 of file follow.cpp.
message_filters::Subscriber<nav_msgs::Odometry> micros_mars_task_alloc::RobotFollow::sub_1_ [private] |
Definition at line 54 of file follow.cpp.