#include <ctime>#include <boost/shared_ptr.hpp>#include <ros/ros.h>#include <tf/transform_datatypes.h>#include <tf/transform_listener.h>#include <tf/transform_broadcaster.h>#include <tf/message_filter.h>#include <message_filters/subscriber.h>#include <std_msgs/Float32.h>#include <std_msgs/Bool.h>#include <std_srvs/Empty.h>#include <sensor_msgs/LaserScan.h>#include <sensor_msgs/PointCloud2.h>#include <pcl_ros/point_cloud.h>#include <pcl/point_types.h>#include <pcl/ros/conversions.h>#include <pcl_ros/transforms.h>#include <pcl/sample_consensus/method_types.h>#include <pcl/sample_consensus/model_types.h>#include <pcl/segmentation/sac_segmentation.h>#include <pcl/io/pcd_io.h>#include <pcl/filters/extract_indices.h>#include <pcl/filters/passthrough.h>#include <geometry_msgs/Pose.h>#include <geometry_msgs/PoseArray.h>#include <geometry_msgs/PoseWithCovariance.h>#include <geometry_msgs/PoseWithCovarianceStamped.h>#include <humanoid_localization/humanoid_localization_defs.h>#include <humanoid_localization/MotionModel.h>#include <humanoid_localization/ObservationModel.h>#include <humanoid_localization/RaycastingModel.h>#include <humanoid_localization/EndpointModel.h>#include <octomap/octomap.h>#include <sensor_msgs/Imu.h>#include <boost/circular_buffer.hpp>

Go to the source code of this file.
Classes | |
| class | humanoid_localization::HumanoidLocalization |
Namespaces | |
| namespace | humanoid_localization |
Functions | |
| static void | humanoid_localization::getRP (const geometry_msgs::Quaternion &msg_q, double &roll, double &pitch) |