The EKFslamWrapper class provides the ROS wrapper for EKF SLAM 3d from MRPT libraries. More...
#include <mrpt_ekf_slam_3d_wrapper.h>
Public Member Functions | |
void | computeEllipseOrientationScale (tf::Quaternion &orientation, Eigen::Vector3d &scale, const mrpt::math::CMatrixDouble covariance) |
compute the orientation and scale of covariance ellipsoids | |
EKFslamWrapper () | |
constructor | |
void | get_param () |
read the parameters from launch file | |
void | init () |
initialize publishers subscribers and EKF 3d slam | |
bool | is_file_exists (const std::string &name) |
check the existance of the file | |
void | landmarkCallback (const mrpt_msgs::ObservationRangeBearing &_msg) |
callback function for the landmarks | |
void | makeRightHanded (Eigen::Matrix3d &eigenvectors, Eigen::Vector3d &eigenvalues) |
compute the correct orientation and scale of covariance ellipsoids (make sure that we output covariance ellipsoids for right handed system of coordinates) | |
void | odometryForCallback (CObservationOdometry::Ptr &_odometry, const std_msgs::Header &_msg_header) |
get the odometry for received observation | |
void | publishTF () |
publis tf tree | |
bool | rawlogPlay () |
play rawlog file | |
void | updateSensorPose (std::string _frame_id) |
update the pose of the sensor with respect to the robot | |
void | viz_dataAssociation () |
visualize the data associations for the landmarks observed by robot at the each step | |
void | viz_state () |
visualize the covariance ellipsoids for robot and landmarks | |
bool | waitForTransform (mrpt::poses::CPose3D &des, const std::string &target_frame, const std::string &source_frame, const ros::Time &time, const ros::Duration &timeout, const ros::Duration &polling_sleep_duration=ros::Duration(0.01)) |
wait for transfor between odometry frame and the robot frame | |
~EKFslamWrapper () | |
destructor | |
Private Attributes | |
std::string | base_frame_id |
robot frame | |
ros::Publisher | data_association_viz_pub_ |
double | ellipse_scale_ |
std::string | global_frame_id |
/map frame | |
std::string | ini_filename |
name of ini file | |
std::map< std::string, mrpt::poses::CPose3D > | landmark_poses_ |
landmark poses with respect to the map | |
tf::TransformListener | listenerTF_ |
transform listener | |
ros::NodeHandle | n_ |
Node handler. | |
std::string | odom_frame_id |
/odom frame | |
std::string | rawlog_filename |
name of rawlog file | |
bool | rawlog_play_ |
true if rawlog file exists | |
double | rawlog_play_delay |
delay of replay from rawlog file | |
std::string | sensor_source |
2D laser scans | |
std::vector< ros::Subscriber > | sensorSub_ |
list of sensors topics | |
ros::Publisher | state_viz_pub_ |
float | t_exec |
the time which take one SLAM update execution | |
tf::TransformBroadcaster | tf_broadcaster_ |
transform broadcaster | |
CTicTac | tictac |
timer for SLAM performance evaluation |
The EKFslamWrapper class provides the ROS wrapper for EKF SLAM 3d from MRPT libraries.
Definition at line 65 of file mrpt_ekf_slam_3d_wrapper.h.
constructor
Definition at line 14 of file mrpt_ekf_slam_3d_wrapper.cpp.
destructor
Definition at line 18 of file mrpt_ekf_slam_3d_wrapper.cpp.
void EKFslamWrapper::computeEllipseOrientationScale | ( | tf::Quaternion & | orientation, |
Eigen::Vector3d & | scale, | ||
const mrpt::math::CMatrixDouble | covariance | ||
) |
compute the orientation and scale of covariance ellipsoids
orientation | the orientation of the ellipsoid in Quaternions |
scale | the vector of the eigen values for calculating the size of the ellipse |
covariance | covariance matrix for current landmarks or robot pose |
Definition at line 255 of file mrpt_ekf_slam_3d_wrapper.cpp.
void EKFslamWrapper::get_param | ( | ) |
read the parameters from launch file
Definition at line 24 of file mrpt_ekf_slam_3d_wrapper.cpp.
void EKFslamWrapper::init | ( | ) |
initialize publishers subscribers and EKF 3d slam
Create subscribers///
Definition at line 50 of file mrpt_ekf_slam_3d_wrapper.cpp.
bool EKFslamWrapper::is_file_exists | ( | const std::string & | name | ) |
check the existance of the file
Definition at line 19 of file mrpt_ekf_slam_3d_wrapper.cpp.
void EKFslamWrapper::landmarkCallback | ( | const mrpt_msgs::ObservationRangeBearing & | _msg | ) |
callback function for the landmarks
Given the landmarks wait for odometry, create the pair of action and observation, implement one SLAM update, publish map and pose.
_msg | the landmark message |
Definition at line 150 of file mrpt_ekf_slam_3d_wrapper.cpp.
void EKFslamWrapper::makeRightHanded | ( | Eigen::Matrix3d & | eigenvectors, |
Eigen::Vector3d & | eigenvalues | ||
) |
compute the correct orientation and scale of covariance ellipsoids (make sure that we output covariance ellipsoids for right handed system of coordinates)
eigenvectors | the 3x3 matrix of eigenvectors |
eigenvalues | the 3d vector of eigen values |
Definition at line 233 of file mrpt_ekf_slam_3d_wrapper.cpp.
void EKFslamWrapper::odometryForCallback | ( | CObservationOdometry::Ptr & | _odometry, |
const std_msgs::Header & | _msg_header | ||
) |
get the odometry for received observation
_odometry | odometry for received observation |
_msg_header | timestamp of the observation |
Definition at line 92 of file mrpt_ekf_slam_3d_wrapper.cpp.
void EKFslamWrapper::publishTF | ( | ) |
publis tf tree
Definition at line 445 of file mrpt_ekf_slam_3d_wrapper.cpp.
bool EKFslamWrapper::rawlogPlay | ( | ) |
play rawlog file
Definition at line 189 of file mrpt_ekf_slam_3d_wrapper.cpp.
void EKFslamWrapper::updateSensorPose | ( | std::string | _frame_id | ) |
update the pose of the sensor with respect to the robot
frame_id | the frame of the sensors |
Definition at line 107 of file mrpt_ekf_slam_3d_wrapper.cpp.
void EKFslamWrapper::viz_dataAssociation | ( | ) |
visualize the data associations for the landmarks observed by robot at the each step
Definition at line 299 of file mrpt_ekf_slam_3d_wrapper.cpp.
void EKFslamWrapper::viz_state | ( | ) |
visualize the covariance ellipsoids for robot and landmarks
Definition at line 360 of file mrpt_ekf_slam_3d_wrapper.cpp.
bool EKFslamWrapper::waitForTransform | ( | mrpt::poses::CPose3D & | des, |
const std::string & | target_frame, | ||
const std::string & | source_frame, | ||
const ros::Time & | time, | ||
const ros::Duration & | timeout, | ||
const ros::Duration & | polling_sleep_duration = ros::Duration(0.01) |
||
) |
wait for transfor between odometry frame and the robot frame
des | position of the robot with respect to odometry frame |
target_frame | the odometry tf frame |
source_frame | the robot tf frame |
time | timestamp of the observation for which we want to retrieve the position of the robot |
timeout | timeout for odometry waiting |
polling_sleep_duration | timeout for transform wait |
Definition at line 132 of file mrpt_ekf_slam_3d_wrapper.cpp.
std::string EKFslamWrapper::base_frame_id [private] |
robot frame
Definition at line 178 of file mrpt_ekf_slam_3d_wrapper.h.
Definition at line 188 of file mrpt_ekf_slam_3d_wrapper.h.
double EKFslamWrapper::ellipse_scale_ [private] |
Definition at line 170 of file mrpt_ekf_slam_3d_wrapper.h.
std::string EKFslamWrapper::global_frame_id [private] |
/map frame
Definition at line 176 of file mrpt_ekf_slam_3d_wrapper.h.
std::string EKFslamWrapper::ini_filename [private] |
name of ini file
Definition at line 175 of file mrpt_ekf_slam_3d_wrapper.h.
std::map<std::string, mrpt::poses::CPose3D> EKFslamWrapper::landmark_poses_ [private] |
landmark poses with respect to the map
Definition at line 183 of file mrpt_ekf_slam_3d_wrapper.h.
transform listener
Definition at line 189 of file mrpt_ekf_slam_3d_wrapper.h.
ros::NodeHandle EKFslamWrapper::n_ [private] |
Node handler.
Definition at line 168 of file mrpt_ekf_slam_3d_wrapper.h.
std::string EKFslamWrapper::odom_frame_id [private] |
/odom frame
Definition at line 177 of file mrpt_ekf_slam_3d_wrapper.h.
std::string EKFslamWrapper::rawlog_filename [private] |
name of rawlog file
Definition at line 174 of file mrpt_ekf_slam_3d_wrapper.h.
bool EKFslamWrapper::rawlog_play_ [private] |
true if rawlog file exists
Definition at line 171 of file mrpt_ekf_slam_3d_wrapper.h.
double EKFslamWrapper::rawlog_play_delay [private] |
delay of replay from rawlog file
Definition at line 169 of file mrpt_ekf_slam_3d_wrapper.h.
std::string EKFslamWrapper::sensor_source [private] |
2D laser scans
Definition at line 181 of file mrpt_ekf_slam_3d_wrapper.h.
std::vector<ros::Subscriber> EKFslamWrapper::sensorSub_ [private] |
list of sensors topics
Definition at line 173 of file mrpt_ekf_slam_3d_wrapper.h.
ros::Publisher EKFslamWrapper::state_viz_pub_ [private] |
Definition at line 188 of file mrpt_ekf_slam_3d_wrapper.h.
float EKFslamWrapper::t_exec [private] |
the time which take one SLAM update execution
Definition at line 186 of file mrpt_ekf_slam_3d_wrapper.h.
transform broadcaster
Definition at line 190 of file mrpt_ekf_slam_3d_wrapper.h.
CTicTac EKFslamWrapper::tictac [private] |
timer for SLAM performance evaluation
Definition at line 185 of file mrpt_ekf_slam_3d_wrapper.h.