35 #ifndef LASER_JOINT_PROCESSOR_JOINT_IMAGER_H_ 36 #define LASER_JOINT_PROCESSOR_JOINT_IMAGER_H_ 38 #include <opencv2/core/core.hpp> 41 #include <calibration_msgs/DenseLaserSnapshot.h> 52 bool update(
const calibration_msgs::DenseLaserSnapshot& snapshot,
61 std::vector<cv::Mat_<cv::Vec2f> >
images;
65 std::vector<double>& result);
69 std::vector<double>& result);
71 void allocateImages(
unsigned int height,
unsigned int width,
unsigned int channels);
bool computeVelocity(const ros::Time &start, const ros::Time &end, const settlerlib::SortedDeque< joint_states_settler::DeflatedJointStates > &cache, std::vector< double > &result)
void displayImage(unsigned int i)
void allocateImages(unsigned int height, unsigned int width, unsigned int channels)
void writeImage(unsigned int i, const std::string &filename)
bool update(const calibration_msgs::DenseLaserSnapshot &snapshot, const settlerlib::SortedDeque< joint_states_settler::DeflatedJointStates > &cache, const ros::Duration &max_interp=ros::Duration(.25))
bool interpPosition(const ros::Time &target, const settlerlib::SortedDeque< joint_states_settler::DeflatedJointStates > &cache, std::vector< double > &result)
cv::Mat_< cv::Vec2f > getJointImage(unsigned int index) const
std::vector< cv::Mat_< cv::Vec2f > > images