#include <viz.h>
Public Member Functions | |
| Viz () | |
Private Member Functions | |
| void | attCallback (const rosflight_msgs::AttitudeConstPtr &msg) |
| void | magCallback (const sensor_msgs::MagneticFieldConstPtr &msg) |
Private Attributes | |
| ros::Subscriber | att_sub_ |
| std::string | fixed_frame_ = "fixed_frame" |
| int | mag_count_ |
| ros::Publisher | mag_pub_ |
| int | mag_skip_ |
| ros::Subscriber | mag_sub_ |
| double | mag_sum_ |
| int | mag_throttle_ |
| ros::NodeHandle | nh_ |
| ros::NodeHandle | nh_private_ |
| ros::Publisher | pose_pub_ |
| std::vector< geometry_msgs::Point > | pts_list_ |
| ros::Publisher | pts_pub_ |
| tf::Quaternion | q_att_ |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |