#include <pcl/point_types.h>#include <unsupported/Eigen/MatrixFunctions>#include <Eigen/Geometry>#include <lgsm/Lgsm>#include <boost/shared_ptr.hpp>#include <boost/unordered_map.hpp>#include <ros/ros.h>#include <geometry_msgs/Pose.h>#include <geometry_msgs/Twist.h>#include <geometry_msgs/PoseWithCovariance.h>#include <tf/tf.h>#include <tf/transform_datatypes.h>#include <tf/transform_broadcaster.h>#include <tf_conversions/tf_eigen.h>#include "joint_tracker/JointFilter.h"#include "omip_common/OMIPTypeDefs.h"

Go to the source code of this file.
Classes | |
| class | omip::JointCombinedFilter |
Namespaces | |
| namespace | omip |
Typedefs | |
| typedef std::map < JointFilterType, JointFilterPtr > | omip::joint_filters_map |
| typedef boost::shared_ptr < JointCombinedFilter > | omip::JointCombinedFilterPtr |