Definitions for the VIDEOSLAM node. More...
#include "videoslam.hpp"
Go to the source code of this file.
Functions | |
bool | interpolatePose (const geometry_msgs::Pose &pose1, ros::Time time1, const geometry_msgs::Pose &pose2, ros::Time time2, geometry_msgs::Pose &finalPose, ros::Time time3) |
int | main (int argc, char **argv) |
void | mySigintHandler (int sig) |
void | shiftPose (const geometry_msgs::Pose &pose_src, geometry_msgs::Pose &pose_dst, cv::Mat transformation) |
Variables | |
struct timeval | cycle_timer |
Definitions for the VIDEOSLAM node.
Definition in file videoslam.cpp.
bool interpolatePose | ( | const geometry_msgs::Pose & | pose1, |
ros::Time | time1, | ||
const geometry_msgs::Pose & | pose2, | ||
ros::Time | time2, | ||
geometry_msgs::Pose & | finalPose, | ||
ros::Time | time3 | ||
) |
Definition at line 393 of file videoslam.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 10 of file videoslam.cpp.
void mySigintHandler | ( | int | sig | ) |
Definition at line 92 of file videoslam.cpp.
void shiftPose | ( | const geometry_msgs::Pose & | pose_src, |
geometry_msgs::Pose & | pose_dst, | ||
cv::Mat | transformation | ||
) |
Definition at line 349 of file videoslam.cpp.
struct timeval cycle_timer |
Definition at line 7 of file videoslam.cpp.