小鱼 ROS 2 新书上线!点击链接查看, 新书配套视频点击链接查看。
提问前必看的发帖注意事项—— 提问前必看!不符合要求的问题拒绝回答!!
社区使用指南—如何添加标签修改密码
opencv 如何用c++实现像素坐标转相机坐标
-
@小元不圆 我用的是std::vector来作为矩阵的不知道可不可以这么写
-
@小元不圆 应该是数据被opencv拿到时是空的,你没有赋值成功。
-
@小鱼 鱼哥,我按照你给的例子把参数类型全部换成了mat类型可是还是报错了,不过报错变了
terminate called after throwing an instance of 'cv::Exception'
what(): OpenCV(4.2.0) ../modules/calib3d/src/undistort.dispatch.cpp:283: error: (-215:Assertion failed) CV_IS_MAT(_cameraMatrix) && _cameraMatrix->rows == 3 && _cameraMatrix->cols == 3 in function 'cvUndistortPointsInternal'Aborted (core dumped)
#include "ros/ros.h"
#include "tf2_ros/transform_broadcaster.h"
#include "tf2/LinearMath/Quaternion.h"
#include "tf/transform_listener.h"
#include "std_msgs/Float32MultiArray.h"
#include <opencv2/opencv.hpp>
#include <iostream>
using namespace cv;
using namespace std;double num1[3][5] = {{467.973718746897, 0, 303.2622606570868},
{0, 452.261907941113, 251.781457549611},
{0,0,1},
};
double num2[5] = {0.1162199830512324, -0.1111997240485036,
-0.007053489238768723, 0.006914931854427629, 0};
void pixel_to_camera(double arr[],float depth){
vector<double> points(arr,arr+2);
vector<Point2f> MP;cv::Mat inp1(1, 1, CV_64FC2,arr), inp2(1, 1, CV_64FC2); cv::Mat outp1, outp2; cv::Mat m1(3,5,CV_64F,num1); cv::Mat m2(1,5,CV_64F,num2); cv::undistortPoints(inp1,outp1,m1,m2);
int main(int argc,char *argv[]){
ros::init(argc,argv,"tf_pub_dynamic");
ros::NodeHandle nh;double arr[2] = {286.0,198.0}; int *result; pixel_to_camera(arr,1.0); return 0;
}
-
-
@小鱼 嗯嗯 我输入参数输错了,但是我获得的结构是nan是为什么呀
-
@小元不圆 nan是计算中除0了应该是,所以还是输入数据的问题,仔细检查。
-
@小元不圆
这是我的代码,我把输入和输出全部打印出来后,得到的果全是nan。
#include "ros/ros.h"
#include "tf2_ros/transform_broadcaster.h"
#include "tf2/LinearMath/Quaternion.h"
#include "tf/transform_listener.h"
#include "std_msgs/Float32MultiArray.h"
#include <opencv2/opencv.hpp>
#include <iostream>
using namespace cv;
using namespace std;
vector<vector<double>> MK;
vector<double> MD;
double num1[3][5] = {{467.973718746897, 0, 303.2622606570868},
{0, 452.261907941113, 251.781457549611},
{0,0,1},
};
double num2[5] = {0.1162199830512324, -0.1111997240485036,
-0.007053489238768723, 0.006914931854427629, 0};void pixel_to_camera(double arr[],float depth){
vector<double> points(arr,arr+2);
vector<Point2f> MP;cv::Mat inp1(1, 2, CV_64FC2,arr), inp2(1, 1, CV_64FC2); cv::Mat outp1, outp2; cv::Mat m1(3,3,CV_64F,num1); cv::Mat m2(1,5,CV_64F,num2); cv::undistortPoints(inp1,outp1,m1,m2); cout<<"inp1\n"<<inp1<<endl; cout<<"outp1\n"<<outp1<<endl; cout<<"m1\n"<<m1<<endl; cout<<"m2\n"<<m2<<endl;
int main(int argc,char *argv[]){
ros::init(argc,argv,"tf_pub_dynamic");
ros::NodeHandle nh;
double arr[2] = {286.0,198.0};
int *result;
pixel_to_camera(arr,1.0);
return 0;
}
-
,格式没弄整齐
-
@小鱼 是我输入的值不对,我检查一下,谢了鱼鱼哥
-
@小元不圆 m1第二行全是0,你发现了吗
-
@小鱼 嗯嗯,解决掉了,谢啦,顺便问一下输入的像素坐标是顺序是x和y,输出的相机下的坐标顺序分别也是x和y对吗
-
@小元不圆 像素坐标和相机坐标原点和方向是不同的,具体我记不太清了,你找些文章看看,记得把问题标记为已解决,同时改一下标题,这个标题不太合格
@小鱼 在 提问前必看!一定要看!必须看一下! 中说:
1.使用明确的问题标题
好的标题:一键安装后 进不去图形操作系统(能让人一眼看出问题)
不好的标题(看到后感觉莫名其妙不想回答):
ssh远程登录(远程登录怎么了?)
ROS安装错误(不说什么错误) -
@小鱼 好嘞,改了
-