#include <Node.h>
Public Member Functions | |
| Node () | |
| void | spin () |
| virtual | ~Node () |
Private Member Functions | |
| bool | checkUpdateThresholds () |
| Check motion and time thresholds for AMCL update. More... | |
| double | getYawFromTf (const tf::Transform &tf) |
| Return yaw from a given TF. More... | |
| void | initialPoseReceived (const geometry_msgs::PoseWithCovarianceStampedConstPtr &msg) |
| void | odomCallback (const geometry_msgs::TransformStampedConstPtr &msg) |
| void | pointcloudCallback (const sensor_msgs::PointCloud2ConstPtr &msg) |
| void | publishGridSlice (const ros::TimerEvent &) |
| void | publishGridTf (const ros::TimerEvent &) |
| void | publishMapPointCloud (const ros::TimerEvent &) |
| void | publishParticles () |
| void | rangeCallback (const rosinrange_msg::range_poseConstPtr &msg) |
| void | rvizMarkerPublish (const uint32_t anchor_id, const float r, const geometry_msgs::Point &uav, const geometry_msgs::Point &anchor) |
| To show range sensors in Rviz. More... | |
| void | setInitialPose (const tf::Transform &init_pose, const float x_dev, const float y_dev, const float z_dev, const float a_dev) |
| Set the initial pose of the particle filter. More... | |
|
private |
|
private |
|
private |
|
private |
|
private |
Check if an update must be performed or not
Apply pass-though filter
Union
Perform particle prediction based on odometry
Compensate for the current roll and pitch of the base-link
Perform particle update based on current point-cloud
Clean the range buffer
Update time and transform information
Do the resampling if needed
Publish particles
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |