#include <camera_depth_sensor.h>
Public Types | |
typedef boost::shared_ptr< CameraDepthSensor > | Ptr |
Public Types inherited from jsk_recognition_utils::PointCloudSensorModel | |
typedef boost::shared_ptr< PointCloudSensorModel > | Ptr |
Public Member Functions | |
CameraDepthSensor () | |
virtual double | expectedPointCloudNum (double distance, double area) const |
Return the expected number of points according to distance and area. it is calculated according to: f^2{s}{r^2}. More... | |
virtual image_geometry::PinholeCameraModel | getPinholeCameraModel () const |
get instance of image_geometry::PinholeCameraModel. More... | |
virtual int | height () const |
height of camera in pixels. More... | |
virtual cv::Mat | image (const int type) const |
return an image from internal camera parameter. More... | |
virtual bool | isInside (const cv::Point &p) const |
return true if point p is inside of field-of-view. More... | |
virtual cv::Point | limit2DPoint (const cv::Point &p) const |
force point to be inside of field of view. More... | |
virtual void | setCameraInfo (const sensor_msgs::CameraInfo &info) |
virtual int | width () const |
width of camera in pixels. More... | |
Protected Attributes | |
sensor_msgs::CameraInfo | camera_info_ |
image_geometry::PinholeCameraModel | model_ |
Definition at line 45 of file camera_depth_sensor.h.
Definition at line 48 of file camera_depth_sensor.h.
|
inline |
Definition at line 49 of file camera_depth_sensor.h.
|
inlinevirtual |
Return the expected number of points according to distance and area. it is calculated according to: f^2{s}{r^2}.
Implements jsk_recognition_utils::PointCloudSensorModel.
Definition at line 82 of file camera_depth_sensor.h.
|
inlinevirtual |
get instance of image_geometry::PinholeCameraModel.
Definition at line 61 of file camera_depth_sensor.h.
|
inlinevirtual |
height of camera in pixels.
Definition at line 110 of file camera_depth_sensor.h.
|
inlinevirtual |
return an image from internal camera parameter.
Definition at line 92 of file camera_depth_sensor.h.
|
inlinevirtual |
return true if point p is inside of field-of-view.
Definition at line 70 of file camera_depth_sensor.h.
|
inlinevirtual |
force point to be inside of field of view.
Definition at line 119 of file camera_depth_sensor.h.
|
inlinevirtual |
Definition at line 51 of file camera_depth_sensor.h.
|
inlinevirtual |
width of camera in pixels.
Definition at line 101 of file camera_depth_sensor.h.
|
protected |
Definition at line 127 of file camera_depth_sensor.h.
|
protected |
Definition at line 126 of file camera_depth_sensor.h.