簡體   English   中英

在 Ros 中過濾顏色,使用 Python 和 Gazebo

[英]Filter color in Ros, using Python and Gazebo

最近我被委托使用一個已經在 gazebo 中制作的機器人,使用帶有攝像頭的 Ros,我已經能夠通過 .py 代碼看到該圖像。 現在他們讓我過濾colors(綠色,紅色和藍色),我已經有了高值和低值,我可以用圖像來做,但我不知道如何混合這兩個程序,所以過濾了什么通過顏色,我只知道什么傳輸機器人的相機而不是圖像。

所有這一切都是在使用 Open CV 時完成的

附上兩個代碼

//////////////////////////////////////////////////////////////////////////////////////// 
Code to see the gazeebo virtual camera
//////////////////////////////////////////////////////////////////////////////////////// 

#!/usr/bin/env python 
import rospy 
from sensor_msgs.msg import Image 
from cv_bridge import CvBridge, CvBridgeError 
import cv2 
bridge_object = CvBridge() # create the cv_bridge object 
image_received = 0 #Flag to indicate that we have already received an image 
cv_image = 0 #This is just to create the global variable cv_image  
def show_image(): 
    image_sub = rospy.Subscriber("/two_wheels_robot/camera1/image_raw",Image,camera_callback) 
    r = rospy.Rate(10) #10Hz  
    while not rospy.is_shutdown():  
        if image_received: 
            cv2.waitKey(1) 
            r.sleep()  
    cv2.destroyAllWindows() 
def camera_callback(data): 
    global bridge_object 
    global cv_image 
    global image_received 
    image_received=1 
    try: 
        print("received ROS image, I will convert it to opencv") 
        # We select bgr8 because its the OpenCV encoding by default 
        cv_image = bridge_object.imgmsg_to_cv2(data, desired_encoding="bgr8") 
        #Add your code to save the image here: 
        #Save the image "img" in the current path  
        cv2.imwrite('robot_image.jpg', cv_image)        
        #Display the image in a window 
        cv2.imshow('Image from robot camera', cv_image) 
    except CvBridgeError as e: 
        print(e) 
if __name__ == '__main__': 
    rospy.init_node('load_image', anonymous=True) 
    show_image() 

//////////////////////////////////////////////////////////////////////////////////////// 
code to see an image segmented in RGB by windows
//////////////////////////////////////////////////////////////////////////////////////// 

#!/usr/bin/env python 
import rospy 
from sensor_msgs.msg import Image 
#Import the numpy library which will help with some matrix operations 
import numpy as np  
from cv_bridge import CvBridge, CvBridgeError 
import cv2 
bridge_object = CvBridge() # create the cv_bridge object 
image_received = 0 #Flag to indicate that we have already received an image 
cv_image = 0 #This is just to create the global variable cv_image  
def show_image(): 
    image_sub = rospy.Subscriber("/two_wheels_robot/camera1/image_raw",Image,camera_callback) 
    r = rospy.Rate(10) #10Hz  
    image = cv2.imread('/home/user/catkin_ws/src/opencv_for_robotics_images/Unit_2/Course_images/Filtering.png') 
    while not rospy.is_shutdown():  
        #I resized the image so it can be easier to work with 
        image = cv2.resize(image,(300,300)) 
        #Once we read the image we need to change the color space to HSV 
        hsv = cv2.cvtColor(image, cv2.COLOR_BGR2HSV) 
        #Hsv limits are defined 
        #here is where you define the range of the color you're looking for 
        #each value of the vector corresponds to the H,S & V values respectively 
        min_green = np.array([50,220,220]) 
        max_green = np.array([60,255,255]) 
        min_red = np.array([170,220,220]) 
        max_red = np.array([180,255,255]) 
        min_blue = np.array([110,220,220]) 
        max_blue = np.array([120,255,255]) 
        #This is the actual color detection  
        #Here we will create a mask that contains only the colors defined in your limits 
        #This mask has only one dimension, so its black and white } 
        mask_g = cv2.inRange(hsv, min_green, max_green) 
        mask_r = cv2.inRange(hsv, min_red, max_red) 
        mask_b = cv2.inRange(hsv, min_blue, max_blue) 
        #We use the mask with the original image to get the colored post-processed image 
        res_b = cv2.bitwise_and(image, image, mask= mask_b) 
        res_g = cv2.bitwise_and(image,image, mask= mask_g) 
        res_r = cv2.bitwise_and(image,image, mask= mask_r) 
        cv2.imshow('Green',res_g) 
        cv2.imshow('Red',res_b) 
        cv2.imshow('Blue',res_r) 
        cv2.imshow('Original',image) 
        cv2.waitKey(1) 
        r.sleep()  
    cv2.destroyAllWindows() 
def camera_callback(data): 
    global bridge_object 
    global cv_image 
    global image_received 
    image_received=1 
    try: 
        print("received ROS image, I will convert it to opencv") 
        # We select bgr8 because its the OpenCV encoding by default 
        cv_image = bridge_object.imgmsg_to_cv2(data, desired_encoding="bgr8") 
    except CvBridgeError as e: 
        print(e) 
if __name__ == '__main__': 
    rospy.init_node('opencv_example1', anonymous=True) 
    show_image() 

首先,該代碼中存在很多結構性問題。 您應該考慮使用類並通過實現相互通信的獨立節點來遵循 ROS 理念。 請也看看 rospy 教程。

要“混合”這兩個程序,您可以創建一個 function 來處理接收圖像的第一個程序中的顏色

def process_image(image):
        image = cv2.resize(image,(300,300)) 
        
        hsv = cv2.cvtColor(image, cv2.COLOR_BGR2HSV) 

        min_green = np.array([50,220,220]) 
        max_green = np.array([60,255,255]) 
        min_red = np.array([170,220,220]) 
        max_red = np.array([180,255,255]) 
        min_blue = np.array([110,220,220]) 
        max_blue = np.array([120,255,255]) 
        
        mask_g = cv2.inRange(hsv, min_green, max_green) 
        mask_r = cv2.inRange(hsv, min_red, max_red) 
        mask_b = cv2.inRange(hsv, min_blue, max_blue) 

        res_b = cv2.bitwise_and(image, image, mask= mask_b) 
        res_g = cv2.bitwise_and(image,image, mask= mask_g) 
        res_r = cv2.bitwise_and(image,image, mask= mask_r) 
        cv2.imshow('Green',res_g) 
        cv2.imshow('Red',res_b) 
        cv2.imshow('Blue',res_r) 
        cv2.imshow('Original',image) 
        cv2.waitKey(1) 

每次收到圖像時調用一次(在回調中)。 通常最好將所有這些處理分成多個線程,但是,作為起點,您可以使用如下內容:


#!/usr/bin/env python 
import rospy 
from sensor_msgs.msg import Image 
from cv_bridge import CvBridge, CvBridgeError 
import cv2 
bridge_object = CvBridge() # create the cv_bridge object 
image_received = 0 #Flag to indicate that we have already received an image 
cv_image = 0 #This is just to create the global variable cv_image  
def show_image(): 
    image_sub = rospy.Subscriber("/two_wheels_robot/camera1/image_raw",Image,camera_callback) 
    r = rospy.Rate(10) #10Hz  
    while not rospy.is_shutdown():  
        if image_received: 
            cv2.waitKey(1) 
            r.sleep()  
    cv2.destroyAllWindows() 
def process_image(image):
        image = cv2.resize(image,(300,300)) 
        
        hsv = cv2.cvtColor(image, cv2.COLOR_BGR2HSV) 

        min_green = np.array([50,220,220]) 
        max_green = np.array([60,255,255]) 
        min_red = np.array([170,220,220]) 
        max_red = np.array([180,255,255]) 
        min_blue = np.array([110,220,220]) 
        max_blue = np.array([120,255,255]) 
        
        mask_g = cv2.inRange(hsv, min_green, max_green) 
        mask_r = cv2.inRange(hsv, min_red, max_red) 
        mask_b = cv2.inRange(hsv, min_blue, max_blue) 

        res_b = cv2.bitwise_and(image, image, mask= mask_b) 
        res_g = cv2.bitwise_and(image,image, mask= mask_g) 
        res_r = cv2.bitwise_and(image,image, mask= mask_r) 
        cv2.imshow('Green',res_g) 
        cv2.imshow('Red',res_b) 
        cv2.imshow('Blue',res_r) 
        cv2.imshow('Original',image) 
        cv2.waitKey(1) 
def camera_callback(data): 
    global bridge_object 
    global cv_image 
    global image_received 
    image_received=1 
    try: 
        print("received ROS image, I will convert it to opencv") 
        # We select bgr8 because its the OpenCV encoding by default 
        cv_image = bridge_object.imgmsg_to_cv2(data, desired_encoding="bgr8") 
        #Add your code to save the image here: 
        #Save the image "img" in the current path  
        cv2.imwrite('robot_image.jpg', cv_image)        
        ## Calling the processing function
        process_image(cv_image)
        cv2.imshow('Image from robot camera', cv_image) 
    except CvBridgeError as e: 
        print(e) 
if __name__ == '__main__': 
    rospy.init_node('load_image', anonymous=True) 
    show_image() 

您還應該避免在 function 中聲明全局變量。

暫無
暫無

聲明:本站的技術帖子網頁,遵循CC BY-SA 4.0協議,如果您需要轉載,請注明本站網址或者原文地址。任何問題請咨詢:yoyou2525@163.com.

 
粵ICP備18138465號  © 2020-2024 STACKOOM.COM